Public Member Functions | Protected Attributes | List of all members
pilz_industrial_motion_testutils::RobotConfiguration Class Reference

Class to define robot configuration in space. More...

#include <robotconfiguration.h>

Inheritance diagram for pilz_industrial_motion_testutils::RobotConfiguration:
Inheritance graph
[legend]

Public Member Functions

void clearModel ()
 
std::string getGroupName () const
 
 RobotConfiguration ()
 
 RobotConfiguration (const std::string &group_name)
 
 RobotConfiguration (const std::string &group_name, const moveit::core::RobotModelConstPtr &robot_model)
 
void setGroupName (const std::string &group_name)
 
void setRobotModel (moveit::core::RobotModelConstPtr robot_model)
 
- Public Member Functions inherited from pilz_industrial_motion_testutils::RobotStateMsgConvertible
virtual moveit_msgs::RobotState toMoveitMsgsRobotState () const =0
 
- Public Member Functions inherited from pilz_industrial_motion_testutils::GoalConstraintMsgConvertible
virtual moveit_msgs::Constraints toGoalConstraints () const =0
 

Protected Attributes

std::string group_name_
 
moveit::core::RobotModelConstPtr robot_model_
 

Detailed Description

Class to define robot configuration in space.

Definition at line 32 of file robotconfiguration.h.

Constructor & Destructor Documentation

◆ RobotConfiguration() [1/3]

pilz_industrial_motion_testutils::RobotConfiguration::RobotConfiguration ( )

Definition at line 23 of file robotconfiguration.cpp.

◆ RobotConfiguration() [2/3]

pilz_industrial_motion_testutils::RobotConfiguration::RobotConfiguration ( const std::string &  group_name)

Definition at line 27 of file robotconfiguration.cpp.

◆ RobotConfiguration() [3/3]

pilz_industrial_motion_testutils::RobotConfiguration::RobotConfiguration ( const std::string &  group_name,
const moveit::core::RobotModelConstPtr &  robot_model 
)

Definition at line 32 of file robotconfiguration.cpp.

Member Function Documentation

◆ clearModel()

void pilz_industrial_motion_testutils::RobotConfiguration::clearModel ( )
inline

Definition at line 67 of file robotconfiguration.h.

◆ getGroupName()

std::string pilz_industrial_motion_testutils::RobotConfiguration::getGroupName ( ) const
inline

Definition at line 62 of file robotconfiguration.h.

◆ setGroupName()

void pilz_industrial_motion_testutils::RobotConfiguration::setGroupName ( const std::string &  group_name)
inline

Definition at line 57 of file robotconfiguration.h.

◆ setRobotModel()

void pilz_industrial_motion_testutils::RobotConfiguration::setRobotModel ( moveit::core::RobotModelConstPtr  robot_model)
inline

Definition at line 52 of file robotconfiguration.h.

Member Data Documentation

◆ group_name_

std::string pilz_industrial_motion_testutils::RobotConfiguration::group_name_
protected

Definition at line 48 of file robotconfiguration.h.

◆ robot_model_

moveit::core::RobotModelConstPtr pilz_industrial_motion_testutils::RobotConfiguration::robot_model_
protected

Definition at line 49 of file robotconfiguration.h.


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


pilz_industrial_motion_testutils
Author(s):
autogenerated on Mon Feb 28 2022 23:13:36