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"
45 #include <jsk_topic_tools/connection_based_nodelet.h>
49 class NormalEstimationIntegralImage:
50 public jsk_topic_tools::ConnectionBasedNodelet
53 typedef jsk_pcl_ros::NormalEstimationIntegralImageConfig
Config;
66 virtual void compute(
const sensor_msgs::PointCloud2::ConstPtr&
msg);