Go to the documentation of this file.
34 #ifndef MULTISENSE_ROS_COLOR_LASER_H
35 #define MULTISENSE_ROS_COLOR_LASER_H
42 #include <sensor_msgs/PointCloud2.h>
43 #include <sensor_msgs/Image.h>
44 #include <sensor_msgs/CameraInfo.h>
54 const std::string &tf_prefix
ros::Subscriber camera_info_sub_
ros::Publisher color_laser_publisher_
void cameraInfoCallback(const sensor_msgs::CameraInfo::ConstPtr &message)
ros::Subscriber color_image_sub_
ros::Subscriber laser_pointcloud_sub_
void laserPointCloudCallback(sensor_msgs::PointCloud2::Ptr message)
ColorLaser(ros::NodeHandle &nh, const std::string &tf_prefix)
sensor_msgs::Image color_image_
sensor_msgs::PointCloud2 color_laser_pointcloud_
sensor_msgs::CameraInfo camera_info_
void colorImageCallback(const sensor_msgs::Image::ConstPtr &message)
ros::NodeHandle node_handle_