Representation of a particular planning context – the planning scene and the request are known,...
void clear() override
Clear the data structures used by the planner.
void solve(planning_interface::MotionPlanResponse &res) override
Solve the motion planning problem and store the result in res. This function should not clear data st...
std::shared_ptr< rclcpp::Publisher< visualization_msgs::msg::MarkerArray > > getPathPublisher()
void setPathPublisher(const std::shared_ptr< rclcpp::Publisher< visualization_msgs::msg::MarkerArray > > &path_publisher)
bool terminate() override
If solve() is running, terminate the computation. Return false if termination not possible....