Skip to content

Commit

Permalink
ros wrapper builds
Browse files Browse the repository at this point in the history
  • Loading branch information
YujiElfahkrany committed Apr 22, 2023
1 parent 4dfef1b commit ea451db
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 2 deletions.
1 change: 1 addition & 0 deletions Examples/ROS/ORB_SLAM2/manifest.xml
Original file line number Diff line number Diff line change
Expand Up @@ -9,6 +9,7 @@
<depend package="roscpp"/>
<depend package="tf"/>
<depend package="sensor_msgs"/>
<depend package="std_msgs"/>
<depend package="image_transport"/>
<depend package="cv_bridge"/>

Expand Down
4 changes: 2 additions & 2 deletions Examples/ROS/ORB_SLAM2/src/ros_stereo.cc
Original file line number Diff line number Diff line change
Expand Up @@ -25,7 +25,7 @@
#include<chrono>

#include<ros/ros.h>
#include<std_msgs/Float32MultiArray.h>
#include<std_msgs/Float64MultiArray.h>
#include<std_msgs/MultiArrayDimension.h>
#include <tf/tf.h>
#include <tf/transform_broadcaster.h>
Expand Down Expand Up @@ -131,7 +131,7 @@ int main(int argc, char **argv)
ros::NodeHandle nh;

g_pubPose = nh.advertise<geometry_msgs::PoseWithCovarianceStamped>("/cube/data/vslam_localization/pose", 1);
g_pubInfo = nh.advertise<std_msgs::Float32MultiArray>("/cube/data/vslam_localization/info", 1);
g_pubInfo = nh.advertise<std_msgs::Float64MultiArray>("/cube/data/vslam_localization/info", 1);

message_filters::Subscriber<sensor_msgs::Image> left_sub(nh, "/camera/left/image_raw", 1);
message_filters::Subscriber<sensor_msgs::Image> right_sub(nh, "/camera/right/image_raw", 1);
Expand Down

0 comments on commit ea451db

Please sign in to comment.