▼Cpilz_industrial_motion_testutils::XmlTestdataLoader::AbstractCmdGetterAdapter | 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 |
Cpilz_industrial_motion_testutils::CmdGetterAdapter< CmdType > | |
Cpilz_industrial_motion_testutils::CartesianPathConstraintsBuilder | Helper class to build moveit_msgs::Constraints from a given configuration |
▼Cpilz_industrial_motion_testutils::CircAuxiliary< ConfigType, BuilderType > | Base class to define an auxiliary point needed to specify circ commands |
Cpilz_industrial_motion_testutils::Center< ConfigType, BuilderType > | Class to define the center point of the circle on which the robot is supposed to move via circ command |
Cpilz_industrial_motion_testutils::Interim< ConfigType, BuilderType > | Class to define a point on the circle on which the robot is supposed to move via circ command |
Cpilz_industrial_motion_testutils::CmdReader | |
▼Cpilz_industrial_motion_testutils::GoalConstraintMsgConvertible | Interface class to express that a derived class can be converted into a moveit_msgs::Constaints |
▼Cpilz_industrial_motion_testutils::RobotConfiguration | Class to define robot configuration in space |
Cpilz_industrial_motion_testutils::CartesianConfiguration | Class to define a robot configuration in space with the help of cartesian coordinates |
Cpilz_industrial_motion_testutils::JointConfiguration | Class to define a robot configuration in space with the help of joint values |
▼Cpilz_industrial_motion_testutils::MotionPlanRequestConvertible | Interface class to express that a derived class can be converted into a planning_interface::MotionPlanRequest |
▼Cpilz_industrial_motion_testutils::MotionCmd | Base class for commands storing all general information of a command |
▼Cpilz_industrial_motion_testutils::BaseCmd< JointConfiguration, JointConfiguration > | |
▼Cpilz_industrial_motion_testutils::Ptp< JointConfiguration, JointConfiguration > | |
Cpilz_industrial_motion_testutils::Gripper | |
▼Cpilz_industrial_motion_testutils::BaseCmd< StartType, GoalType > | |
Cpilz_industrial_motion_testutils::Circ< StartType, AuxiliaryType, GoalType > | Data class storing all information regarding a Circ command |
Cpilz_industrial_motion_testutils::Lin< StartType, GoalType > | Data class storing all information regarding a linear command |
Cpilz_industrial_motion_testutils::Ptp< StartType, GoalType > | Data class storing all information regarding a Ptp command |
▼Cobject | |
Cpilz_industrial_motion_testutils.robot_motion_observer.RobotMotionObserver | |
▼Cpilz_industrial_motion_testutils::RobotStateMsgConvertible | Interface class to express that a derived class can be converted into a moveit_msgs::RobotState |
Cpilz_industrial_motion_testutils::RobotConfiguration | Class to define robot configuration in space |
▼Cruntime_error | |
Cpilz_industrial_motion_testutils::JointConfigurationException | |
Cpilz_industrial_motion_testutils::TestDataLoaderReadingException | |
Cpilz_industrial_motion_testutils::Sequence | Data class storing all information regarding a Sequence command |
▼Cstatic_visitor | |
Cpilz_industrial_motion_testutils::ToBaseVisitor | Visitor returning not the specific command type but the base type |
Cpilz_industrial_motion_testutils::ToReqVisitor | Visitor transforming the stored command into a MotionPlanRequest |
▼Cpilz_industrial_motion_testutils::TestdataLoader | Abstract base class describing the interface to access test data like robot poses and robot commands |
Cpilz_industrial_motion_testutils::XmlTestdataLoader | Implements a test data loader which uses a xml file to store the test data |
▼CThread | |
Cpilz_industrial_motion_testutils.integration_test_utils.MoveThread | |
Cpilz_industrial_motion_testutils.xml_testdata_loader.XmlTestdataLoader | |