36 #ifndef JSK_PCL_ROS_MOVING_LEAST_SQUARE_SMOOTHING_H_ 37 #define JSK_PCL_ROS_MOVING_LEAST_SQUARE_SMOOTHING_H_ 42 #include <sensor_msgs/PointCloud2.h> 44 #include <jsk_pcl_ros/MovingLeastSquareSmoothingConfig.h> 48 #include <pcl/point_types.h> 49 #include <pcl/common/centroid.h> 50 #include <pcl/surface/mls.h> 51 #include <dynamic_reconfigure/server.h> 52 #include <pcl/filters/filter.h> 60 typedef MovingLeastSquareSmoothingConfig
Config;
66 virtual void smooth(
const sensor_msgs::PointCloud2ConstPtr &input);
ros::Subscriber sub_input_
virtual void configCallback(Config &config, uint32_t level)
MovingLeastSquareSmoothingConfig Config
virtual void unsubscribe()
MovingLeastSquareSmoothing()
boost::mutex mutex
global mutex.
boost::shared_ptr< dynamic_reconfigure::Server< Config > > srv_
virtual void smooth(const sensor_msgs::PointCloud2ConstPtr &input)