|
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 | onOrthogonalAllocation () |
| virtual void | onEntry () override |
| virtual void | onExit () override |
| 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 | onOrthogonalAllocation () |
| virtual void | onEntry () override |
| virtual void | onExit () override |
| virtual void | update () override |
Public Member Functions inherited from smacc2::SmaccAsyncClientBehavior | |
| template<typename TOrthogonal , typename TSourceObject > | |
| void | onOrthogonalAllocation () |
| 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, bool throwExceptionIfNotExist) |
| template<typename SmaccComponentType > | |
| void | requiresComponent (SmaccComponentType *&storage, ComponentRequirement requirementType=ComponentRequirement::SOFT) |
Public Member Functions inherited from smacc2::ISmaccUpdatable | |
| ISmaccUpdatable () | |
| ISmaccUpdatable (rclcpp::Duration duration) | |
| void | executeUpdate (rclcpp::Node::SharedPtr node) |
| void | setUpdatePeriod (rclcpp::Duration duration) |
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) |
| ComputeJointTrajectoryErrorCode | computeJointSpaceTrajectory (moveit_msgs::msg::RobotTrajectory &computedJointTrajectory) |
| void | executeJointSpaceTrajectory (const moveit_msgs::msg::RobotTrajectory &computedJointTrajectory) |
| virtual void | generateTrajectory ()=0 |
| 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 Member Functions inherited from smacc2::ISmaccUpdatable | |
Protected Attributes | |
| std::vector< geometry_msgs::msg::PoseStamped > | endEffectorTrajectory_ |
| ClMoveit2z * | movegroupClient_ = nullptr |
| visualization_msgs::msg::MarkerArray | beahiorMarkers_ |
Private Member Functions | |
| void | initializeROS () |
| 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 |
| std::atomic< bool > | markersInitialized_ |
Definition at line 51 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.
| cl_moveit2z::CbMoveEndEffectorTrajectory::CbMoveEndEffectorTrajectory | ( | std::optional< std::string > | tipLink = std::nullopt | ) |
| cl_moveit2z::CbMoveEndEffectorTrajectory::CbMoveEndEffectorTrajectory | ( | const std::vector< geometry_msgs::msg::PoseStamped > & | endEffectorTrajectory, |
| std::optional< std::string > | tipLink = std::nullopt ) |
|
inlineprotected |
Definition at line 228 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(), cl_moveit2z::SUCCESS, cl_moveit2z::JointTrajectoryOptions::tipLink, and tipLink_.
Referenced by onEntry().


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


|
protectedvirtual |
Reimplemented in cl_moveit2z::CbCircularPivotMotion, cl_moveit2z::CbCircularPivotMotion, and cl_moveit2z::CbCircularPouringMotion.
|
inlineprotected |
Definition at line 481 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(), and cl_moveit2z::ExecutionOptions::trajectoryName.
Referenced by cl_moveit2z::CbExecuteLastTrajectory::onEntry(), onEntry(), and cl_moveit2z::CbUndoLastTrajectory::onEntry().


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

|
protectedpure virtual |
Implemented in cl_moveit2z::CbCircularPivotMotion, cl_moveit2z::CbCircularPivotMotion, cl_moveit2z::CbCircularPouringMotion, cl_moveit2z::CbExecuteLastTrajectory, cl_moveit2z::CbMoveCartesianRelative2, cl_moveit2z::CbMoveCartesianRelative2, cl_moveit2z::CbUndoLastTrajectory, and cl_moveit2z::CbUndoLastTrajectory.
|
inlineprotected |
Definition at line 608 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(), and tipLink_.
Referenced by cl_moveit2z::CbCircularPouringMotion::createMarkers(), cl_moveit2z::CbCircularPouringMotion::generateTrajectory(), and cl_moveit2z::CbMoveCartesianRelative2::generateTrajectory().


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


|
private |
|
inlineoverridevirtual |
Reimplemented from smacc2::ISmaccClientBehavior.
Reimplemented in cl_moveit2z::CbEndEffectorRotate, cl_moveit2z::CbEndEffectorRotate, cl_moveit2z::CbExecuteLastTrajectory, cl_moveit2z::CbUndoLastTrajectory, 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(), and cl_moveit2z::SUCCESS.

|
overridevirtual |
Reimplemented from smacc2::ISmaccClientBehavior.
Reimplemented in cl_moveit2z::CbEndEffectorRotate, cl_moveit2z::CbEndEffectorRotate, cl_moveit2z::CbExecuteLastTrajectory, cl_moveit2z::CbUndoLastTrajectory, and cl_moveit2z::CbUndoLastTrajectory.
|
inlineoverridevirtual |
Reimplemented from smacc2::ISmaccClientBehavior.
Definition at line 197 of file cb_move_end_effector_trajectory.hpp.
References autocleanmarkers, beahiorMarkers_, cl_moveit2z::CpTrajectoryVisualizer::clearMarkers(), smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), smacc2::ISmaccClientBehavior::getNode(), m_mutex_, markersPub_, and smacc2::ISmaccClientBehavior::requiresComponent().

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

|
inline |
Definition at line 69 of file cb_move_end_effector_trajectory.hpp.
References smacc2::ISmaccClientBehavior::getLogger(), smacc2::ISmaccClientBehavior::getName(), initializeROS(), movegroupClient_, smacc2::SmaccAsyncClientBehavior::onOrthogonalAllocation(), smacc2::ISmaccClientBehavior::postEvent(), cl_moveit2z::ClMoveit2z::postEventMotionExecutionFailed(), postIncorrectInitialStateEvent, postJointDiscontinuityEvent, and postMotionExecutionFailureEvents.

|
overridevirtual |
Implements smacc2::ISmaccUpdatable.
Definition at line 359 of file cb_move_end_effector_trajectory.cpp.
| 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 684 of file cb_move_end_effector_trajectory.hpp.
Referenced by onExit().
|
protected |
Definition at line 606 of file cb_move_end_effector_trajectory.hpp.
Referenced by cl_moveit2z::CbCircularPivotMotion::createMarkers(), cl_moveit2z::CbCircularPouringMotion::createMarkers(), createMarkers(), and onExit().
|
protected |
Definition at line 602 of file cb_move_end_effector_trajectory.hpp.
Referenced by computeJointSpaceTrajectory(), createMarkers(), cl_moveit2z::CbCircularPivotMotion::generateTrajectory(), cl_moveit2z::CbCircularPouringMotion::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 675 of file cb_move_end_effector_trajectory.hpp.
Referenced by computeJointSpaceTrajectory(), and initializeROS().
|
private |
Definition at line 677 of file cb_move_end_effector_trajectory.hpp.
Referenced by onExit().
|
private |
Definition at line 128 of file cb_move_end_effector_trajectory.hpp.
|
private |
Definition at line 673 of file cb_move_end_effector_trajectory.hpp.
Referenced by initializeROS(), and onExit().
|
protected |
Definition at line 604 of file cb_move_end_effector_trajectory.hpp.
Referenced by cl_moveit2z::CbCircularPivotMotion::computeCurrentEndEffectorPoseRelativeToPivot(), computeJointSpaceTrajectory(), executeJointSpaceTrajectory(), cl_moveit2z::CbEndEffectorRotate::onEntry(), cl_moveit2z::CbExecuteLastTrajectory::onEntry(), onEntry(), cl_moveit2z::CbUndoLastTrajectory::onEntry(), and onOrthogonalAllocation().
|
private |
Definition at line 680 of file cb_move_end_effector_trajectory.hpp.
Referenced by onEntry(), and onOrthogonalAllocation().
|
private |
Definition at line 679 of file cb_move_end_effector_trajectory.hpp.
Referenced by onEntry(), and onOrthogonalAllocation().
|
private |
Definition at line 682 of file cb_move_end_effector_trajectory.hpp.
Referenced by executeJointSpaceTrajectory(), and onOrthogonalAllocation().
| 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().