3 #ifndef CV_CAMERA_DRIVER_H     4 #define CV_CAMERA_DRIVER_H    64 #endif  // CV_CAMERA_DRIVER_H 
boost::shared_ptr< ros::Rate > rate_
publishing rate. 
ros::NodeHandle camera_node_
ROS private node for publishing images. 
ros::NodeHandle private_node_
ROS private node for getting ROS parameters. 
Driver(ros::NodeHandle &private_node, ros::NodeHandle &camera_node)
construct with ROS node handles. 
namespace of this package 
void proceed()
Capture, publish and sleep. 
boost::shared_ptr< Capture > camera_
wrapper of cv::VideoCapture. 
void setup()
Setup camera device and ROS parameters.