37 #ifndef JSK_PCL_ROS_MASK_IMAGE_FILTER_H_ 38 #define JSK_PCL_ROS_MASK_IMAGE_FILTER_H_ 41 #include <sensor_msgs/Image.h> 42 #include <sensor_msgs/CameraInfo.h> 43 #include <sensor_msgs/PointCloud2.h> 44 #include <opencv2/opencv.hpp> 57 const sensor_msgs::PointCloud2::ConstPtr& cloud_msg);
59 const sensor_msgs::Image::ConstPtr& mask_msg);
61 const sensor_msgs::CameraInfo::ConstPtr& info_ms);
virtual void infoCalback(const sensor_msgs::CameraInfo::ConstPtr &info_ms)
ros::Subscriber sub_cloud_
sensor_msgs::CameraInfo::ConstPtr camera_info_
virtual void unsubscribe()
ros::Subscriber sub_image_
virtual void filter(const sensor_msgs::PointCloud2::ConstPtr &cloud_msg)
ros::Subscriber sub_info_
boost::mutex mutex
global mutex.
virtual void imageCalback(const sensor_msgs::Image::ConstPtr &mask_msg)