moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Macros | Functions
robot_state_test.cpp File Reference
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/utils/robot_model_test_utils.h>
#include <urdf_parser/urdf_parser.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
#include <gtest/gtest.h>
#include <sstream>
#include <algorithm>
#include <ctype.h>
Include dependency graph for robot_state_test.cpp:

Go to the source code of this file.

Classes

class  OneRobot
 

Macros

#define EXPECT_NEAR_TRACED(...)
 

Functions

 TEST (Loading, SimpleRobot)
 
 TEST (LoadingAndFK, SimpleRobot)
 
 TEST_F (OneRobot, FK)
 
 TEST_F (OneRobot, testPrintCurrentPositionWithJointLimits)
 
 TEST_F (OneRobot, testInterpolation)
 
 TEST_F (OneRobot, rigidlyConnectedParent)
 
int main (int argc, char **argv)
 

Macro Definition Documentation

◆ EXPECT_NEAR_TRACED

#define EXPECT_NEAR_TRACED (   ...)
Value:
{ \
SCOPED_TRACE("expect_near(" #__VA_ARGS__ ")"); \
expect_near(__VA_ARGS__); \
}

Definition at line 89 of file robot_state_test.cpp.

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 715 of file robot_state_test.cpp.

◆ TEST() [1/2]

TEST ( Loading  ,
SimpleRobot   
)

Definition at line 95 of file robot_state_test.cpp.

Here is the call graph for this function:

◆ TEST() [2/2]

TEST ( LoadingAndFK  ,
SimpleRobot   
)

Definition at line 123 of file robot_state_test.cpp.

Here is the call graph for this function:

◆ TEST_F() [1/4]

TEST_F ( OneRobot  ,
FK   
)

Definition at line 384 of file robot_state_test.cpp.

Here is the call graph for this function:

◆ TEST_F() [2/4]

TEST_F ( OneRobot  ,
rigidlyConnectedParent   
)

Definition at line 682 of file robot_state_test.cpp.

Here is the call graph for this function:

◆ TEST_F() [3/4]

TEST_F ( OneRobot  ,
testInterpolation   
)

Definition at line 576 of file robot_state_test.cpp.

Here is the call graph for this function:

◆ TEST_F() [4/4]

TEST_F ( OneRobot  ,
testPrintCurrentPositionWithJointLimits   
)

Definition at line 548 of file robot_state_test.cpp.

Here is the call graph for this function: