#include "transform_graph/position.h"
#include <gtest/gtest.h>
#include "geometry_msgs/Point.h"
#include "geometry_msgs/Vector3.h"
#include "pcl/point_types.h"
#include "tf/transform_datatypes.h"
#include "Eigen/Dense"
Go to the source code of this file.
Namespaces | |
namespace | transform_graph |
Functions | |
int | main (int argc, char **argv) |
transform_graph::TEST (TestPosition, Identity) | |
transform_graph::TEST (TestPosition, TestXyz) | |
transform_graph::TEST (TestPosition, TestEigen) | |
transform_graph::TEST (TestPosition, TestPoint) | |
transform_graph::TEST (TestPosition, TestGeoVector) | |
transform_graph::TEST (TestPosition, TestPclXyz) | |
transform_graph::TEST (TestPosition, TestTfVector) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 76 of file position_test.cpp.