Show EOL distros:
vision_visp: visp_auto_tracker | visp_bridge | visp_camera_calibration | visp_hand2eye_calibration | visp_tracker
Package Summary
Released
Documented
Converts between ROS structures and ViSP structures.
- Maintainer status: maintained
- Maintainer: Fabien Spindler <Fabien.Spindler AT inria DOT fr>
- Author: Filip Novotny
- License: GPLv2
- Source: git https://github.com/lagadic/vision_visp.git (branch: hydro)
Contents
Description
visp_bridge is a small interface between ViSP library and ROS. For instance it converts between the different data types used by each library. To date, the supported functionnality sums up to:
ViSP vpImage / ROS sensor_msgs::Image conversion
ViSP vpCameraParameter / ROS sensor_msgs::CameraInfo conversion
ViSP vpHomogeneousMatrix / ROS geometry_msgs::Transform conversion
ViSP vpHomogeneousMatrix / ROS geometry_msgs::Pose conversion
For usage, see the code API.
Installation
visp_bridge is part of vision_visp stack.
To install visp_bridge package run
sudo apt-get install ros-hydro-visp-bridge
Or to install the complete stack run
sudo apt-get install ros-hydro-vision-visp