usb_cam::formats::RAW_MJPEG
Inherits from usb_cam::formats::pixel_format_base
Public Functions
| Name | |
|---|---|
| RAW_MJPEG(const format_arguments_t & args =format_arguments_t()) | 
Additional inherited members
Public Functions inherited from usb_cam::formats::pixel_format_base
| Name | |
|---|---|
| std::string | v4l2_str() String value of V4L2 capture pixel format. | 
| uint32_t | v4l2() Integer value of V4L2 capture pixel format. | 
| std::string | ros() Name of output pixel (encoding) format to ROS. | 
| bool | requires_conversion() True if the current pixel format requires a call to the convertmethod Used in the usb_cam library logic to determine if a plainmemcopycall can be used instead of a call to theconvertmethod of this class. | 
| pixel_format_base(std::string name, uint32_t v4l2, std::string ros, uint8_t channels, uint8_t bit_depth, bool requires_conversion) | |
| std::string | name() Name of pixel format. Used in the parameters file to select this format. | 
| bool | is_mono() Returns if the final output format is monocolor (gray) Copied from: https://github.com/ros2/common_interfaces/blob/rolling/sensor_msgs/include/sensor_msgs/image_encodings.hpp. | 
| bool | is_color() Returns if the final output format is color Copied from: https://github.com/ros2/common_interfaces/blob/rolling/sensor_msgs/include/sensor_msgs/image_encodings.hpp. | 
| bool | is_bayer() Returns if the final output format is bayer Copied from: https://github.com/ros2/common_interfaces/blob/rolling/sensor_msgs/include/sensor_msgs/image_encodings.hpp. | 
| bool | has_alpha() Returns if the final output format has an alpha value Copied from: https://github.com/ros2/common_interfaces/blob/rolling/sensor_msgs/include/sensor_msgs/image_encodings.hpp. | 
| virtual void | convert(const char & src, char & dest, const int & bytes_used) Conversion method. Meant to be overridden if pixel format requires it. | 
| uint8_t | channels() Number of channels (e.g. bytes) per pixel. | 
| uint8_t | byte_depth() Number of bytes per channel. | 
| uint8_t | bit_depth() Number for bit depth of image. | 
Protected Attributes inherited from usb_cam::formats::pixel_format_base
| Name | |
|---|---|
| uint32_t | m_v4l2 Integer correspoding to a specific V4L2_PIX_FMT_* constant See linux/videodev2.hfor a list of all possible values for here. | 
| std::string | m_ros This should match ROS encoding string See sensor_msgs/image_encodings.hppfor corresponding possible values. Copy of those values are stored in[usb_cam/constants.hpp] | 
| bool | m_requires_conversion boolean whether or not the current format requires a call to convert. Setting this to true requires that the virtualconvertmethod is implemented. | 
| std::string | m_name Unique name for this pixel format. | 
| uint8_t | m_channels Number of channels (aka bytes per pixel) of output (ROS format above) | 
| uint8_t | m_bit_depth Bitdepth of output (ROS format above) | 
Public Functions Documentation
function RAW_MJPEG
inline explicit RAW_MJPEG(
    const format_arguments_t & args =format_arguments_t()
)
Updated on 2025-01-25 at 19:45:14 +0000