#include <string>
#include <ros/ros.h>
#include <geometry_msgs/TransformStamped.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <gtest/gtest.h>
Go to the source code of this file.
Classes | |
class | TfProjectionTest |
Functions | |
INSTANTIATE_TEST_CASE_P (ProjectionTransformInstance, TfProjectionTest,::testing::Values("base_link_projected","base_link_projected2","base_link_tilt_projected")) | |
int | main (int argc, char **argv) |
TEST_P (TfProjectionTest, ProjectionTransform) |
INSTANTIATE_TEST_CASE_P | ( | ProjectionTransformInstance | , |
TfProjectionTest | , | ||
::testing:: | Values"base_link_projected","base_link_projected2","base_link_tilt_projected" | ||
) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 88 of file test_tf_projection_node.cpp.
TEST_P | ( | TfProjectionTest | , |
ProjectionTransform | |||
) |
Definition at line 57 of file test_tf_projection_node.cpp.