Wiki

  Show EOL distros: 

Package Summary

The usb_cam_hardware package

Package Summary

The usb_cam_hardware package

About

This package contains an USB camera driver which is almost compatible to usb_cam but based on ros_control. Major enhancements over usb_cam are;

Slides from ROS Japan UG #28 (in Japanese)

Nodelets

usb_cam_hardware/USBCamHardware

an USB camera driver based on ros_control

Published Topics

<controller-defined> (<controller-defined>)

Parameters

~video_device (string, default: "/dev/video0") ~image_width (int, default: 640) ~image_height (int, default: 480) ~pixel_format (string, default: "mjpeg") ~framerate (int, default: 30)

Controllers

All topics and parameters are defined in each controller's namespace

usb_cam_controllers/CameraInfoController

publishes camera information syncronized to packets from the camera

Published Topics

camera_info (sensor_msgs/CameraInfo)

Parameters

camera_frame_id (string, default: "head_camera") camera_info_url (string, default: "") camera_name (string, default: "head_camera")

usb_cam_controllers/PacketController

publishes raw packets from the camera as images

Published Topics

image (sensor_msgs/Image)

Parameters

image_width (int, default: 640) image_height (int, default: 480) encoding (string, default: "bgr8") skip (int, default: 0)

usb_cam_controllers/CompressedPacketController

publishes raw packets from the camera as compressed images

Published Topics

packet (sensor_msgs/CompressedImage)

Parameters

format (string, default: "jpeg") skip (int, default: 0)

usb_cam_controllers/MjpegController

decodes mjpeg-compressed packets and publishes decoded images

Published Topics

image (sensor_msgs/Image)

usb_cam_controllers/H264Controller

decodes h264-compressed packets and publishes decoded images

Published Topics

image (sensor_msgs/Image)

usb_cam_controllers/RGB24Controller

converts rgb-formatted packets to bgr images and publishes them

Published Topics

image (sensor_msgs/Image)

Parameters

image_width (int, default: 640) image_height (int, default: 480)

usb_cam_controllers/UYVYController

converts uyvy-formatted packets to bgr images and publishes them

Published Topics

image (sensor_msgs/Image)

Parameters

image_width (int, default: 640) image_height (int, default: 480)

usb_cam_controllers/YUYVController

converts yuyv-formatted packets to bgr images and publishes them

Published Topics

image (sensor_msgs/Image)

Parameters

image_width (int, default: 640) image_height (int, default: 480)

Examples

See the github repository.

codec_image_transport

Wiki: usb_cam_hardware (last edited 2020-04-17 00:26:46 by Yoshito Okada)