Public Member Functions | |
void | imageCallback (const sensor_msgs::ImageConstPtr &msg) |
Protected Member Functions | |
virtual void | SetUp () |
Protected Attributes | |
image_transport::Subscriber | cam_sub_ |
bool | has_new_image_ |
ros::Time | image_stamp_ |
ros::NodeHandle | nh_ |
Definition at line 5 of file camera.cpp.
void CameraTest::imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 18 of file camera.cpp.
virtual void CameraTest::SetUp | ( | ) | [inline, protected, virtual] |
Definition at line 8 of file camera.cpp.
image_transport::Subscriber CameraTest::cam_sub_ [protected] |
Definition at line 14 of file camera.cpp.
bool CameraTest::has_new_image_ [protected] |
Definition at line 15 of file camera.cpp.
ros::Time CameraTest::image_stamp_ [protected] |
Definition at line 16 of file camera.cpp.
ros::NodeHandle CameraTest::nh_ [protected] |
Definition at line 13 of file camera.cpp.