44#include <rclcpp/logging.hpp>
45#include <rclcpp/node.hpp>
61 virtual void initialize(
const rclcpp::Node::SharedPtr& node,
const std::string& parameter_namespace){};
#define MOVEIT_CLASS_FORWARD(C)
a wrapper around moveit_msgs::MoveItErrorCodes to make it easier to return an error code message from...
Concept in MoveIt which can be used to modify the planning problem(pre-processing) in a planning pipe...
virtual moveit::core::MoveItErrorCode adapt(const planning_scene::PlanningSceneConstPtr &planning_scene, planning_interface::MotionPlanRequest &req) const =0
Adapt the planning request.
virtual std::string getDescription() const =0
Get a description of this adapter.
virtual void initialize(const rclcpp::Node::SharedPtr &node, const std::string ¶meter_namespace)
Initialize parameters using the passed Node and parameter namespace.
This namespace includes the base class for MoveIt planners.
moveit_msgs::msg::MotionPlanRequest MotionPlanRequest
This namespace includes the central class for representing planning contexts.