Package Summary

Tags No category tags.
Version 2.1.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version ros2
Last Updated 2019-04-26
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS2 Image messages and OpenCV images.

Additional Links

Maintainers

  • Ethan Gao

Authors

  • Patrick Mihelich
  • James Bowman

cv_bridge

Introduction

cv_bridge converts between ROS2 image messages and OpenCV image representation for perception applications. As follows:

cv_bridge overview

This ros2 branch initially derives from porting on the basis of ros kinetic branch

Installation

Firstly, it assumes that the ros2 core has already been installed, please refer to ROS2 installation to get started if the ros2 core isn't ready to use

Install dependencies

OpenCV3 is a must to install, please refer to the official installation guide from OpenCV Tutorials Since ros2 bases on python3, please make sure that python3-numpy is installed, or install like this:


sudo apt install python3-numpy


Now cv_bridge python backend still has dependency on python boost (equal or higer than 1.58.0), and install them as follows in Ubuntu 16.04:


sudo apt install libboost-python1.58.0
cd /usr/lib/x86_64-linux-gnu/ && sudo ln -s libboost_python-py35.so libboost_python3.so


Build and Test

Fetch the latest code and build


cd <YOUR_ROS2_WORKSPACE>
git clone https://github.com/ros-perception/vision_opencv.git
cd vision_opencv
git checkout ros2
colcon build --symlink-install


Run the tests

Python tests have dependency to opencv python support and install it:

pip3 install opencv-python


Next to prepare runtime environment and run tests:


source <YOUR_ROS2_WORKSPACE>/install/local_setup.bash
colcon test


Known issues

  • boost endian: remove boost endian APIs with standard C++ 11 or higer instead
  • Not verify with Windows and OS X environment and there may be building or running issues
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org

Package Summary

Tags No category tags.
Version 2.1.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version ros2
Last Updated 2019-04-26
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS2 Image messages and OpenCV images.

Additional Links

Maintainers

  • Ethan Gao

Authors

  • Patrick Mihelich
  • James Bowman

cv_bridge

Introduction

cv_bridge converts between ROS2 image messages and OpenCV image representation for perception applications. As follows:

cv_bridge overview

This ros2 branch initially derives from porting on the basis of ros kinetic branch

Installation

Firstly, it assumes that the ros2 core has already been installed, please refer to ROS2 installation to get started if the ros2 core isn't ready to use

Install dependencies

OpenCV3 is a must to install, please refer to the official installation guide from OpenCV Tutorials Since ros2 bases on python3, please make sure that python3-numpy is installed, or install like this:


sudo apt install python3-numpy


Now cv_bridge python backend still has dependency on python boost (equal or higer than 1.58.0), and install them as follows in Ubuntu 16.04:


sudo apt install libboost-python1.58.0
cd /usr/lib/x86_64-linux-gnu/ && sudo ln -s libboost_python-py35.so libboost_python3.so


Build and Test

Fetch the latest code and build


cd <YOUR_ROS2_WORKSPACE>
git clone https://github.com/ros-perception/vision_opencv.git
cd vision_opencv
git checkout ros2
colcon build --symlink-install


Run the tests

Python tests have dependency to opencv python support and install it:

pip3 install opencv-python


Next to prepare runtime environment and run tests:


source <YOUR_ROS2_WORKSPACE>/install/local_setup.bash
colcon test


Known issues

  • boost endian: remove boost endian APIs with standard C++ 11 or higer instead
  • Not verify with Windows and OS X environment and there may be building or running issues
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org

Package Summary

Tags No category tags.
Version 1.13.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version melodic
Last Updated 2018-04-30
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS Image messages and OpenCV images.

Additional Links

Maintainers

  • Vincent Rabaud

Authors

  • Patrick Mihelich
  • James Bowman
README
No README found. See repository README.
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cv_camera github-OTL-cv_camera
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
find_object_2d github-introlab-find-object
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gscam github-ros-drivers-gscam
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_proc github-ros-perception-image_pipeline
image_publisher github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
compressed_depth_image_transport github-ros-perception-image_transport_plugins
compressed_image_transport github-ros-perception-image_transport_plugins
theora_image_transport github-ros-perception-image_transport_plugins
opt_camera github-jsk-ros-pkg-jsk_3rdparty
image_view2 github-jsk-ros-pkg-jsk_common
jsk_tools github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
resized_image_transport github-jsk-ros-pkg-jsk_recognition
jsk_rqt_plugins github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
multisense_lib bitbucket-crl-multisense_ros
multisense_ros bitbucket-crl-multisense_ros
face_detector github-wg-perception-people
pr2_gazebo_plugins github-PR2-pr2_simulator
rtabmap github-introlab-rtabmap
rtabmap_ros github-introlab-rtabmap_ros
video_stream_opencv github-ros-drivers-video_stream_opencv
opencv_tests github-ros-perception-vision_opencv
vision_opencv github-ros-perception-vision_opencv
web_video_server github-RobotWebTools-web_video_server
basler_tof github-uos-basler_tof
costmap_converter github-rst-tu-dortmund-costmap_converter
fetch_depth_layer github-fetchrobotics-fetch_ros
grid_map_cv github-ethz-asl-grid_map
grid_map_cv github-anybotics-grid_map
grid_map_demos github-ethz-asl-grid_map
grid_map_demos github-anybotics-grid_map
grid_map_ros github-ethz-asl-grid_map
grid_map_ros github-anybotics-grid_map
imagezero_image_transport github-swri-robotics-imagezero_transport
imagezero_ros github-swri-robotics-imagezero_transport
mapviz github-swri-robotics-mapviz
mapviz_plugins github-swri-robotics-mapviz
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_opencv_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
opencv_apps github-ros-perception-opencv_apps
robot_calibration github-mikeferguson-robot_calibration
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rqt_image_view github-ros-visualization-rqt_image_view
aruco_detect github-UbiquityRobotics-fiducials
fiducial_slam github-UbiquityRobotics-fiducials
flir_boson_usb github-astuff-flir_boson_usb
ensenso_camera github-ensenso-ros_driver
mrpt_bridge github-mrpt-ros-pkg-mrpt_bridge
nerian_stereo github-nerian-vision-nerian_stereo
orb_slam2_ros github-appliedAI-Initiative-orb_slam_2_ros
rqt_bag_exporter gitlab-InstitutMaupertuis-rqt_bag_exporter
turtlebot3_panorama github-ROBOTIS-GIT-turtlebot3_applications
turtlebot3_autorace_camera github-ROBOTIS-GIT-turtlebot3_autorace
turtlebot3_autorace_detect github-ROBOTIS-GIT-turtlebot3_autorace
tuw_geometry github-tuw-robotics-tuw_geometry
tuw_aruco github-tuw-robotics-tuw_marker_detection
tuw_checkerboard github-tuw-robotics-tuw_marker_detection
tuw_ellipses github-tuw-robotics-tuw_marker_detection
tuw_marker_pose_estimation github-tuw-robotics-tuw_marker_detection
tuw_multi_robot_router github-tuw-robotics-tuw_multi_robot
tuw_voronoi_graph github-tuw-robotics-tuw_multi_robot
tuw_uvc github-tuw-robotics-tuw_uvc
xiaoqiang_depth_image_proc github-bluewhalerobot-xiaoqiang
movie_publisher github-peci1-movie_publisher
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar
webrtc_ros github-RobotWebTools-webrtc_ros
usb_cam_controllers github-yoshito-n-students-usb_cam_hardware

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version kinetic
Last Updated 2018-04-16
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS Image messages and OpenCV images.

Additional Links

Maintainers

  • Vincent Rabaud

Authors

  • Patrick Mihelich
  • James Bowman
README
No README found. See repository README.
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cv_camera github-OTL-cv_camera
find_object_2d github-introlab-find-object
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gscam github-ros-drivers-gscam
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_proc github-ros-perception-image_pipeline
image_publisher github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
compressed_depth_image_transport github-ros-perception-image_transport_plugins
compressed_image_transport github-ros-perception-image_transport_plugins
theora_image_transport github-ros-perception-image_transport_plugins
opt_camera github-jsk-ros-pkg-jsk_3rdparty
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
multisense_lib bitbucket-crl-multisense_ros
multisense_ros bitbucket-crl-multisense_ros
nerian_sp1 github-nerian-vision-nerian_sp1
face_detector github-wg-perception-people
pr2_gazebo_plugins github-PR2-pr2_simulator
rtabmap github-introlab-rtabmap
rtabmap_ros github-introlab-rtabmap_ros
video_stream_opencv github-ros-drivers-video_stream_opencv
opencv_tests github-ros-perception-vision_opencv
vision_opencv github-ros-perception-vision_opencv
zbar_ros github-ros-drivers-zbar_ros
basler_tof github-uos-basler_tof
costmap_converter github-rst-tu-dortmund-costmap_converter
grid_map_cv github-anybotics-grid_map
grid_map_demos github-anybotics-grid_map
grid_map_ros github-anybotics-grid_map
imagezero_image_transport github-swri-robotics-imagezero_transport
imagezero_ros github-swri-robotics-imagezero_transport
mapviz github-swri-robotics-mapviz
mapviz_plugins github-swri-robotics-mapviz
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_opencv_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
moveit_ros_perception github-ros-planning-moveit
opencv_apps github-ros-perception-opencv_apps
pcdfilter_pa github-tuc-proaut-ros_pcdfilter
rqt_image_view github-ros-visualization-rqt_image_view
flir_boson_usb github-astuff-flir_boson_usb
ensenso github-crigroup-ensenso
ensenso_camera github-ensenso-ros_driver
nerian_stereo github-nerian-vision-nerian_stereo
velo2cam_calibration github-beltransen-velo2cam_calibration
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version kinetic
Last Updated 2018-04-16
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS Image messages and OpenCV images.

Additional Links

Maintainers

  • Vincent Rabaud

Authors

  • Patrick Mihelich
  • James Bowman
README
No README found. See repository README.
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Dependant Packages

Name Repo Deps
agile_grasp github-atenpas-agile_grasp
ar_track_alvar github-sniekum-ar_track_alvar
ar_track_alvar github-ros-perception-ar_track_alvar
aruco_ros github-pal-robotics-aruco_ros
baxter_examples github-RethinkRobotics-baxter_examples
bwi_logging github-utexas-bwi-bwi_common
bwi_mapper github-utexas-bwi-bwi_common
bwi_perception github-utexas-bwi-bwi_common
bwi_planning_common github-utexas-bwi-bwi_common
bwi_scavenger github-utexas-bwi-bwi_common
bwi_tools github-utexas-bwi-bwi_common
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
generic_throttle github-ipa320-cob_command_tools
cob_camera_sensors github-ipa320-cob_driver
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
ipa_3d_fov_visualization github-ipa320-cob_perception_common
cv_camera github-OTL-cv_camera
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
ecto_openni github-plasmodic-ecto_openni
ecto_ros github-plasmodic-ecto_ros
find_object_2d github-introlab-find-object
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gscam github-ros-drivers-gscam
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
hector_heat_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_motion_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_qrcode_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
hector_rqt_plugins github-tu-darmstadt-ros-pkg-hector_visualization
hrpsys github-fkanehiro-hrpsys-base
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_proc github-ros-perception-image_pipeline
image_publisher github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
compressed_depth_image_transport github-ros-perception-image_transport_plugins
compressed_image_transport github-ros-perception-image_transport_plugins
theora_image_transport github-ros-perception-image_transport_plugins
caljob_creator github-ros-industrial-industrial_calibration
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
rgbd_depth_correction github-ros-industrial-industrial_calibration
opt_camera github-jsk-ros-pkg-jsk_3rdparty
image_view2 github-jsk-ros-pkg-jsk_common
jsk_tools github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
resized_image_transport github-jsk-ros-pkg-jsk_recognition
jsk_rqt_plugins github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
moveit_ros_perception github-ros-planning-moveit_ros
moveit_ros_perception github-ros-planning-moveit
multisense_lib bitbucket-crl-multisense_ros
multisense_ros bitbucket-crl-multisense_ros
nerian_sp1 github-nerian-vision-nerian_sp1
opencv_candidate github-wg-perception-opencv_candidate
face_detector github-wg-perception-people
pr2_gazebo_plugins github-PR2-pr2_simulator
romeo_sensors_py github-ros-aldebaran-romeo_robot
rtabmap github-introlab-rtabmap
rtabmap_ros github-introlab-rtabmap_ros
softkinetic_camera github-ipa320-softkinetic
bag_tools github-srv-srv_tools
stereo_slam github-srv-stereo_slam
turtlebot_actions github-turtlebot-turtlebot_apps
rgbd_rosbag_tools github-uos-uos_tools
video_stream_opencv github-ros-drivers-video_stream_opencv
opencv_tests github-ros-perception-vision_opencv
opencv_tests github-ros2-vision_opencv
vision_opencv github-ros-perception-vision_opencv
vision_opencv github-ros2-vision_opencv
viso2_ros github-srv-viso2
visp_ros github-lagadic-visp_ros
web_video_server github-RobotWebTools-web_video_server
zbar_ros github-ros-drivers-zbar_ros
basler_tof github-uos-basler_tof
costmap_converter github-rst-tu-dortmund-costmap_converter
fetch_depth_layer github-fetchrobotics-fetch_ros
grid_map_cv github-anybotics-grid_map
grid_map_demos github-anybotics-grid_map
grid_map_ros github-anybotics-grid_map
imagezero_image_transport github-swri-robotics-imagezero_transport
imagezero_ros github-swri-robotics-imagezero_transport
libhaloc github-srv-libhaloc
mapviz github-swri-robotics-mapviz
mapviz_plugins github-swri-robotics-mapviz
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_opencv_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
naoqi_driver github-ros-naoqi-naoqi_driver
opencv_apps github-ros-perception-opencv_apps
pcdfilter_pa github-tuc-proaut-ros_pcdfilter
robot_calibration github-mikeferguson-robot_calibration
rqt_image_view github-ros-visualization-rqt_image_view
uavc_v4lctl github-meuchel-uavc_v4lctl
vigir_footstep_planner github-team-vigir-vigir_footstep_planning_core
vigir_footstep_planning_default_plugins github-team-vigir-vigir_footstep_planning_core
asr_aruco_marker_recognition github-asr-ros-asr_aruco_marker_recognition
baxter_sim_hardware github-RethinkRobotics-baxter_simulator
camera_pose_calibration github-delftrobotics-camera_pose_calibration
criutils github-crigroup-criutils
cliff_detector github-mdrwiega-depth_nav_tools
aruco_detect github-UbiquityRobotics-fiducials
fiducial_slam github-UbiquityRobotics-fiducials
flir_boson_usb github-astuff-flir_boson_usb
homer_robot_face gitlab-uni-koblenz-robbie-homer_robot_face
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
omip_common github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
realsense_camera github-intel-ros-realsense
rgbdslam github-felixendres-rgbdslam_v2
sick_visionary_t_driver github-SICKAG-sick_visionary_t
tango_ros_native github-Intermodalics-tango_ros
turtlebot_arm_kinect_calibration github-turtlebot-turtlebot_arm
image_stream github-UNR-RoboticsResearchLab-web_interface
apriltag_ros github-dmalyuta-apriltags2_ros
darknet_ros github-leggedrobotics-darknet_ros
dnn_detect github-UbiquityRobotics-dnn_detect
ensenso github-crigroup-ensenso
ensenso_camera github-ensenso-ros_driver
hugin_panorama github-danielsnider-hugin_panorama
image_overlay_scale_and_compass github-danielsnider-image_overlay_scale_and_compass
image_recognition_jetson github-tue-robotics-image_recognition
image_recognition_openface github-tue-robotics-image_recognition
image_recognition_openpose github-tue-robotics-image_recognition
image_recognition_skybiometry github-tue-robotics-image_recognition
ipcamera_driver github-alireza-hosseini-ipcamera_driver
lidar_camera_calibration github-ankitdhall-lidar_camera_calibration
movidius_ncs_example github-intel-ros_intel_movidius_ncs
movidius_ncs_image github-intel-ros_intel_movidius_ncs
movidius_ncs_stream github-intel-ros_intel_movidius_ncs
mrpt_bridge github-mrpt-ros-pkg-mrpt_bridge
mynt_eye_ros_wrapper github-harjeb-mynt_eye_ros_wrapper
nerian_stereo github-nerian-vision-nerian_stereo
orb_slam2_ros github-appliedAI-Initiative-orb_slam_2_ros
op3_ball_detector github-ROBOTIS-GIT-ROBOTIS-OP3-Demo
rqt_bag_exporter gitlab-InstitutMaupertuis-rqt_bag_exporter
sciurus17_examples github-rt-net-sciurus17_ros
sciurus17_vision github-rt-net-sciurus17_ros
smartek_camera github-larics-smartek_camera
spinnaker_sdk_camera_driver github-neufieldrobotics-spinnaker_sdk_camera_driver
telegram_ros github-tue-robotics-telegram_ros
turtlebot3_panorama github-ROBOTIS-GIT-turtlebot3_applications
turtlebot3_autorace_camera github-ROBOTIS-GIT-turtlebot3_autorace
turtlebot3_autorace_detect github-ROBOTIS-GIT-turtlebot3_autorace
tuw_geometry github-tuw-robotics-tuw_geometry
tuw_aruco github-tuw-robotics-tuw_marker_detection
tuw_checkerboard github-tuw-robotics-tuw_marker_detection
tuw_ellipses github-tuw-robotics-tuw_marker_detection
tuw_marker_pose_estimation github-tuw-robotics-tuw_marker_detection
tuw_multi_robot_router github-tuw-robotics-tuw_multi_robot
tuw_voronoi_graph github-tuw-robotics-tuw_multi_robot
tuw_uvc github-tuw-robotics-tuw_uvc
velo2cam_calibration github-beltransen-velo2cam_calibration
xiaoqiang_depth_image_proc github-bluewhalerobot-xiaoqiang
movie_publisher github-peci1-movie_publisher
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar
webrtc_ros github-RobotWebTools-webrtc_ros
usb_cam_controllers github-yoshito-n-students-usb_cam_hardware

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org

Package Summary

Tags No category tags.
Version 1.11.16
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version indigo
Last Updated 2017-11-05
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS Image messages and OpenCV images.

Additional Links

Maintainers

  • Vincent Rabaud

Authors

  • Patrick Mihelich
  • James Bowman
README
No README found. See repository README.
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
agile_grasp github-atenpas-agile_grasp
apriltags_ros github-RIVeR-Lab-apriltags_ros
ar_pose github-ar-tools-ar_tools
ar_track_alvar github-sniekum-ar_track_alvar
ar_track_alvar github-ros-perception-ar_track_alvar
aruco_ros github-pal-robotics-aruco_ros
baxter_examples github-RethinkRobotics-baxter_examples
baxter_tools github-RethinkRobotics-baxter_tools
bwi_logging github-utexas-bwi-bwi_common
bwi_mapper github-utexas-bwi-bwi_common
bwi_planning_common github-utexas-bwi-bwi_common
bwi_rqt_plugins github-utexas-bwi-bwi_common
bwi_scavenger github-utexas-bwi-bwi_common
bwi_tools github-utexas-bwi-bwi_common
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
generic_throttle github-ipa320-cob_command_tools
cob_camera_sensors github-ipa320-cob_driver
cob_3d_registration github-ipa320-cob_environment_perception
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_openni2_tracker github-ipa-rmb-cob_people_perception
cob_people_detection github-ipa-rmb-cob_people_perception
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_visualizer github-ipa320-cob_perception_common
ipa_3d_fov_visualization github-ipa320-cob_perception_common
cv_camera github-OTL-cv_camera
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
ecto_openni github-plasmodic-ecto_openni
ecto_ros github-plasmodic-ecto_ros
epuck_driver github-gctronic-epuck_driver
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gscam github-ros-drivers-gscam
head_pose_estimation github-OSUrobotics-ros-head-tracking
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
hector_heat_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_motion_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_qrcode_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
hector_rqt_plugins github-tu-darmstadt-ros-pkg-hector_visualization
hrpsys github-fkanehiro-hrpsys-base
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_proc github-ros-perception-image_pipeline
image_publisher github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
compressed_depth_image_transport github-ros-perception-image_transport_plugins
compressed_image_transport github-ros-perception-image_transport_plugins
theora_image_transport github-ros-perception-image_transport_plugins
caljob_creator github-ros-industrial-industrial_calibration
industrial_extrinsic_cal github-ros-industrial-industrial_calibration
rgbd_depth_correction github-ros-industrial-industrial_calibration
opt_camera github-jsk-ros-pkg-jsk_3rdparty
image_view2 github-jsk-ros-pkg-jsk_common
jsk_tools github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
resized_image_transport github-jsk-ros-pkg-jsk_recognition
jsk_pr2_startup github-jsk-ros-pkg-jsk_robot
jsk_rqt_plugins github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
mavros_extras github-mavlink-mavros
mjpeg_server github-RobotWebTools-mjpeg_server
moveit_ros_perception github-ros-planning-moveit_ros
moveit_ros_perception github-ros-planning-moveit
multisense_lib bitbucket-crl-multisense_ros
multisense_ros bitbucket-crl-multisense_ros
nerian_sp1 github-nerian-vision-nerian_sp1
object_recognition_renderer github-wg-perception-ork_renderer
opencv_candidate github-wg-perception-opencv_candidate
face_detector github-wg-perception-people
ndt_costmap github-tstoyanov-perception_oru-release
checkerboard_pose_estimation github-PR2-pr2_plugs
pr2_plugs_actions github-PR2-pr2_plugs
pr2_gazebo_plugins github-PR2-pr2_simulator
romeo_sensors_py github-ros-aldebaran-romeo_robot
rtabmap github-introlab-rtabmap
rtabmap_ros github-introlab-rtabmap_ros
softkinetic_camera github-ipa320-softkinetic
bag_tools github-srv-srv_tools
stereo_slam github-srv-stereo_slam
turtlebot_actions github-turtlebot-turtlebot_apps
rgbd_rosbag_tools github-uos-uos_tools
video_stream_opencv github-ros-drivers-video_stream_opencv
opencv_tests github-ros-perception-vision_opencv
opencv_tests github-ros2-vision_opencv
vision_opencv github-ros-perception-vision_opencv
vision_opencv github-ros2-vision_opencv
viso2_ros github-srv-viso2
visp_ros github-lagadic-visp_ros
web_video_server github-RobotWebTools-web_video_server
zbar_ros github-clearpathrobotics-zbar_ros
zbar_ros github-ros-drivers-zbar_ros
aruco_mapping github-SmartRoboticSystems-aruco_mapping
basler_tof github-uos-basler_tof
costmap_converter github-rst-tu-dortmund-costmap_converter
fetch_depth_layer github-fetchrobotics-fetch_ros
grid_map_cv github-anybotics-grid_map
grid_map_demos github-anybotics-grid_map
grid_map_ros github-anybotics-grid_map
imagezero_image_transport github-swri-robotics-imagezero_transport
imagezero_ros github-swri-robotics-imagezero_transport
libhaloc github-srv-libhaloc
mapviz_plugins github-swri-robotics-mapviz
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_opencv_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
naoqi_driver github-ros-naoqi-naoqi_driver
opencv_apps github-ros-perception-opencv_apps
pcdfilter_pa github-tuc-proaut-ros_pcdfilter
rail_recognition github-GT-RAIL-rail_pick_and_place
robot_calibration github-mikeferguson-robot_calibration
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rqt_image_view github-ros-visualization-rqt_image_view
uavc_v4lctl github-meuchel-uavc_v4lctl
vigir_footstep_planner github-team-vigir-vigir_footstep_planning_core
vigir_footstep_planning_default_plugins github-team-vigir-vigir_footstep_planning_core
aras_visual_servo_camera github-babaksit-aras_visual_servo
aras_visual_servo_controller github-babaksit-aras_visual_servo
asr_aruco_marker_recognition github-asr-ros-asr_aruco_marker_recognition
baxter_sim_hardware github-RethinkRobotics-baxter_simulator
bowpmap_ros github-kejriwalnishant1990-bowpmap_ros
camera_pose_calibration github-delftrobotics-camera_pose_calibration
criutils github-crigroup-criutils
custom_landmark_2d github-matthew-liu-custom_landmark_2d
cliff_detector github-mdrwiega-depth_nav_tools
dlut_viso2_ros github-ZhuangYanDLUT-dlut_vision
evarobot_gazebo github-inomuh-evarobot_simulator
face_recognition github-procrob-face_recognition
fiducial_detect github-UbiquityRobotics-fiducials
flir_boson_usb github-astuff-flir_boson_usb
h4r_thermapp_camera github-Hacks4ROS-h4r_thermapp_camera
homer_gui gitlab-uni-koblenz-robbie-homer_gui
or_libs gitlab-uni-koblenz-robbie-homer_object_recognition
or_msgs gitlab-uni-koblenz-robbie-homer_object_recognition
or_nodes gitlab-uni-koblenz-robbie-homer_object_recognition
robot_face gitlab-uni-koblenz-robbie-homer_robot_face
target_object_detector github-CIR-KIT-human_detector
elevator_move_base_pr2 github-jsk-ros-pkg-jsk_demos
anj_featurenav github-lama-imr-lama_featurenav
lsd_slam_core github-tum-vision-lsd_slam
lsd_slam_viewer github-tum-vision-lsd_slam
cv_detection github-micros-uav-micros_cv_detection
micros_dynamic_objects_filter github-yincanben-micros_dynamic_objects_filter
micros_mars_task_alloc github-liminglong-micros_mars_task_alloc
o3d3xx github-lovepark-o3d3xx-ros
ohm_rrl_motiondetection github-autonohm-ohm_rrl_perception
ohm_rrl_qrdetection github-autonohm-ohm_rrl_perception
feature_tracker github-tu-rbo-omip
joint_tracker github-tu-rbo-omip
omip_common github-tu-rbo-omip
rb_tracker github-tu-rbo-omip
shape_reconstruction github-tu-rbo-omip
shape_tracker github-tu-rbo-omip
orsens github-Oriense-orsens_ros
rail_face_detector github-GT-RAIL-rail_face_detection
rail_object_detector github-GT-RAIL-rail_object_detection
realsense_camera github-intel-ros-realsense
remote_monitor github-CIR-KIT-remote_monitor
rgbdslam github-felixendres-rgbdslam_v2
rocon_rtsp_camera_relay github-robotics-in-concert-rocon_devices
rospilot_deps github-rospilot-rospilot_deps
sick_visionary_t_driver github-SICKAG-sick_visionary_t
tango_ros_native github-Intermodalics-tango_ros
rviz_textured_quads github-zlt1991-tensor_field_nav
tensor_field_nav_core github-zlt1991-tensor_field_nav
tum_ardrone github-tum-vision-tum_ardrone
turtlebot_arm_kinect_calibration github-turtlebot-turtlebot_arm
ucl_drone github-dronesinma-ucl_drone_2016
uga_tum_ardrone github-thinclab-uga_tum_ardrone
viodom github-fjperezgrau-viodom
image_stream github-UNR-RoboticsResearchLab-web_interface
movie_publisher github-peci1-movie_publisher
multi_object_tracking_lidar github-praveen-palanisamy-multiple-object-tracking-lidar
webrtc_ros github-RobotWebTools-webrtc_ros

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org

Package Summary

Tags No category tags.
Version 1.11.16
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version indigo
Last Updated 2017-11-05
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS Image messages and OpenCV images.

Additional Links

Maintainers

  • Vincent Rabaud

Authors

  • Patrick Mihelich
  • James Bowman
README
No README found. See repository README.
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
aruco_ros github-pal-robotics-aruco_ros
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cv_camera github-OTL-cv_camera
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
ecto_openni github-plasmodic-ecto_openni
ecto_ros github-plasmodic-ecto_ros
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gscam github-ros-drivers-gscam
head_pose_estimation github-OSUrobotics-ros-head-tracking
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
hector_heat_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_motion_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_qrcode_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
hector_rqt_plugins github-tu-darmstadt-ros-pkg-hector_visualization
hrpsys github-fkanehiro-hrpsys-base
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_proc github-ros-perception-image_pipeline
image_publisher github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
compressed_depth_image_transport github-ros-perception-image_transport_plugins
compressed_image_transport github-ros-perception-image_transport_plugins
theora_image_transport github-ros-perception-image_transport_plugins
opt_camera github-jsk-ros-pkg-jsk_3rdparty
image_view2 github-jsk-ros-pkg-jsk_common
jsk_tools github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
resized_image_transport github-jsk-ros-pkg-jsk_recognition
jsk_rqt_plugins github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
mavros_extras github-mavlink-mavros
moveit_ros_perception github-ros-planning-moveit_ros
moveit_ros_perception github-ros-planning-moveit
multisense_lib bitbucket-crl-multisense_ros
multisense_ros bitbucket-crl-multisense_ros
nerian_sp1 github-nerian-vision-nerian_sp1
object_recognition_renderer github-wg-perception-ork_renderer
opencv_candidate github-wg-perception-opencv_candidate
face_detector github-wg-perception-people
romeo_sensors_py github-ros-aldebaran-romeo_robot
rtabmap github-introlab-rtabmap
rtabmap_ros github-introlab-rtabmap_ros
stereo_slam github-srv-stereo_slam
rgbd_rosbag_tools github-uos-uos_tools
video_stream_opencv github-ros-drivers-video_stream_opencv
opencv_tests github-ros-perception-vision_opencv
vision_opencv github-ros-perception-vision_opencv
visp_ros github-lagadic-visp_ros
web_video_server github-RobotWebTools-web_video_server
zbar_ros github-clearpathrobotics-zbar_ros
aruco_mapping github-SmartRoboticSystems-aruco_mapping
basler_tof github-uos-basler_tof
costmap_converter github-rst-tu-dortmund-costmap_converter
fetch_depth_layer github-fetchrobotics-fetch_ros
grid_map_cv github-ethz-asl-grid_map
grid_map_demos github-ethz-asl-grid_map
grid_map_ros github-ethz-asl-grid_map
imagezero_image_transport github-swri-robotics-imagezero_transport
imagezero_ros github-swri-robotics-imagezero_transport
libhaloc github-srv-libhaloc
mapviz_plugins github-swri-robotics-mapviz
swri_geometry_util github-swri-robotics-marti_common
swri_image_util github-swri-robotics-marti_common
swri_opencv_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
naoqi_driver github-ros-naoqi-naoqi_driver
opencv_apps github-ros-perception-opencv_apps
pcdfilter_pa github-peterweissig-ros_pcdfilter
rail_recognition github-GT-RAIL-rail_pick_and_place
robot_calibration github-mikeferguson-robot_calibration
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rqt_image_view github-ros-visualization-rqt_image_view
uavc_v4lctl github-meuchel-uavc_v4lctl
vigir_footstep_planner github-team-vigir-vigir_footstep_planning_core
vigir_footstep_planning_default_plugins github-team-vigir-vigir_footstep_planning_core
evarobot_gazebo github-inomuh-evarobot_simulator

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org

Package Summary

Tags No category tags.
Version 1.10.18
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-perception/vision_opencv.git
VCS Type git
VCS Version groovy-devel
Last Updated 2014-10-28
Dev Status MAINTAINED
Released RELEASED

Package Description

This contains CvBridge, which converts between ROS Image messages and OpenCV images.

Additional Links

Maintainers

  • Vincent Rabaud

Authors

  • Patrick Mihelich
  • James Bowman
README
No README found. No README in repository either.
CHANGELOG

Could not convert RST to MD: No such file or directory - pandoc

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

Name
boost
opencv2

Dependant Packages

Name Repo Deps
agile_grasp github-atenpas-agile_grasp
apriltags_ros github-RIVeR-Lab-apriltags_ros
ar_kinect github-mikeferguson-ar_kinect
ar_pose github-ar-tools-ar_tools
ar_track_alvar github-sniekum-ar_track_alvar
ar_track_alvar github-ros-perception-ar_track_alvar
aruco_ros github-pal-robotics-aruco_ros
baxter_examples github-RethinkRobotics-baxter_examples
baxter_tools github-RethinkRobotics-baxter_tools
image_cb_detector github-ros-perception-calibration
laser_cb_detector github-ros-perception-calibration
cmvision github-utexas-bwi-cmvision
cob_3d_registration github-ipa320-cob_environment_perception
cob_openni2_tracker github-ipa-rmb-cob_people_perception
cob_people_detection github-ipa-rmb-cob_people_perception
cob_image_flip github-ipa320-cob_perception_common
corobot_camera github-morgancormier-corobot
map_to_jpeg github-morgancormier-corobot
cv_camera github-OTL-cv_camera
depthcloud_encoder github-RobotWebTools-depthcloud_encoder
ecto_openni github-plasmodic-ecto_openni
ecto_ros github-plasmodic-ecto_ros
foscam_8918_driver github-tdenewiler-foscam_8918_driver
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gscam github-ros-drivers-gscam
head_pose_estimation github-OSUrobotics-ros-head-tracking
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
hector_heat_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_motion_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_qrcode_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_soft_obstacle_detection github-tu-darmstadt-ros-pkg-hector_vision
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_barrel_geotiff_plugin github-tu-darmstadt-ros-pkg-hector_visualization
hector_rqt_plugins github-tu-darmstadt-ros-pkg-hector_visualization
hrpsys github-start-jsk-hrpsys
camera_calibration github-ros-perception-image_pipeline
depth_image_proc github-ros-perception-image_pipeline
image_proc github-ros-perception-image_pipeline
image_rotate github-ros-perception-image_pipeline
image_view github-ros-perception-image_pipeline
stereo_image_proc github-ros-perception-image_pipeline
compressed_depth_image_transport github-ros-perception-image_transport_plugins
compressed_image_transport github-ros-perception-image_transport_plugins
theora_image_transport github-ros-perception-image_transport_plugins
opt_camera github-jsk-ros-pkg-jsk_3rdparty
image_view2 github-jsk-ros-pkg-jsk_common
jsk_tools github-jsk-ros-pkg-jsk_common
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
checkerboard_detector github-jsk-ros-pkg-jsk_recognition
imagesift github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
resized_image_transport github-jsk-ros-pkg-jsk_recognition
jsk_pr2_startup github-jsk-ros-pkg-jsk_robot
jsk_rqt_plugins github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
mavros_extras github-mavlink-mavros
mjpeg_server github-RobotWebTools-mjpeg_server
moveit_ros_perception github-ros-planning-moveit_ros
multisense_lib bitbucket-crl-multisense_ros
multisense_ros bitbucket-crl-multisense_ros
nerian_sp1 github-nerian-vision-nerian_sp1
object_recognition_renderer github-wg-perception-ork_renderer
opencv_candidate github-wg-perception-opencv_candidate
pal_vision_segmentation github-pal-robotics-pal_vision_segmentation
face_detector github-wg-perception-people
blort_ros github-pal-robotics-perception_blort
ndt_feature_reg github-tstoyanov-perception_oru-release
ndt_map github-tstoyanov-perception_oru-release
sdf_tracker github-tstoyanov-perception_oru-release
checkerboard_pose_estimation github-PR2-pr2_plugs
pr2_plugs_actions github-PR2-pr2_plugs
pr2_gazebo_plugins github-PR2-pr2_simulator
romeo_sensors_py github-ros-aldebaran-romeo_robot
rtabmap github-introlab-rtabmap
rtabmap_ros github-introlab-rtabmap_ros
softkinetic_camera github-ipa320-softkinetic
bag_tools github-srv-srv_tools
pano_core github-turtlebot-turtlebot_apps
pano_py github-turtlebot-turtlebot_apps
pano_ros github-turtlebot-turtlebot_apps
turtlebot_actions github-turtlebot-turtlebot_apps
rgbd_rosbag_tools github-uos-uos_tools
v4r_artoolkitplus github-v4r-tuwien-v4r_ros
v4r_ellipses github-v4r-tuwien-v4r_ros
video_stream_opencv github-ros-drivers-video_stream_opencv
opencv_tests github-ros-perception-vision_opencv
vision_opencv github-ros-perception-vision_opencv
viso2_ros github-srv-viso2
visp_ros github-lagadic-visp_ros
web_video_server github-RobotWebTools-web_video_server
zbar_ros github-clearpathrobotics-zbar_ros
zbar_ros github-ros-drivers-zbar_ros
mapviz_plugins github-swri-robotics-mapviz
swri_image_util github-swri-robotics-marti_common
rgbdslam github-felixendres-rgbdslam_v2
tum_ardrone github-tum-vision-tum_ardrone
tum_ardrone github-thinclab-uga_tum_ardrone

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cv_bridge at answers.ros.org