36 #ifndef JSK_PCL_ROS_SELECTED_CLUSTER_PUBLISHER_H_ 37 #define JSK_PCL_ROS_SELECTED_CLUSTER_PUBLISHER_H_ 41 #include <sensor_msgs/PointCloud2.h> 42 #include <jsk_recognition_msgs/Int32Stamped.h> 43 #include <jsk_recognition_msgs/ClusterPointIndices.h> 61 virtual void extract(
const sensor_msgs::PointCloud2::ConstPtr& input,
62 const jsk_recognition_msgs::ClusterPointIndices::ConstPtr& indices,
63 const jsk_recognition_msgs::Int32Stamped::ConstPtr& index);
boost::shared_ptr< message_filters::Synchronizer< SyncPolicy > > sync_
message_filters::Subscriber< sensor_msgs::PointCloud2 > sub_input_
message_filters::Subscriber< jsk_recognition_msgs::ClusterPointIndices > sub_indices_
message_filters::Subscriber< jsk_recognition_msgs::Int32Stamped > sub_index_
virtual void extract(const sensor_msgs::PointCloud2::ConstPtr &input, const jsk_recognition_msgs::ClusterPointIndices::ConstPtr &indices, const jsk_recognition_msgs::Int32Stamped::ConstPtr &index)
virtual void unsubscribe()
message_filters::sync_policies::ExactTime< sensor_msgs::PointCloud2, jsk_recognition_msgs::ClusterPointIndices, jsk_recognition_msgs::Int32Stamped > SyncPolicy