Public Member Functions | |
TangoRosTest () | |
Protected Member Functions | |
virtual void | SetUp () |
Private Member Functions | |
void | ColorImageCallback (const sensor_msgs::ImageConstPtr &image) |
void | FisheyeImageCallback (const sensor_msgs::ImageConstPtr &image) |
void | PointCloudCallback (const boost::shared_ptr< const sensor_msgs::PointCloud2 > msg) |
void | TfCallback (const boost::shared_ptr< const tf2_msgs::TFMessage > msg) |
Definition at line 34 of file test_tango_ros_msg.cpp.
|
inline |
Definition at line 53 of file test_tango_ros_msg.cpp.
|
inlineprivate |
Definition at line 95 of file test_tango_ros_msg.cpp.
|
inlineprivate |
Definition at line 90 of file test_tango_ros_msg.cpp.
|
inlineprivate |
Definition at line 85 of file test_tango_ros_msg.cpp.
|
inlineprotectedvirtual |
Definition at line 59 of file test_tango_ros_msg.cpp.
|
inlineprivate |
Definition at line 80 of file test_tango_ros_msg.cpp.
int TangoRosTest::color_image_message_count_ |
Definition at line 51 of file test_tango_ros_msg.cpp.
bool TangoRosTest::color_image_received_ |
Definition at line 46 of file test_tango_ros_msg.cpp.
int TangoRosTest::fisheye_image_message_count_ |
Definition at line 50 of file test_tango_ros_msg.cpp.
bool TangoRosTest::fisheye_image_received_ |
Definition at line 45 of file test_tango_ros_msg.cpp.
ros::NodeHandle TangoRosTest::nh_ |
Definition at line 36 of file test_tango_ros_msg.cpp.
int TangoRosTest::point_cloud_message_count_ |
Definition at line 49 of file test_tango_ros_msg.cpp.
bool TangoRosTest::point_cloud_received_ |
Definition at line 44 of file test_tango_ros_msg.cpp.
image_transport::Subscriber TangoRosTest::sub_color_image_ |
Definition at line 41 of file test_tango_ros_msg.cpp.
image_transport::Subscriber TangoRosTest::sub_fisheye_image_ |
Definition at line 40 of file test_tango_ros_msg.cpp.
ros::Subscriber TangoRosTest::sub_point_cloud_ |
Definition at line 39 of file test_tango_ros_msg.cpp.
ros::Subscriber TangoRosTest::sub_tf_ |
Definition at line 38 of file test_tango_ros_msg.cpp.
tf::TransformListener TangoRosTest::tf_listener_ |
Definition at line 37 of file test_tango_ros_msg.cpp.
int TangoRosTest::tf_message_count_ |
Definition at line 48 of file test_tango_ros_msg.cpp.
bool TangoRosTest::tf_message_received_ |
Definition at line 43 of file test_tango_ros_msg.cpp.