▼Npilz_industrial_motion_testutils | |
▼Nintegration_test_utils | |
CMoveThread | |
▼Nrobot_motion_observer | |
CRobotMotionObserver | |
▼Nxml_testdata_loader | |
CXmlTestdataLoader | |
CBaseCmd | |
CCartesianConfiguration | Class to define a robot configuration in space with the help of cartesian coordinates |
CCartesianPathConstraintsBuilder | Helper class to build moveit_msgs::Constraints from a given configuration |
CCenter | Class to define the center point of the circle on which the robot is supposed to move via circ command |
CCirc | Data class storing all information regarding a Circ command |
CCircAuxiliary | Base class to define an auxiliary point needed to specify circ commands |
CCmdGetterAdapter | |
CCmdReader | |
CGoalConstraintMsgConvertible | Interface class to express that a derived class can be converted into a moveit_msgs::Constaints |
CGripper | |
CInterim | Class to define a point on the circle on which the robot is supposed to move via circ command |
CJointConfiguration | Class to define a robot configuration in space with the help of joint values |
CJointConfigurationException | |
CLin | Data class storing all information regarding a linear command |
CMotionCmd | Base class for commands storing all general information of a command |
CMotionPlanRequestConvertible | Interface class to express that a derived class can be converted into a planning_interface::MotionPlanRequest |
CPtp | Data class storing all information regarding a Ptp command |
CRobotConfiguration | Class to define robot configuration in space |
CRobotStateMsgConvertible | Interface class to express that a derived class can be converted into a moveit_msgs::RobotState |
CSequence | Data class storing all information regarding a Sequence command |
CTestdataLoader | Abstract base class describing the interface to access test data like robot poses and robot commands |
CTestDataLoaderReadingException | |
CToBaseVisitor | Visitor returning not the specific command type but the base type |
CToReqVisitor | Visitor transforming the stored command into a MotionPlanRequest |
▼CXmlTestdataLoader | Implements a test data loader which uses a xml file to store the test data |
CAbstractCmdGetterAdapter | Abstract base class providing a GENERIC getter-function signature which can be used to load DIFFERENT command types (like Ptp, Lin, etc.) from the test data file |