moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Protected Member Functions | Protected Attributes | List of all members
SRDFTest Class Reference
Inheritance diagram for SRDFTest:
Inheritance graph
[legend]
Collaboration diagram for SRDFTest:
Collaboration graph
[legend]

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< SRDFConfigsrdf_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 }
 

Detailed Description

Definition at line 45 of file test_srdf.cpp.

Member Function Documentation

◆ generateXML()

void SRDFTest::generateXML ( const std::string &  robot_name = "fanuc")
inlineprotected

Definition at line 65 of file test_srdf.cpp.

◆ initializeWithFanuc()

void SRDFTest::initializeWithFanuc ( )
inlineprotected

Definition at line 60 of file test_srdf.cpp.

Here is the call graph for this function:

◆ initializeWithURDF()

void SRDFTest::initializeWithURDF ( const std::filesystem::path &  urdf)
inlineprotected

Definition at line 54 of file test_srdf.cpp.

Here is the caller graph for this function:

◆ SetUp()

void SRDFTest::SetUp ( )
inlineoverrideprotected

Definition at line 48 of file test_srdf.cpp.

Member Data Documentation

◆ srdf_config_

std::shared_ptr<SRDFConfig> SRDFTest::srdf_config_
protected

Definition at line 74 of file test_srdf.cpp.

◆ srdf_xml_

tinyxml2::XMLDocument SRDFTest::srdf_xml_
protected

Definition at line 75 of file test_srdf.cpp.


The documentation for this class was generated from the following file: