36 #ifndef JSK_PCL_ROS_GRID_SAMPLER_H_
37 #define JSK_PCL_ROS_GRID_SAMPLER_H_
40 #include <dynamic_reconfigure/server.h>
41 #include <jsk_recognition_msgs/ClusterPointIndices.h>
42 #include <sensor_msgs/PointCloud2.h>
44 #include <jsk_pcl_ros/GridSamplerConfig.h>
45 #include <jsk_topic_tools/connection_based_nodelet.h>
49 class GridSampler:
public jsk_topic_tools::ConnectionBasedNodelet
52 typedef jsk_pcl_ros::GridSamplerConfig
Config;
55 virtual void sample(
const sensor_msgs::PointCloud2::ConstPtr&
msg);