moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | Protected Attributes | List of all members
pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType > Class Template Referenceabstract

Base class to define an auxiliary point needed to specify circ commands. More...

#include <circauxiliary.h>

Inheritance diagram for pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType >:
Inheritance graph
[legend]

Public Member Functions

void setConfiguration (const ConfigType &auxiliary_config)
 
ConfigType & getConfiguration ()
 
const ConfigType & getConfiguration () const
 
moveit_msgs::msg::Constraints toPathConstraints () const
 

Protected Attributes

ConfigType auxiliary_config_
 

Detailed Description

template<class ConfigType, class BuilderType>
class pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType >

Base class to define an auxiliary point needed to specify circ commands.

Definition at line 48 of file circauxiliary.h.

Member Function Documentation

◆ getConfiguration() [1/2]

template<class ConfigType , class BuilderType >
ConfigType & pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType >::getConfiguration
inline

Definition at line 72 of file circauxiliary.h.

◆ getConfiguration() [2/2]

template<class ConfigType , class BuilderType >
const ConfigType & pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType >::getConfiguration
inline

Definition at line 78 of file circauxiliary.h.

◆ setConfiguration()

template<class ConfigType , class BuilderType >
void pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType >::setConfiguration ( const ConfigType &  auxiliary_config)

Definition at line 66 of file circauxiliary.h.

◆ toPathConstraints()

template<class ConfigType , class BuilderType >
moveit_msgs::msg::Constraints pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType >::toPathConstraints
inline

Definition at line 84 of file circauxiliary.h.

Member Data Documentation

◆ auxiliary_config_

template<class ConfigType , class BuilderType >
ConfigType pilz_industrial_motion_planner_testutils::CircAuxiliary< ConfigType, BuilderType >::auxiliary_config_
protected

Definition at line 62 of file circauxiliary.h.


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