#include "transform_graph/graph.h"
#include <string>
#include "Eigen/Dense"
#include "geometry_msgs/Point.h"
#include "geometry_msgs/Pose.h"
#include "gtest/gtest.h"
Go to the source code of this file.
Namespaces | |
namespace | transform_graph |
Functions | |
int | main (int argc, char **argv) |
transform_graph::TEST (TestGraph, InitiallyEmpty) | |
transform_graph::TEST (TestGraph, SimpleConnection) | |
transform_graph::TEST (TestGraph, SelfTarget) | |
transform_graph::TEST (TestGraph, LinkedList) | |
transform_graph::TEST (TestGraph, DisconnectedSuccess) | |
transform_graph::TEST (TestGraph, DisconnectedFail) | |
transform_graph::TEST (TestGraph, SelfTargetIsIdentity) | |
transform_graph::TEST (TestGraph, SimpleTranslationDescription) | |
transform_graph::TEST (TestGraph, SimpleOrientationDescription) | |
transform_graph::TEST (TestGraph, TranslationChainDescription) | |
transform_graph::TEST (TestGraph, OrientationChainDescription) | |
transform_graph::TEST (TestGraph, InverseDescription) | |
transform_graph::TEST (TestGraph, DescribePoint) | |
transform_graph::TEST (TestGraph, DescribePose) | |
transform_graph::TEST (TestGraph, ComputeSimpleMapping) | |
transform_graph::TEST (TestGraph, SimpleMapPosition) | |
transform_graph::TEST (TestGraph, MapPose) | |
transform_graph::TEST (TestGraph, ComputeMappingBetweenRotatedFrames) | |
transform_graph::TEST (TestGraph, MapPositionBetweenRotatedFrames) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 429 of file graph_test.cpp.