#include <time.h>
#include <gtest/gtest.h>
#include <image_transport/image_transport.h>
#include <ros/ros.h>
#include <sensor_msgs/CompressedImage.h>
#include <sensor_msgs/PointCloud2.h>
#include <tango_ros_native/tango_ros_nodelet.h>
#include <tf/transform_listener.h>
#include <tf2_msgs/TFMessage.h>
Go to the source code of this file.
Classes | |
class | TangoRosTest |
Functions | |
int | main (int argc, char **argv) |
TEST_F (TangoRosTest, TestMessagesArePublished) | |
TEST_F (TangoRosTest, TestMessageRates) | |
Variables | |
constexpr double | COLOR_IMAGE_RATE = 8. |
constexpr double | DURATION_RATE_TEST = 10 |
constexpr double | FISHEYE_IMAGE_RATE = 25. |
constexpr double | POINT_CLOUD_RATE = 4. |
constexpr double | RATE_TOLERANCE_RATIO = 0.2 |
constexpr int | SLEEP_TIME_UNTIL_FIRST_MESSAGE = 2 |
constexpr double | TF_RATE = 150. |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 141 of file test_tango_ros_msg.cpp.
TEST_F | ( | TangoRosTest | , |
TestMessagesArePublished | |||
) |
Definition at line 101 of file test_tango_ros_msg.cpp.
TEST_F | ( | TangoRosTest | , |
TestMessageRates | |||
) |
Definition at line 123 of file test_tango_ros_msg.cpp.
constexpr double COLOR_IMAGE_RATE = 8. |
Definition at line 28 of file test_tango_ros_msg.cpp.
constexpr double DURATION_RATE_TEST = 10 |
Definition at line 32 of file test_tango_ros_msg.cpp.
constexpr double FISHEYE_IMAGE_RATE = 25. |
Definition at line 27 of file test_tango_ros_msg.cpp.
constexpr double POINT_CLOUD_RATE = 4. |
Definition at line 26 of file test_tango_ros_msg.cpp.
constexpr double RATE_TOLERANCE_RATIO = 0.2 |
Definition at line 29 of file test_tango_ros_msg.cpp.
constexpr int SLEEP_TIME_UNTIL_FIRST_MESSAGE = 2 |
Definition at line 31 of file test_tango_ros_msg.cpp.
constexpr double TF_RATE = 150. |
Definition at line 25 of file test_tango_ros_msg.cpp.