conversions between ROS and ViSP structures representing camera parameters More...
#include <visp/vpCameraParameters.h>#include <sensor_msgs/CameraInfo.h>

Go to the source code of this file.
| Namespaces | |
| visp_bridge | |
| Functions | |
| sensor_msgs::CameraInfo | visp_bridge::toSensorMsgsCameraInfo (vpCameraParameters &cam_info, unsigned int cam_image_width, unsigned int cam_image_height) | 
| Converts ViSP camera parameters (vpCameraParameters) to sensor_msgs::CameraInfo.  More... | |
| vpCameraParameters | visp_bridge::toVispCameraParameters (const sensor_msgs::CameraInfo &cam_info) | 
| Converts a sensor_msgs::CameraInfo to ViSP camera parameters (vpCameraParameters).  More... | |
conversions between ROS and ViSP structures representing camera parameters
Definition in file camera.h.