21#include <tf2/impl/utils.h>
24#include <tf2_geometry_msgs/tf2_geometry_msgs.hpp>
26using namespace std::chrono_literals;
27using namespace moveit::planning_interface;
48 RCLCPP_INFO(
getLogger(),
"[ClMoveit2z] Post Motion Success Event");
54 RCLCPP_INFO(
getLogger(),
"[ClMoveit2z] Post Motion Failure Event");
std::shared_ptr< moveit::planning_interface::MoveGroupInterface > moveGroupClientInterface
std::function< void()> postEventMotionExecutionFailed_
std::shared_ptr< moveit::planning_interface::PlanningSceneInterface > planningSceneInterface
ClMoveit2z(std::string groupName)
const moveit::planning_interface::MoveGroupInterface::Options & getOptions() const
void onInitialize() override
void postEventMotionExecutionFailed()
moveit::planning_interface::MoveGroupInterface::Options options_
std::function< void()> postEventMotionExecutionSucceded_
void postEventMotionExecutionSucceded()
rclcpp::Node::SharedPtr getNode()
rclcpp::Logger getLogger()