36 #ifndef JSK_PCL_ROS_VOXEL_GRID_LARGE_SCALE_H_
37 #define JSK_PCL_ROS_VOXEL_GRID_LARGE_SCALE_H_
39 #include <jsk_topic_tools/diagnostic_nodelet.h>
40 #include <sensor_msgs/PointCloud2.h>
41 #include <dynamic_reconfigure/server.h>
42 #include <jsk_pcl_ros/VoxelGridLargeScaleConfig.h>
46 class VoxelGridLargeScale:
public jsk_topic_tools::DiagnosticNodelet
49 typedef VoxelGridLargeScaleConfig
Config;
53 virtual void filter(
const sensor_msgs::PointCloud2::ConstPtr&
msg);