37 #ifndef JSK_PCL_ROS_UTILS_POLYGON_ARRAY_UNWRAPPER_H_
38 #define JSK_PCL_ROS_UTILS_POLYGON_ARRAY_UNWRAPPER_H_
44 #include <dynamic_reconfigure/server.h>
45 #include <geometry_msgs/PolygonStamped.h>
46 #include <jsk_pcl_ros_utils/PolygonArrayUnwrapperConfig.h>
47 #include <jsk_recognition_msgs/PolygonArray.h>
48 #include <jsk_recognition_msgs/ModelCoefficientsArray.h>
49 #include <jsk_topic_tools/connection_based_nodelet.h>
54 class PolygonArrayUnwrapper:
public jsk_topic_tools::ConnectionBasedNodelet
57 typedef PolygonArrayUnwrapperConfig
Config;
59 jsk_recognition_msgs::PolygonArray,
60 jsk_recognition_msgs::ModelCoefficientsArray>
70 const jsk_recognition_msgs::PolygonArray::ConstPtr& polygon,
71 const jsk_recognition_msgs::ModelCoefficientsArray::ConstPtr& coefficients);