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.h>
#include <gtest/gtest.h>
#include <gmock/gmock-matchers.h>
#include <sstream>
#include <algorithm>
#include <limits>
#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

static void expect_near (const Eigen::MatrixXd &x, const Eigen::MatrixXd &y, double eps=std::numeric_limits< double >::epsilon())
 
int main (int argc, char **argv)
 
 TEST (Init, FixedJoints)
 
 TEST (Loading, SimpleRobot)
 
 TEST (LoadingAndFK, SimpleRobot)
 
 TEST_F (OneRobot, FK)
 
 TEST_F (OneRobot, rigidlyConnectedParent)
 
 TEST_F (OneRobot, testInterpolation)
 
 TEST_F (OneRobot, testPrintCurrentPositionWithJointLimits)
 

Macro Definition Documentation

◆ EXPECT_NEAR_TRACED

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

Definition at line 91 of file robot_state_test.cpp.

Function Documentation

◆ expect_near()

static void expect_near ( const Eigen::MatrixXd &  x,
const Eigen::MatrixXd &  y,
double  eps = std::numeric_limits<double>::epsilon() 
)
static

Definition at line 80 of file robot_state_test.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 755 of file robot_state_test.cpp.

◆ TEST() [1/3]

TEST ( Init  ,
FixedJoints   
)

Definition at line 186 of file robot_state_test.cpp.

◆ TEST() [2/3]

TEST ( Loading  ,
SimpleRobot   
)

Definition at line 97 of file robot_state_test.cpp.

◆ TEST() [3/3]

TEST ( LoadingAndFK  ,
SimpleRobot   
)

Definition at line 125 of file robot_state_test.cpp.

◆ TEST_F() [1/4]

TEST_F ( OneRobot  ,
FK   
)

Definition at line 432 of file robot_state_test.cpp.

◆ TEST_F() [2/4]

TEST_F ( OneRobot  ,
rigidlyConnectedParent   
)

Definition at line 696 of file robot_state_test.cpp.

◆ TEST_F() [3/4]

TEST_F ( OneRobot  ,
testInterpolation   
)

Definition at line 589 of file robot_state_test.cpp.

◆ TEST_F() [4/4]

TEST_F ( OneRobot  ,
testPrintCurrentPositionWithJointLimits   
)

Definition at line 561 of file robot_state_test.cpp.



moveit_core
Author(s): Ioan Sucan , Sachin Chitta , Acorn Pooley
autogenerated on Sun Mar 3 2024 03:23:36