Public Member Functions | |
void | depthCallback (const sensor_msgs::ImageConstPtr &msg) |
void | imageCallback (const sensor_msgs::ImageConstPtr &msg) |
void | pointsCallback (const sensor_msgs::PointCloud2ConstPtr &msg) |
Protected Member Functions | |
virtual void | SetUp () |
Protected Attributes | |
image_transport::Subscriber | cam_sub_ |
ros::Time | depth_stamp_ |
image_transport::Subscriber | depth_sub_ |
bool | has_new_depth_ |
bool | has_new_image_ |
bool | has_new_points_ |
ros::Time | image_stamp_ |
ros::NodeHandle | nh_ |
ros::Time | points_stamp_ |
ros::Subscriber | points_sub_ |
Definition at line 6 of file depth_camera.cpp.
void DepthCameraTest::depthCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 32 of file depth_camera.cpp.
void DepthCameraTest::imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline] |
Definition at line 27 of file depth_camera.cpp.
void DepthCameraTest::pointsCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | msg | ) | [inline] |
Definition at line 37 of file depth_camera.cpp.
virtual void DepthCameraTest::SetUp | ( | ) | [inline, protected, virtual] |
Definition at line 9 of file depth_camera.cpp.
image_transport::Subscriber DepthCameraTest::cam_sub_ [protected] |
Definition at line 17 of file depth_camera.cpp.
ros::Time DepthCameraTest::depth_stamp_ [protected] |
Definition at line 23 of file depth_camera.cpp.
Definition at line 18 of file depth_camera.cpp.
bool DepthCameraTest::has_new_depth_ [protected] |
Definition at line 22 of file depth_camera.cpp.
bool DepthCameraTest::has_new_image_ [protected] |
Definition at line 20 of file depth_camera.cpp.
bool DepthCameraTest::has_new_points_ [protected] |
Definition at line 24 of file depth_camera.cpp.
ros::Time DepthCameraTest::image_stamp_ [protected] |
Definition at line 21 of file depth_camera.cpp.
ros::NodeHandle DepthCameraTest::nh_ [protected] |
Definition at line 16 of file depth_camera.cpp.
ros::Time DepthCameraTest::points_stamp_ [protected] |
Definition at line 25 of file depth_camera.cpp.
ros::Subscriber DepthCameraTest::points_sub_ [protected] |
Definition at line 19 of file depth_camera.cpp.