| 
    moveit2
    
   The MoveIt Motion Planning Framework for ROS 2. 
   | 
 
Abstract base class describing the interface to access test data like robot poses and robot commands. More...
#include <testdata_loader.h>

Public Member Functions | |
| TestdataLoader ()=default | |
| TestdataLoader (moveit::core::RobotModelConstPtr robot_model) | |
| TestdataLoader (const TestdataLoader &)=default | |
| TestdataLoader (TestdataLoader &&)=default | |
| TestdataLoader & | operator= (const TestdataLoader &)=default | 
| TestdataLoader & | operator= (TestdataLoader &&)=default | 
| virtual | ~TestdataLoader ()=default | 
| void | setRobotModel (moveit::core::RobotModelConstPtr robot_model) | 
| virtual JointConfiguration | getJoints (const std::string &pos_name, const std::string &group_name) const =0 | 
| virtual CartesianConfiguration | getPose (const std::string &pos_name, const std::string &group_name) const =0 | 
| virtual PtpJoint | getPtpJoint (const std::string &cmd_name) const =0 | 
| Returns the command with the specified name from the test data.  More... | |
| virtual PtpCart | getPtpCart (const std::string &cmd_name) const =0 | 
| virtual PtpJointCart | getPtpJointCart (const std::string &cmd_name) const =0 | 
| virtual LinJoint | getLinJoint (const std::string &cmd_name) const =0 | 
| Returns the command with the specified name from the test data.  More... | |
| virtual LinCart | getLinCart (const std::string &cmd_name) const =0 | 
| virtual LinJointCart | getLinJointCart (const std::string &cmd_name) const =0 | 
| virtual CircCenterCart | getCircCartCenterCart (const std::string &cmd_name) const =0 | 
| Returns the command with the specified name from the test data.  More... | |
| virtual CircJointCenterCart | getCircJointCenterCart (const std::string &cmd_name) const =0 | 
| virtual CircInterimCart | getCircCartInterimCart (const std::string &cmd_name) const =0 | 
| virtual CircJointInterimCart | getCircJointInterimCart (const std::string &cmd_name) const =0 | 
| virtual Sequence | getSequence (const std::string &cmd_name) const =0 | 
| Returns the command with the specified name from the test data.  More... | |
| virtual Gripper | getGripper (const std::string &cmd_name) const =0 | 
| Returns the command with the specified name from the test data.  More... | |
Protected Attributes | |
| moveit::core::RobotModelConstPtr | robot_model_ | 
Abstract base class describing the interface to access test data like robot poses and robot commands.
Definition at line 54 of file testdata_loader.h.
      
  | 
  default | 
      
  | 
  inline | 
Definition at line 59 of file testdata_loader.h.
      
  | 
  default | 
      
  | 
  default | 
      
  | 
  virtualdefault | 
      
  | 
  pure virtual | 
Returns the command with the specified name from the test data.
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Returns the command with the specified name from the test data.
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Returns the command with the specified name from the test data.
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Returns the command with the specified name from the test data.
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  pure virtual | 
Returns the command with the specified name from the test data.
Implemented in pilz_industrial_motion_planner_testutils::XmlTestdataLoader.
      
  | 
  default | 
      
  | 
  default | 
      
  | 
  inline | 
      
  | 
  protected | 
Definition at line 109 of file testdata_loader.h.