|
SMACC2
|
Component for joint space trajectory generation from Cartesian waypoints. More...
#include <cp_joint_space_trajectory_planner.hpp>


Public Member Functions | |
| CpJointSpaceTrajectoryPlanner ()=default | |
| virtual | ~CpJointSpaceTrajectoryPlanner ()=default |
| void | onInitialize () override |
| Initialize the component and create IK service client. | |
| JointTrajectoryResult | planFromWaypoints (const std::vector< geometry_msgs::msg::PoseStamped > &waypoints, const JointTrajectoryOptions &options={}) |
| Compute joint space trajectory from Cartesian waypoints. | |
Public Member Functions inherited from smacc2::ISmaccComponent | |
| ISmaccComponent () | |
| virtual | ~ISmaccComponent () |
| virtual std::string | getName () const |
Private Attributes | |
| ClMoveit2z * | moveit2zClient_ = nullptr |
| rclcpp::Client< moveit_msgs::srv::GetPositionIK >::SharedPtr | ikClient_ |
Additional Inherited Members | |
Protected Member Functions inherited from smacc2::ISmaccComponent | |
| template<typename TOrthogonal , typename TClient > | |
| void | onComponentInitialization () |
| template<typename EventType > | |
| void | postEvent (const EventType &ev) |
| template<typename EventType > | |
| void | postEvent () |
| template<typename TOrthogonal , typename TSourceObject > | |
| void | onOrthogonalAllocation () |
| template<typename TOrthogonal , typename TSourceObject > | |
| void | onStateOrthogonalAllocation () |
| template<typename TComponent > | |
| void | requiresComponent (TComponent *&requiredComponentStorage, bool throwExceptionIfNotExist) |
| template<typename TComponent > | |
| void | requiresComponent (std::string name, TComponent *&requiredComponentStorage, bool throwExceptionIfNotExist) |
| template<typename TComponent > | |
| void | requiresComponent (TComponent *&requiredComponentStorage, ComponentRequirement requirementType=ComponentRequirement::SOFT) |
| template<typename TComponent > | |
| void | requiresComponent (std::string name, TComponent *&requiredComponentStorage, ComponentRequirement requirementType=ComponentRequirement::SOFT) |
| template<typename TClient > | |
| void | requiresClient (TClient *&requiredClientStorage) |
| template<typename SmaccComponentType , typename TOrthogonal , typename TClient , typename... TArgs> | |
| SmaccComponentType * | createSiblingComponent (TArgs... targs) |
| template<typename SmaccComponentType , typename TOrthogonal , typename TClient , typename... TArgs> | |
| SmaccComponentType * | createSiblingNamedComponent (std::string name, TArgs... targs) |
| rclcpp::Node::SharedPtr | getNode () |
| rclcpp::Logger | getLogger () const |
| ISmaccStateMachine * | getStateMachine () |
Protected Attributes inherited from smacc2::ISmaccComponent | |
| ISmaccStateMachine * | stateMachine_ |
| ISmaccClient * | owner_ |
Component for joint space trajectory generation from Cartesian waypoints.
This component centralizes IK-based trajectory generation:
Pattern: Trajectory planner with IK service integration
Definition at line 94 of file cp_joint_space_trajectory_planner.hpp.
|
default |
|
virtualdefault |
|
inlineoverridevirtual |
Initialize the component and create IK service client.
Reimplemented from smacc2::ISmaccComponent.
Definition at line 103 of file cp_joint_space_trajectory_planner.hpp.
References smacc2::ISmaccComponent::getLogger(), smacc2::ISmaccComponent::getNode(), ikClient_, moveit2zClient_, and smacc2::ISmaccComponent::requiresClient().

|
inline |
Compute joint space trajectory from Cartesian waypoints.
| waypoints | Vector of Cartesian poses to follow |
| options | Planning configuration options |
Definition at line 120 of file cp_joint_space_trajectory_planner.hpp.
Referenced by cl_moveit2z::CbMoveEndEffectorTrajectory::computeJointSpaceTrajectory().

|
private |
Definition at line 343 of file cp_joint_space_trajectory_planner.hpp.
Referenced by onInitialize().
|
private |
Definition at line 342 of file cp_joint_space_trajectory_planner.hpp.
Referenced by onInitialize().