Class CbMoveEndEffectorTrajectory

Inheritance Relationships

Base Type

  • public smacc2::SmaccAsyncClientBehavior

Derived Types

Class Documentation

class CbMoveEndEffectorTrajectory : public smacc2::SmaccAsyncClientBehavior

Subclassed by cl_moveit2z::CbCircularPivotMotion, cl_moveit2z::CbMoveCartesianRelative2, cl_moveit2z::CbUndoLastTrajectory

Public Functions

inline CbMoveEndEffectorTrajectory(std::optional<std::string> tipLink = std::nullopt)
inline CbMoveEndEffectorTrajectory(const std::vector<geometry_msgs::msg::PoseStamped> &endEffectorTrajectory, std::optional<std::string> tipLink = std::nullopt)
template<typename TOrthogonal, typename TSourceObject>
inline void onOrthogonalAllocation()
inline virtual void onEntry() override
inline virtual void onExit() override

Public Members

std::optional<std::string> group_
std::optional<bool> allowInitialTrajectoryStateJointDiscontinuity_

Protected Functions

inline ComputeJointTrajectoryErrorCode computeJointSpaceTrajectory(moveit_msgs::msg::RobotTrajectory &computedJointTrajectory)
inline void executeJointSpaceTrajectory(const moveit_msgs::msg::RobotTrajectory &computedJointTrajectory)
inline virtual void generateTrajectory()
inline virtual void createMarkers()
inline void getCurrentEndEffectorPose(std::string globalFrame, tf2::Stamped<tf2::Transform> &currentEndEffectorTransform)

Protected Attributes

std::vector<geometry_msgs::msg::PoseStamped> endEffectorTrajectory_
ClMoveit2z *movegroupClient_ = nullptr
visualization_msgs::msg::MarkerArray beahiorMarkers_