Go to the documentation of this file. 1 #ifndef USB_CAM_CONTROLLERS_FORMAT_CONTROLLERS
2 #define USB_CAM_CONTROLLERS_FORMAT_CONTROLLERS
17 #include <opencv2/core/core.hpp>
18 #include <opencv2/imgproc/imgproc.hpp>
22 template < cv::ColorConversionCodes ConversionCode, const std::
string *DstEncoding >
55 out.
image, ConversionCode);
56 }
catch (
const cv::Exception &ex) {
usb_cam_hardware_interface::PacketHandle packet_iface_
ros::Time getStamp() const
#define ROS_ERROR_STREAM(args)
sensor_msgs::ImagePtr toImageMsg() const
const Byte * getStartAs() const
Publisher advertise(const std::string &base_topic, uint32_t queue_size, bool latch=false)
FormatController< cv::COLOR_YUV2BGR_YUYV, &sensor_msgs::image_encodings::BGR8 > YUYVController
FormatController< cv::COLOR_RGB2BGR, &sensor_msgs::image_encodings::BGR8 > RGB24Controller
FormatController< cv::COLOR_YUV2BGR_UYVY, &sensor_msgs::image_encodings::BGR8 > UYVYController
std::size_t getLength() const
void publish(const sensor_msgs::Image &message) const
T param(const std::string ¶m_name, const T &default_val) const