38 #include <jsk_topic_tools/log_utils.h>
39 #include <boost/assign.hpp>
41 #include <opencv2/opencv.hpp>
48 DiagnosticNodelet::onInit();
49 pub_ = advertise<sensor_msgs::Image>(
58 jsk_topic_tools::warnNoRemap(names);
67 const sensor_msgs::Image::ConstPtr& label_image_msg)
70 label_image_msg, label_image_msg->encoding)->image;
71 ROS_DEBUG(
"%dx%d", label_image_msg->width, label_image_msg->height);
74 cv::cvtColor(output_image, output_image, CV_RGB2BGR);
77 label_image_msg->header,