Show EOL distros: 

Package Summary

A ROS Driver for V4L USB Cameras

Package Summary

A ROS Driver for V4L USB Cameras

Package Summary

A ROS Driver for V4L USB Cameras

Package Summary

A ROS Driver for V4L USB Cameras

Package Summary

A ROS Driver for V4L USB Cameras

Package Summary

A ROS Driver for V4L USB Cameras

  • Maintainer status: maintained
  • Maintainer: Andrey Vukolov <andrey.vukolov AT elettra DOT eu>, Shingo Kitagawa <shingogo.5511 AT gmail DOT com>, Russell Toris <rctoris AT wpi DOT edu>, ROS Orphaned Package Maintainers <ros-orphaned-packages AT googlegroups DOT com>
  • Author: Benjamin Pitzer <benjamin.pitzer AT bosch DOT com>
  • License: BSD
  • Bug / feature tracker: https://github.com/ros-drivers/usb_cam/issues
  • Source: git https://github.com/ros-drivers/usb_cam.git (branch: develop)

Package Summary

A ROS Driver for V4L USB Cameras

  • Maintainer status: maintained
  • Maintainer: Andrey Vukolov <andrey.vukolov AT elettra DOT eu>, Shingo Kitagawa <shingogo.5511 AT gmail DOT com>, Russell Toris <rctoris AT wpi DOT edu>, ROS Orphaned Package Maintainers <ros-orphaned-packages AT googlegroups DOT com>
  • Author: Benjamin Pitzer <benjamin.pitzer AT bosch DOT com>
  • License: BSD
  • Bug / feature tracker: https://github.com/ros-drivers/usb_cam/issues
  • Source: git https://github.com/ros-drivers/usb_cam.git (branch: develop)

Nodes

usb_cam_node

The usb_cam_node interfaces with standard USB cameras (e.g. the Logitech Quickcam) using libusb_cam and publishes images as sensor_msgs::Image. Uses the image_transport library to allow compressed image transport.

Published Topics

~<camera_name>/image_raw (sensor_msgs/Image)
  • The image

Parameters

~video_device (string, default: "/dev/video0")
  • The device the camera is on.
~image_width (integer, default: 640)
  • Image width
~image_height (integer, default: 480)
  • Image height
~pixel_format (string, default: "mjpeg")
  • Possible values are mjpeg, yuyv, uyvy
~io_method (string, default: "mmap")
  • Possible values are mmap, read, userptr
~camera_frame_id (string, default: "head_camera")
  • The camera's tf frame
~framerate (integer, default: 30)
  • The required framerate
~contrast (integer, default: 32)
  • Contrast of video image (0-255)
~brightness (integer, default: 32)
  • Brightness of video image (0-255)
~saturation (integer, default: 32)
  • Saturation of video image (0-255)
~sharpness (integer, default: 22)
  • Sharpness of video image (0-255)
~autofocus (boolean, default: false)
  • Enable camera's autofocus
~focus (integer, default: 51)
  • If autofocus is disabled, the focus of the camera (0=at infinity)
~camera_info_url (string, default: )
  • An url to the camera calibration file that will be read by the CameraInfoManager class
~camera_name (string, default: head_camera)
  • The camera name. This must match the name in the camera calibration

cv_camera - supports image capture from usb cameras using OpenCV

Wiki: usb_cam (last edited 2022-10-27 15:30:08 by Andrey Vukolov)