37 #ifndef JSK_PCL_ROS_MASK_IMAGE_CLUSTER_FILTER_H_ 38 #define JSK_PCL_ROS_MASK_IMAGE_CLUSTER_FILTER_H_ 41 #include <jsk_recognition_msgs/ClusterPointIndices.h> 42 #include <sensor_msgs/Image.h> 43 #include <sensor_msgs/CameraInfo.h> 44 #include <sensor_msgs/PointCloud2.h> 45 #include <opencv2/opencv.hpp> 58 sensor_msgs::PointCloud2,
66 const sensor_msgs::PointCloud2::ConstPtr& cloud_msg,
67 const jsk_recognition_msgs::ClusterPointIndicesConstPtr &indices);
69 const sensor_msgs::Image::ConstPtr& mask_msg);
71 const sensor_msgs::CameraInfo::ConstPtr& info_ms);
virtual void unsubscribe()
ros::Subscriber sub_image_
virtual void concat(const sensor_msgs::PointCloud2::ConstPtr &cloud_msg, const jsk_recognition_msgs::ClusterPointIndicesConstPtr &indices)
boost::shared_ptr< message_filters::Synchronizer< SyncPolicy > > sync_
virtual void imageCalback(const sensor_msgs::Image::ConstPtr &mask_msg)
sensor_msgs::CameraInfo::ConstPtr camera_info_
ros::Subscriber sub_info_
message_filters::Subscriber< sensor_msgs::PointCloud2 > sub_input_
boost::mutex mutex
global mutex.
message_filters::sync_policies::ExactTime< sensor_msgs::PointCloud2, jsk_recognition_msgs::ClusterPointIndices > SyncPolicy
virtual void infoCalback(const sensor_msgs::CameraInfo::ConstPtr &info_ms)
message_filters::Subscriber< jsk_recognition_msgs::ClusterPointIndices > sub_target_