Class Sequence

Class Documentation

class Sequence

Data class storing all information regarding a Sequence command.

Public Functions

inline void add(const CmdVariant &cmd, const double blend_radius = 0.)

Adds a command to the end of the sequence.

Parameters:

cmd – The command which has to be added.

inline size_t size() const

Returns the number of commands.

template<class T>
inline T &getCmd(const size_t index_cmd)
template<class T>
inline const T &getCmd(const size_t index_cmd) const
template<class T>
inline bool cmdIsOfType(const size_t index_cmd) const
Returns:

TRUE if the specified command is of the specified type, otherwise FALSE.

MotionCmd &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.

inline void setAllBlendRadiiToZero()
inline void setBlendRadius(const size_t index_cmd, const double blend_radius)
inline 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’.

moveit_msgs::msg::MotionSequenceRequest toRequest() const