|
SMACC2
|
#include <cb_move_end_effector_trajectory.hpp>


Public Member Functions | |
| CbMoveEndEffectorTrajectory (std::optional< std::string > tipLink=std::nullopt) | |
| CbMoveEndEffectorTrajectory (const std::vector< geometry_msgs::msg::PoseStamped > &endEffectorTrajectory, std::optional< std::string > tipLink=std::nullopt) | |
| template<typename TOrthogonal , typename TSourceObject > | |
| void | onStateOrthogonalAllocation () |
| virtual void | onEntry () override |
| virtual void | onExit () override |
Public Member Functions inherited from smacc2::SmaccAsyncClientBehavior | |
| template<typename TOrthogonal , typename TSourceObject > | |
| void | onStateOrthogonalAllocation () |
| virtual | ~SmaccAsyncClientBehavior () |
| template<typename TCallback , typename T > | |
| boost::signals2::connection | onSuccess (TCallback callback, T *object) |
| template<typename TCallback , typename T > | |
| boost::signals2::connection | onFinished (TCallback callback, T *object) |
| template<typename TCallback , typename T > | |
| boost::signals2::connection | onFailure (TCallback callback, T *object) |
| void | requestForceFinish () |
| void | executeOnEntry () override |
| void | executeOnExit () override |
| void | waitOnEntryThread (bool requestFinish) |
| template<typename TCallbackMethod , typename T > | |
| boost::signals2::connection | onSuccess (TCallbackMethod callback, T *object) |
| template<typename TCallbackMethod , typename T > | |
| boost::signals2::connection | onFinished (TCallbackMethod callback, T *object) |
| template<typename TCallbackMethod , typename T > | |
| boost::signals2::connection | onFailure (TCallbackMethod callback, T *object) |
Public Member Functions inherited from smacc2::ISmaccClientBehavior | |
| ISmaccClientBehavior () | |
| virtual | ~ISmaccClientBehavior () |
| ISmaccStateMachine * | getStateMachine () |
| std::string | getName () const |
| template<typename SmaccClientType > | |
| void | requiresClient (SmaccClientType *&storage) |
| template<typename SmaccComponentType > | |
| void | requiresComponent (SmaccComponentType *&storage, ComponentRequirement requirementType=ComponentRequirement::SOFT) |
Public Attributes | |
| std::optional< std::string > | group_ |
| std::optional< std::string > | tipLink_ |
| std::optional< bool > | allowInitialTrajectoryStateJointDiscontinuity_ |
Protected Member Functions | |
| ComputeJointTrajectoryErrorCode | computeJointSpaceTrajectory (moveit_msgs::msg::RobotTrajectory &computedJointTrajectory) |
| void | executeJointSpaceTrajectory (const moveit_msgs::msg::RobotTrajectory &computedJointTrajectory) |
| virtual void | generateTrajectory () |
| virtual void | createMarkers () |
| void | getCurrentEndEffectorPose (std::string globalFrame, tf2::Stamped< tf2::Transform > ¤tEndEffectorTransform) |
Protected Member Functions inherited from smacc2::SmaccAsyncClientBehavior | |
| void | postSuccessEvent () |
| void | postFailureEvent () |
| virtual void | dispose () override |
| bool | isShutdownRequested () |
| onEntry is executed in a new thread. However the current state cannot be left until the onEntry thread finishes. This flag can be checked from the onEntry thread to force finishing the thread. | |
Protected Member Functions inherited from smacc2::ISmaccClientBehavior | |
| virtual void | runtimeConfigure () |
| template<typename EventType > | |
| void | postEvent (const EventType &ev) |
| template<typename EventType > | |
| void | postEvent () |
| ISmaccState * | getCurrentState () |
| virtual rclcpp::Node::SharedPtr | getNode () const |
| virtual rclcpp::Logger | getLogger () const |
Protected Attributes | |
| std::vector< geometry_msgs::msg::PoseStamped > | endEffectorTrajectory_ |
| ClMoveit2z * | movegroupClient_ = nullptr |
| visualization_msgs::msg::MarkerArray | beahiorMarkers_ |
Private Member Functions | |
| void | initializeROS () |
Private Attributes | |
| rclcpp::Publisher< visualization_msgs::msg::MarkerArray >::SharedPtr | markersPub_ |
| rclcpp::Client< moveit_msgs::srv::GetPositionIK >::SharedPtr | iksrv_ |
| std::mutex | m_mutex_ |
| std::function< void(moveit_msgs::msg::RobotTrajectory &)> | postJointDiscontinuityEvent |
| std::function< void(moveit_msgs::msg::RobotTrajectory &)> | postIncorrectInitialStateEvent |
| std::function< void()> | postMotionExecutionFailureEvents |
| bool | autocleanmarkers = false |
Definition at line 60 of file cb_move_end_effector_trajectory.hpp.
|
inline |
Definition at line 70 of file cb_move_end_effector_trajectory.hpp.
|
inline |
Definition at line 74 of file cb_move_end_effector_trajectory.hpp.
|
inlineprotected |
Definition at line 204 of file cb_move_end_effector_trajectory.hpp.
References cl_moveit2z::JointTrajectoryOptions::allowInitialDiscontinuity, allowInitialTrajectoryStateJointDiscontinuity_, smacc2::ISmaccClientBehavior::currentState, endEffectorTrajectory_, smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), iksrv_, cl_moveit2z::INCORRECT_INITIAL_STATE, cl_moveit2z::JOINT_TRAJECTORY_DISCONTINUITY, movegroupClient_, cl_moveit2z::ClMoveit2z::moveGroupClientInterface, cl_moveit2z::CpJointSpaceTrajectoryPlanner::planFromWaypoints(), smacc2::ISmaccClientBehavior::requiresComponent(), smacc2::SOFT, cl_moveit2z::SUCCESS, cl_moveit2z::JointTrajectoryOptions::tipLink, and tipLink_.
Referenced by onEntry().


|
inlineprotectedvirtual |
Reimplemented in cl_moveit2z::CbCircularPivotMotion.
Definition at line 534 of file cb_move_end_effector_trajectory.hpp.
References beahiorMarkers_, endEffectorTrajectory_, and smacc2::ISmaccClientBehavior::getNode().
Referenced by cl_moveit2z::CbCircularPivotMotion::createMarkers(), and onEntry().


|
inlineprotected |
Definition at line 458 of file cb_move_end_effector_trajectory.hpp.
References cl_moveit2z::CpTrajectoryExecutor::execute(), smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), movegroupClient_, cl_moveit2z::ClMoveit2z::moveGroupClientInterface, cl_moveit2z::ClMoveit2z::postEventMotionExecutionSucceded(), smacc2::SmaccAsyncClientBehavior::postFailureEvent(), postMotionExecutionFailureEvents, smacc2::SmaccAsyncClientBehavior::postSuccessEvent(), smacc2::ISmaccClientBehavior::requiresComponent(), smacc2::SOFT, and cl_moveit2z::ExecutionOptions::trajectoryName.
Referenced by onEntry(), and cl_moveit2z::CbUndoLastTrajectory::onEntry().


|
inlineprotectedvirtual |
Reimplemented in cl_moveit2z::CbCircularPivotMotion, cl_moveit2z::CbMoveCartesianRelative2, and cl_moveit2z::CbUndoLastTrajectory.
Definition at line 528 of file cb_move_end_effector_trajectory.hpp.
Referenced by onEntry().

|
inlineprotected |
Definition at line 586 of file cb_move_end_effector_trajectory.hpp.
References smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), smacc2::ISmaccClientBehavior::getNode(), cl_moveit2z::CpTfListener::lookupTransform(), cl_moveit2z::ClMoveit2z::moveGroupClientInterface, smacc2::ISmaccClientBehavior::requiresComponent(), smacc2::SOFT, and tipLink_.
Referenced by cl_moveit2z::CbMoveCartesianRelative2::generateTrajectory().


|
inlineprivate |
Definition at line 638 of file cb_move_end_effector_trajectory.hpp.
References smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), smacc2::ISmaccClientBehavior::getNode(), iksrv_, and markersPub_.
Referenced by onStateOrthogonalAllocation().


|
inlineoverridevirtual |
Reimplemented from smacc2::ISmaccClientBehavior.
Reimplemented in cl_moveit2z::CbEndEffectorRotate, and cl_moveit2z::CbUndoLastTrajectory.
Definition at line 110 of file cb_move_end_effector_trajectory.hpp.
References computeJointSpaceTrajectory(), createMarkers(), smacc2::introspection::demangleSymbol(), endEffectorTrajectory_, executeJointSpaceTrajectory(), generateTrajectory(), smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), cl_moveit2z::INCORRECT_INITIAL_STATE, cl_moveit2z::JOINT_TRAJECTORY_DISCONTINUITY, movegroupClient_, cl_moveit2z::ClMoveit2z::postEventMotionExecutionFailed(), smacc2::SmaccAsyncClientBehavior::postFailureEvent(), postIncorrectInitialStateEvent, postJointDiscontinuityEvent, cl_moveit2z::CpTrajectoryHistory::pushTrajectory(), smacc2::ISmaccClientBehavior::requiresClient(), smacc2::ISmaccClientBehavior::requiresComponent(), cl_moveit2z::CpTrajectoryVisualizer::setTrajectory(), smacc2::SOFT, and cl_moveit2z::SUCCESS.

|
inlineoverridevirtual |
Reimplemented from smacc2::ISmaccClientBehavior.
Definition at line 201 of file cb_move_end_effector_trajectory.hpp.
|
inline |
Definition at line 82 of file cb_move_end_effector_trajectory.hpp.
References smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), initializeROS(), movegroupClient_, smacc2::SmaccAsyncClientBehavior::onStateOrthogonalAllocation(), smacc2::ISmaccClientBehavior::postEvent(), cl_moveit2z::ClMoveit2z::postEventMotionExecutionFailed(), postIncorrectInitialStateEvent, postJointDiscontinuityEvent, and postMotionExecutionFailureEvents.

| std::optional<bool> cl_moveit2z::CbMoveEndEffectorTrajectory::allowInitialTrajectoryStateJointDiscontinuity_ |
Definition at line 68 of file cb_move_end_effector_trajectory.hpp.
Referenced by computeJointSpaceTrajectory().
|
private |
Definition at line 662 of file cb_move_end_effector_trajectory.hpp.
|
protected |
Definition at line 584 of file cb_move_end_effector_trajectory.hpp.
Referenced by cl_moveit2z::CbCircularPivotMotion::createMarkers(), and createMarkers().
|
protected |
Definition at line 580 of file cb_move_end_effector_trajectory.hpp.
Referenced by computeJointSpaceTrajectory(), createMarkers(), cl_moveit2z::CbCircularPivotMotion::generateTrajectory(), cl_moveit2z::CbMoveCartesianRelative2::generateTrajectory(), and onEntry().
| std::optional<std::string> cl_moveit2z::CbMoveEndEffectorTrajectory::group_ |
Definition at line 64 of file cb_move_end_effector_trajectory.hpp.
|
private |
Definition at line 653 of file cb_move_end_effector_trajectory.hpp.
Referenced by computeJointSpaceTrajectory(), and initializeROS().
|
private |
Definition at line 655 of file cb_move_end_effector_trajectory.hpp.
|
private |
Definition at line 651 of file cb_move_end_effector_trajectory.hpp.
Referenced by initializeROS().
|
protected |
Definition at line 582 of file cb_move_end_effector_trajectory.hpp.
Referenced by cl_moveit2z::CbCircularPivotMotion::computeCurrentEndEffectorPoseRelativeToPivot(), computeJointSpaceTrajectory(), executeJointSpaceTrajectory(), cl_moveit2z::CbEndEffectorRotate::onEntry(), onEntry(), cl_moveit2z::CbUndoLastTrajectory::onEntry(), and onStateOrthogonalAllocation().
|
private |
Definition at line 658 of file cb_move_end_effector_trajectory.hpp.
Referenced by onEntry(), and onStateOrthogonalAllocation().
|
private |
Definition at line 657 of file cb_move_end_effector_trajectory.hpp.
Referenced by onEntry(), and onStateOrthogonalAllocation().
|
private |
Definition at line 660 of file cb_move_end_effector_trajectory.hpp.
Referenced by executeJointSpaceTrajectory(), and onStateOrthogonalAllocation().
| std::optional<std::string> cl_moveit2z::CbMoveEndEffectorTrajectory::tipLink_ |
Definition at line 66 of file cb_move_end_effector_trajectory.hpp.
Referenced by cl_moveit2z::CbCircularPivotMotion::CbCircularPivotMotion(), cl_moveit2z::CbCircularPivotMotion::computeCurrentEndEffectorPoseRelativeToPivot(), computeJointSpaceTrajectory(), getCurrentEndEffectorPose(), and cl_moveit2z::CbEndEffectorRotate::onEntry().