Public Member Functions | Private Attributes | List of all members
cv_camera::Driver Class Reference

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. More...
 
void proceed ()
 Capture, publish and sleep. More...
 
void setup ()
 Setup camera device and ROS parameters. More...
 
 ~Driver ()
 

Private Attributes

boost::shared_ptr< Capturecamera_
 wrapper of cv::VideoCapture. More...
 
ros::NodeHandle camera_node_
 ROS private node for publishing images. More...
 
ros::NodeHandle private_node_
 ROS private node for getting ROS parameters. More...
 
boost::shared_ptr< ros::Raterate_
 publishing rate. More...
 

Detailed Description

ROS cv camera driver.

This wraps getting parameters and publish in specified rate.

Definition at line 16 of file driver.h.

Constructor & Destructor Documentation

◆ Driver()

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.

Parameters
private_nodenode for getting parameters.
camera_nodenode for publishing.

Definition at line 15 of file driver.cpp.

◆ ~Driver()

cv_camera::Driver::~Driver ( )

Definition at line 109 of file driver.cpp.

Member Function Documentation

◆ proceed()

void cv_camera::Driver::proceed ( )

Capture, publish and sleep.

Definition at line 100 of file driver.cpp.

◆ setup()

void cv_camera::Driver::setup ( )

Setup camera device and ROS parameters.

Exceptions
cv_camera::DeviceErrordevice open failed.

Definition at line 21 of file driver.cpp.

Member Data Documentation

◆ camera_

boost::shared_ptr<Capture> cv_camera::Driver::camera_
private

wrapper of cv::VideoCapture.

Definition at line 54 of file driver.h.

◆ camera_node_

ros::NodeHandle cv_camera::Driver::camera_node_
private

ROS private node for publishing images.

Definition at line 50 of file driver.h.

◆ private_node_

ros::NodeHandle cv_camera::Driver::private_node_
private

ROS private node for getting ROS parameters.

Definition at line 46 of file driver.h.

◆ rate_

boost::shared_ptr<ros::Rate> cv_camera::Driver::rate_
private

publishing rate.

Definition at line 59 of file driver.h.


The documentation for this class was generated from the following files:


cv_camera
Author(s): Takashi Ogura
autogenerated on Mon Feb 28 2022 22:12:06