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

Data class storing all information regarding a Sequence command. More...

#include <sequence.h>

Public Member Functions

void add (const CmdVariant &cmd, const double blend_radius=0.)
 Adds a command to the end of the sequence. More...
 
size_t size () const
 Returns the number of commands. More...
 
template<class T >
T & getCmd (const size_t index_cmd)
 
template<class T >
const T & getCmd (const size_t index_cmd) const
 
template<class T >
bool cmdIsOfType (const size_t index_cmd) const
 
MotionCmdgetCmd (const size_t index_cmd)
 Returns the specific command as base class reference. This function allows the user to operate on the sequence without having knowledge of the underlying specific command type. More...
 
void setAllBlendRadiiToZero ()
 
void setBlendRadius (const size_t index_cmd, const double blend_radius)
 
double getBlendRadius (const size_t index_cmd) const
 
void erase (const size_t start, const size_t end)
 Deletes all commands from index 'start' to index 'end'. More...
 
moveit_msgs::msg::MotionSequenceRequest toRequest () const
 

Detailed Description

Data class storing all information regarding a Sequence command.

Definition at line 53 of file sequence.h.

Member Function Documentation

◆ add()

void pilz_industrial_motion_planner_testutils::Sequence::add ( const CmdVariant cmd,
const double  blend_radius = 0. 
)
inline

Adds a command to the end of the sequence.

Parameters
cmdThe command which has to be added.

Definition at line 103 of file sequence.h.

Here is the caller graph for this function:

◆ cmdIsOfType()

template<class T >
bool pilz_industrial_motion_planner_testutils::Sequence::cmdIsOfType ( const size_t  index_cmd) const
inline
Returns
TRUE if the specified command is of the specified type, otherwise FALSE.

Definition at line 141 of file sequence.h.

◆ erase()

void pilz_industrial_motion_planner_testutils::Sequence::erase ( const size_t  start,
const size_t  end 
)

Deletes all commands from index 'start' to index 'end'.

Definition at line 94 of file sequence.cpp.

Here is the call graph for this function:
Here is the caller graph for this function:

◆ getBlendRadius()

double pilz_industrial_motion_planner_testutils::Sequence::getBlendRadius ( const size_t  index_cmd) const
inline

Definition at line 125 of file sequence.h.

◆ getCmd() [1/3]

template<class T >
T & pilz_industrial_motion_planner_testutils::Sequence::getCmd ( const size_t  index_cmd)
inline

Definition at line 114 of file sequence.h.

Here is the caller graph for this function:

◆ getCmd() [2/3]

MotionCmd & pilz_industrial_motion_planner_testutils::Sequence::getCmd ( const size_t  index_cmd)

Returns the specific command as base class reference. This function allows the user to operate on the sequence without having knowledge of the underlying specific command type.

Definition at line 114 of file sequence.cpp.

◆ getCmd() [3/3]

template<class T >
const T & pilz_industrial_motion_planner_testutils::Sequence::getCmd ( const size_t  index_cmd) const
inline

Definition at line 120 of file sequence.h.

◆ setAllBlendRadiiToZero()

void pilz_industrial_motion_planner_testutils::Sequence::setAllBlendRadiiToZero ( )
inline

Definition at line 135 of file sequence.h.

Here is the caller graph for this function:

◆ setBlendRadius()

void pilz_industrial_motion_planner_testutils::Sequence::setBlendRadius ( const size_t  index_cmd,
const double  blend_radius 
)
inline

Definition at line 130 of file sequence.h.

Here is the caller graph for this function:

◆ size()

size_t pilz_industrial_motion_planner_testutils::Sequence::size ( ) const
inline

Returns the number of commands.

Definition at line 108 of file sequence.h.

Here is the caller graph for this function:

◆ toRequest()

moveit_msgs::msg::MotionSequenceRequest pilz_industrial_motion_planner_testutils::Sequence::toRequest ( ) const

Definition at line 67 of file sequence.cpp.

Here is the caller graph for this function:

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