bool terminate() override
If solve() is running, terminate the computation. Return false if termination not possible....
void clear() override
Clear the data structures used by the planner.
CHOMPPlanningContext(const std::string &name, const std::string &group, const moveit::core::RobotModelConstPtr &model, const rclcpp::Node::SharedPtr &node)
bool solve(planning_interface::MotionPlanResponse &res) override
Solve the motion planning problem and store the result in res. This function should not clear data st...
planning_scene::PlanningSceneConstPtr planning_scene_
The planning scene for this context.
MotionPlanRequest request_
The planning request for this context.