Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
DepthCameraTest Class Reference
Inheritance diagram for DepthCameraTest:
Inheritance graph
[legend]

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_
 

Detailed Description

Definition at line 6 of file depth_camera.cpp.

Member Function Documentation

◆ depthCallback()

void DepthCameraTest::depthCallback ( const sensor_msgs::ImageConstPtr &  msg)
inline

Definition at line 32 of file depth_camera.cpp.

◆ imageCallback()

void DepthCameraTest::imageCallback ( const sensor_msgs::ImageConstPtr &  msg)
inline

Definition at line 27 of file depth_camera.cpp.

◆ pointsCallback()

void DepthCameraTest::pointsCallback ( const sensor_msgs::PointCloud2ConstPtr &  msg)
inline

Definition at line 37 of file depth_camera.cpp.

◆ SetUp()

virtual void DepthCameraTest::SetUp ( )
inlineprotectedvirtual

Definition at line 9 of file depth_camera.cpp.

Member Data Documentation

◆ cam_sub_

image_transport::Subscriber DepthCameraTest::cam_sub_
protected

Definition at line 17 of file depth_camera.cpp.

◆ depth_stamp_

ros::Time DepthCameraTest::depth_stamp_
protected

Definition at line 23 of file depth_camera.cpp.

◆ depth_sub_

image_transport::Subscriber DepthCameraTest::depth_sub_
protected

Definition at line 18 of file depth_camera.cpp.

◆ has_new_depth_

bool DepthCameraTest::has_new_depth_
protected

Definition at line 22 of file depth_camera.cpp.

◆ has_new_image_

bool DepthCameraTest::has_new_image_
protected

Definition at line 20 of file depth_camera.cpp.

◆ has_new_points_

bool DepthCameraTest::has_new_points_
protected

Definition at line 24 of file depth_camera.cpp.

◆ image_stamp_

ros::Time DepthCameraTest::image_stamp_
protected

Definition at line 21 of file depth_camera.cpp.

◆ nh_

ros::NodeHandle DepthCameraTest::nh_
protected

Definition at line 16 of file depth_camera.cpp.

◆ points_stamp_

ros::Time DepthCameraTest::points_stamp_
protected

Definition at line 25 of file depth_camera.cpp.

◆ points_sub_

ros::Subscriber DepthCameraTest::points_sub_
protected

Definition at line 19 of file depth_camera.cpp.


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


gazebo_plugins
Author(s): John Hsu
autogenerated on Thu Sep 5 2024 02:49:55