ROS cv camera driver. More...
#include <driver.h>
Public Member Functions | |
Driver (ros::NodeHandle &private_node, ros::NodeHandle &camera_node) | |
construct with ROS node handles. | |
void | proceed () |
Capture, publish and sleep. | |
void | setup () |
Setup camera device and ROS parameters. | |
~Driver () | |
Private Attributes | |
boost::shared_ptr< Capture > | camera_ |
wrapper of cv::VideoCapture. | |
ros::NodeHandle | camera_node_ |
ROS private node for publishing images. | |
ros::NodeHandle | private_node_ |
ROS private node for getting ROS parameters. | |
boost::shared_ptr< ros::Rate > | rate_ |
publishing rate. |
ROS cv camera driver.
This wraps getting parameters and publish in specified rate.
cv_camera::Driver::Driver | ( | ros::NodeHandle & | private_node, |
ros::NodeHandle & | camera_node | ||
) |
construct with ROS node handles.
use private_node for getting topics like ~rate or ~device, camera_node for advertise and publishing images.
private_node | node for getting parameters. |
camera_node | node for publishing. |
Definition at line 12 of file driver.cpp.
Definition at line 63 of file driver.cpp.
void cv_camera::Driver::proceed | ( | ) |
Capture, publish and sleep.
Definition at line 56 of file driver.cpp.
void cv_camera::Driver::setup | ( | ) |
Setup camera device and ROS parameters.
cv_camera::DeviceError | device open failed. |
Definition at line 19 of file driver.cpp.
boost::shared_ptr<Capture> cv_camera::Driver::camera_ [private] |
boost::shared_ptr<ros::Rate> cv_camera::Driver::rate_ [private] |