35 #ifndef JSK_PCL_ROS_NORMAL_ESTIMATION_INTEGRAL_IMAGE_H_ 36 #define JSK_PCL_ROS_NORMAL_ESTIMATION_INTEGRAL_IMAGE_H_ 40 #include <sensor_msgs/PointCloud2.h> 43 #include <dynamic_reconfigure/server.h> 44 #include "jsk_pcl_ros/NormalEstimationIntegralImageConfig.h" 53 typedef jsk_pcl_ros::NormalEstimationIntegralImageConfig
Config;
66 virtual void compute(
const sensor_msgs::PointCloud2::ConstPtr&
msg);
virtual void compute(const sensor_msgs::PointCloud2::ConstPtr &msg)
double normal_smoothing_size_
jsk_pcl_ros::NormalEstimationIntegralImageConfig Config
virtual void unsubscribe()
boost::mutex mutex
global mutex.
double max_depth_change_factor_
ros::Subscriber sub_input_
bool border_policy_ignore_
bool depth_dependent_smoothing_
ros::Publisher pub_with_xyz_
virtual void configCallback(Config &config, uint32_t level)
boost::shared_ptr< dynamic_reconfigure::Server< Config > > srv_