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