37 #ifndef JSK_PERCEPTION_POLYGON_TO_MASK_IMAGE_H_
38 #define JSK_PERCEPTION_POLYGON_TO_MASK_IMAGE_H_
40 #include <jsk_topic_tools/diagnostic_nodelet.h>
41 #include <geometry_msgs/PolygonStamped.h>
42 #include <sensor_msgs/CameraInfo.h>
43 #include <sensor_msgs/Image.h>
48 class PolygonToMaskImage:
public jsk_topic_tools::DiagnosticNodelet
57 const sensor_msgs::CameraInfo::ConstPtr& info_msg);
59 const geometry_msgs::PolygonStamped::ConstPtr& polygon_msg);