37 #ifndef JSK_PERCEPTION_RECT_TO_ROI_H_ 
   38 #define JSK_PERCEPTION_RECT_TO_ROI_H_ 
   40 #include <jsk_topic_tools/diagnostic_nodelet.h> 
   41 #include <sensor_msgs/CameraInfo.h> 
   42 #include <geometry_msgs/PolygonStamped.h> 
   46   class RectToROI: 
public jsk_topic_tools::DiagnosticNodelet
 
   49     RectToROI(): DiagnosticNodelet(
"RectToROI") {}
 
   55       const geometry_msgs::PolygonStamped::ConstPtr& rect_msg);
 
   57       const sensor_msgs::CameraInfo::ConstPtr& info_msg);