#include <gtest/gtest.h>
#include <tf2/utils.h>
#include <tf2_kdl/tf2_kdl.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <ros/time.h>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
TEST (tf2Utils, yaw) | |
TEST (tf2Utils, identity) | |
template<typename T > | |
void | yprTest (const T &t, double yaw1, double pitch1, double roll1) |
Variables | |
double | epsilon = 1e-9 |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 94 of file test_utils.cpp.
TEST | ( | tf2Utils | , |
yaw | |||
) |
Definition at line 35 of file test_utils.cpp.
TEST | ( | tf2Utils | , |
identity | |||
) |
Definition at line 71 of file test_utils.cpp.
Definition at line 24 of file test_utils.cpp.
double epsilon = 1e-9 |
Definition at line 21 of file test_utils.cpp.