moveit2
The MoveIt Motion Planning Framework for ROS 2.
Public Member Functions | List of all members
pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible Class Referenceabstract

Interface class to express that a derived class can be converted into a moveit_msgs::msg::Constraints. More...

#include <goalconstraintsmsgconvertible.h>

Inheritance diagram for pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible:
Inheritance graph
[legend]

Public Member Functions

 GoalConstraintMsgConvertible ()=default
 
 GoalConstraintMsgConvertible (const GoalConstraintMsgConvertible &)=default
 
 GoalConstraintMsgConvertible (GoalConstraintMsgConvertible &&)=default
 
GoalConstraintMsgConvertibleoperator= (const GoalConstraintMsgConvertible &)=default
 
GoalConstraintMsgConvertibleoperator= (GoalConstraintMsgConvertible &&)=default
 
virtual ~GoalConstraintMsgConvertible ()=default
 
virtual moveit_msgs::msg::Constraints toGoalConstraints () const =0
 

Detailed Description

Interface class to express that a derived class can be converted into a moveit_msgs::msg::Constraints.

Definition at line 48 of file goalconstraintsmsgconvertible.h.

Constructor & Destructor Documentation

◆ GoalConstraintMsgConvertible() [1/3]

pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible::GoalConstraintMsgConvertible ( )
default

◆ GoalConstraintMsgConvertible() [2/3]

pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible::GoalConstraintMsgConvertible ( const GoalConstraintMsgConvertible )
default

◆ GoalConstraintMsgConvertible() [3/3]

pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible::GoalConstraintMsgConvertible ( GoalConstraintMsgConvertible &&  )
default

◆ ~GoalConstraintMsgConvertible()

virtual pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible::~GoalConstraintMsgConvertible ( )
virtualdefault

Member Function Documentation

◆ operator=() [1/2]

GoalConstraintMsgConvertible& pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible::operator= ( const GoalConstraintMsgConvertible )
default

◆ operator=() [2/2]

GoalConstraintMsgConvertible& pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible::operator= ( GoalConstraintMsgConvertible &&  )
default

◆ toGoalConstraints()

virtual moveit_msgs::msg::Constraints pilz_industrial_motion_planner_testutils::GoalConstraintMsgConvertible::toGoalConstraints ( ) const
pure virtual

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