36 #ifndef JSK_PCL_ROS_VOXEL_GRID_DOWNSAMPLE_DECODER_H_
37 #define JSK_PCL_ROS_VOXEL_GRID_DOWNSAMPLE_DECODER_H_
42 #include <sensor_msgs/PointCloud2.h>
43 #include <visualization_msgs/Marker.h>
44 #include "jsk_recognition_msgs/SlicedPointCloud.h"
47 #include <pcl/point_types.h>
49 #include <jsk_topic_tools/connection_based_nodelet.h>
53 class VoxelGridDownsampleDecoder :
54 public jsk_topic_tools::ConnectionBasedNodelet
68 std::vector<jsk_recognition_msgs::SlicedPointCloudConstPtr>
pc_buffer_;
69 void pointCB(
const jsk_recognition_msgs::SlicedPointCloudConstPtr &
input);
76 #endif // JSK_PCL_ROS_VOXEL_GRID_DOWNSAMPLE_MANAGER_H