37 #ifndef JSK_PCL_ROS_SUPERVOXEL_SEGMENTATION_H_ 38 #define JSK_PCL_ROS_SUPERVOXEL_SEGMENTATION_H_ 42 #include <dynamic_reconfigure/server.h> 43 #include <jsk_pcl_ros/SupervoxelSegmentationConfig.h> 44 #include <jsk_recognition_msgs/ClusterPointIndices.h> 52 typedef SupervoxelSegmentationConfig
Config;
62 const sensor_msgs::PointCloud2::ConstPtr& cloud_msg);
virtual void configCallback(Config &config, uint32_t level)
ros::Publisher pub_indices_
virtual void unsubscribe()
boost::shared_ptr< dynamic_reconfigure::Server< Config > > srv_
ros::Publisher pub_cloud_
SupervoxelSegmentationConfig Config
double normal_importance_
boost::mutex mutex
global mutex.
double spatial_importance_
boost::shared_ptr< SupervoxelSegmentation > Ptr
virtual void segment(const sensor_msgs::PointCloud2::ConstPtr &cloud_msg)