36 #ifndef JSK_PCL_ROS_PEOPLE_DETECTION_H_
37 #define JSK_PCL_ROS_PEOPLE_DETECTION_H_
39 #include <jsk_topic_tools/diagnostic_nodelet.h>
41 #include <jsk_recognition_msgs/BoundingBoxArray.h>
42 #include <jsk_recognition_msgs/ModelCoefficientsArray.h>
43 #include <sensor_msgs/CameraInfo.h>
44 #include <sensor_msgs/PointCloud2.h>
46 #include <dynamic_reconfigure/server.h>
47 #include "jsk_pcl_ros/PeopleDetectionConfig.h"
49 #include <pcl/people/ground_based_people_detection_app.h>
52 class PeopleDetection :
public jsk_topic_tools::DiagnosticNodelet {
56 typedef jsk_pcl_ros::PeopleDetectionConfig
Config;
65 const jsk_recognition_msgs::ModelCoefficientsArray::ConstPtr&
68 const pcl_msgs::ModelCoefficients& coefficients);
70 const sensor_msgs::CameraInfo::ConstPtr& info_msg);
73 virtual void detect(
const sensor_msgs::PointCloud2::ConstPtr& cloud_msg);
98 pcl::people::GroundBasedPeopleDetectionApp<pcl::PointXYZRGBA>