class for Camera video capture for ROS middleware. More...
#include <visp/vpConfig.h>
#include <cv.h>
#include <visp/vpImage.h>
#include <visp/vpFrameGrabber.h>
#include <visp/vpRGBa.h>
#include <ros/ros.h>
#include <sensor_msgs/CompressedImage.h>
#include <sensor_msgs/Image.h>
#include <visp_bridge/camera.h>
#include <image_geometry/pinhole_camera_model.h>
#include <highgui.h>
Go to the source code of this file.
Classes | |
class | vpROSGrabber |
Class for cameras video capture for ROS cameras. More... |
class for Camera video capture for ROS middleware.
Definition in file vpROSGrabber.h.