|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|


Protected Member Functions | |
| void | SetUp () override |
| void | initializeWithURDF (const std::filesystem::path &urdf) |
| void | initializeWithFanuc () |
| void | generateXML (const std::string &robot_name="fanuc") |
Protected Member Functions inherited from moveit_setup::MoveItSetupTest | |
| void | SetUp () override |
| Initialize the node, DataWarehouse and output dir. | |
| template<typename T > | |
| void | generateFiles (const std::string &config_name) |
| Helper function for generating all the files for a particular config to a temporary directory. | |
| void | initializeStep (SetupStep &setup_step) |
| void | TearDown () override |
| Clean up by removing all files when complete. | |
Protected Attributes | |
| std::shared_ptr< SRDFConfig > | srdf_config_ |
| tinyxml2::XMLDocument | srdf_xml_ |
Protected Attributes inherited from moveit_setup::MoveItSetupTest | |
| rclcpp::Node::SharedPtr | node_ |
| moveit_setup::DataWarehousePtr | config_data_ |
| std::filesystem::path | output_dir_ |
| moveit_setup::GeneratedTime | placeholder_timestamp_ |
| bool | delete_when_finished_ { true } |
Definition at line 45 of file test_srdf.cpp.
|
inlineprotected |
Definition at line 65 of file test_srdf.cpp.
|
inlineprotected |
|
inlineprotected |
|
inlineoverrideprotected |
Definition at line 48 of file test_srdf.cpp.
|
protected |
Definition at line 74 of file test_srdf.cpp.
|
protected |
Definition at line 75 of file test_srdf.cpp.