36 #ifndef __JSK_PCL_ROS_OCTREE_CHANGE_PUBLISHER_H__ 
   37 #define __JSK_PCL_ROS_OCTREE_CHANGE_PUBLISHER_H__ 
   41 #include <sensor_msgs/PointCloud2.h> 
   42 #include <dynamic_reconfigure/server.h> 
   43 #include <jsk_pcl_ros/OctreeChangePublisherConfig.h> 
   48 #include <pcl/point_types.h> 
   49 #include <pcl/point_cloud.h> 
   50 #include <pcl/octree/octree.h> 
   51 #include <jsk_topic_tools/connection_based_nodelet.h> 
   70   class OctreeChangePublisher: 
public jsk_topic_tools::ConnectionBasedNodelet
 
   73     typedef OctreeChangePublisherConfig 
Config;
 
   82     pcl::octree::OctreePointCloudChangeDetector<pcl::PointXYZRGB> *
octree_;
 
   87     cloud_cb (
const sensor_msgs::PointCloud2 &pc);