RGBDNode.h
Go to the documentation of this file.
1 
21 #ifndef ORBSLAM2_ROS_RGBDODE_H_
22 #define ORBSLAM2_ROS_RGBDODE_H_
23 
24 #include <iostream>
25 #include <algorithm>
26 #include <fstream>
27 #include <chrono>
28 
29 #include <ros/ros.h>
34 #include <cv_bridge/cv_bridge.h>
36 #include <opencv2/core/core.hpp>
38 
39 #include "System.h"
40 #include "Node.h"
41 
42 
43 class RGBDNode : public Node
44 {
45  public:
47  ~RGBDNode ();
48  void ImageCallback (const sensor_msgs::ImageConstPtr& msgRGB,const sensor_msgs::ImageConstPtr& msgD);
49 
50  private:
55 };
56 
57 #endif //ORBSLAM2_ROS_RGBDODE_H_
Definition: Node.h:54
void ImageCallback(const sensor_msgs::ImageConstPtr &msgRGB, const sensor_msgs::ImageConstPtr &msgD)
Definition: RGBDNode.cc:46
message_filters::Subscriber< sensor_msgs::Image > * rgb_subscriber_
Definition: RGBDNode.h:52
~RGBDNode()
Definition: RGBDNode.cc:39
RGBDNode(const ORB_SLAM2::System::eSensor sensor, ros::NodeHandle &node_handle, image_transport::ImageTransport &image_transport)
Definition: RGBDNode.cc:29
message_filters::Subscriber< sensor_msgs::Image > * depth_subscriber_
Definition: RGBDNode.h:53
message_filters::sync_policies::ApproximateTime< sensor_msgs::Image, sensor_msgs::Image > sync_pol
Definition: RGBDNode.h:51
message_filters::Synchronizer< sync_pol > * sync_
Definition: RGBDNode.h:54


orb_slam2_ros
Author(s):
autogenerated on Wed Apr 21 2021 02:53:05