#include <string>#include <cv_bridge/cv_bridge.h>#include <image_transport/image_transport.h>#include <image_transport/publisher.h>#include <ros/console.h>#include <ros/duration.h>#include <ros/node_handle.h>#include <ros/time.h>#include <sensor_msgs/image_encodings.h>#include <usb_cam_controllers/simple_packet_controller.hpp>#include <usb_cam_hardware_interface/packet_interface.hpp>#include <opencv2/core/core.hpp>#include <opencv2/imgproc/imgproc.hpp>

Go to the source code of this file.
Classes | |
| class | usb_cam_controllers::FormatController< ConversionCode, DstEncoding > |
Namespaces | |
| usb_cam_controllers | |
Typedefs | |
| typedef FormatController< cv::COLOR_RGB2BGR,&sensor_msgs::image_encodings::BGR8 > | usb_cam_controllers::RGB24Controller |
| typedef FormatController< cv::COLOR_YUV2BGR_UYVY,&sensor_msgs::image_encodings::BGR8 > | usb_cam_controllers::UYVYController |
| typedef FormatController< cv::COLOR_YUV2BGR_YUYV,&sensor_msgs::image_encodings::BGR8 > | usb_cam_controllers::YUYVController |