moveit2
The MoveIt Motion Planning Framework for ROS 2.
trajopt_planning_context.h
Go to the documentation of this file.
1 #pragma once
2 
4 
7 
8 namespace trajopt_interface
9 {
10 MOVEIT_CLASS_FORWARD(TrajOptPlanningContext); // Defines TrajOptPlanningContextPtr, ConstPtr, WeakPtr... etc
11 
13 {
14 public:
15  TrajOptPlanningContext(const std::string& name, const std::string& group,
16  const moveit::core::RobotModelConstPtr& model);
18  {
19  }
20 
23 
24  bool terminate() override;
25  void clear() override;
26 
27 private:
28  moveit::core::RobotModelConstPtr robot_model_;
29 
30  TrajOptInterfacePtr trajopt_interface_;
31 };
32 } // namespace trajopt_interface
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.
bool terminate() override
If solve() is running, terminate the computation. Return false if termination not possible....
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...
TrajOptPlanningContext(const std::string &name, const std::string &group, const moveit::core::RobotModelConstPtr &model)
name
Definition: setup.py:7
MOVEIT_CLASS_FORWARD(TermInfo)