Class CbMoveEndEffector
Defined in File cb_move_end_effector.hpp
Inheritance Relationships
Base Type
public smacc2::SmaccAsyncClientBehavior
Class Documentation
-
class CbMoveEndEffector : public smacc2::SmaccAsyncClientBehavior
Public Functions
-
inline CbMoveEndEffector()
-
inline CbMoveEndEffector(geometry_msgs::msg::PoseStamped target_pose, std::string tip_link = "")
-
inline virtual void onEntry() override
Public Members
-
geometry_msgs::msg::PoseStamped targetPose
-
std::string tip_link_
-
std::optional<std::string> group_
Protected Functions
-
inline bool moveToAbsolutePose(moveit::planning_interface::MoveGroupInterface &moveGroupInterface, geometry_msgs::msg::PoseStamped &targetObjectPose)
Protected Attributes
-
ClMoveit2z *movegroupClient_
-
inline CbMoveEndEffector()