Skip to content

Commit

Permalink
[ Minor Debugging ] : Changes topic from /camera to /tello
Browse files Browse the repository at this point in the history
  • Loading branch information
aPR0T0 committed Sep 20, 2023
1 parent 2e10516 commit feb55b3
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 8 deletions.
5 changes: 0 additions & 5 deletions Examples/ROS/.vscode/settings.json

This file was deleted.

6 changes: 3 additions & 3 deletions Examples/ROS/ORB_SLAM3/src/ros_mono.cc
Original file line number Diff line number Diff line change
Expand Up @@ -20,7 +20,7 @@
#include <ros/ros.h>
#include <sensor_msgs/CompressedImage.h>
#include <cv_bridge/cv_bridge.h>
#include <image_transport/image_encoding.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv2/core.hpp>
#include "../../../include/System.h"

Expand Down Expand Up @@ -54,7 +54,7 @@ int main(int argc, char** argv)
ImageGrabber igb(&SLAM);

ros::NodeHandle nodeHandler;
ros::Subscriber sub = nodeHandler.subscribe("/camera/image_raw/compressed", 1, &ImageGrabber::GrabImage, &igb);
ros::Subscriber sub = nodeHandler.subscribe("/tello/image_raw/compressed", 1, &ImageGrabber::GrabImage, &igb);

ros::spin();

Expand All @@ -75,7 +75,7 @@ void ImageGrabber::GrabImage(const sensor_msgs::CompressedImageConstPtr& msg)
cv_bridge::CvImageConstPtr cv_ptr;
try
{
cv_ptr = cv_bridge::toCvCopy(msg,image_transport::ImageEncodings::BGR8 );
cv_ptr = cv_bridge::toCvCopy(msg,sensor_msgs::image_encodings::BGR8 );
}
catch (cv_bridge::Exception& e)
{
Expand Down

0 comments on commit feb55b3

Please sign in to comment.