| 
    moveit2
    
   The MoveIt Motion Planning Framework for ROS 2. 
   | 
 
Adapter to publish the EE path as marker array via ROS topic if a path exist. Otherwise, a warning is printed but this adapter cannot fail. More...


Public Member Functions | |
| DisplayMotionPath () | |
| ~DisplayMotionPath () override=default | |
| void | initialize (const rclcpp::Node::SharedPtr &node, const std::string ¶meter_namespace) override | 
| Initialize parameters using the passed Node and parameter namespace.   | |
| std::string | getDescription () const override | 
| Get a description of this adapter.   | |
| void | adapt (const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_interface::MotionPlanRequest &, planning_interface::MotionPlanResponse &res) const override | 
| Adapt the planning response.   | |
  Public Member Functions inherited from planning_interface::PlanningResponseAdapter | |
| virtual | ~PlanningResponseAdapter ()=default | 
Adapter to publish the EE path as marker array via ROS topic if a path exist. Otherwise, a warning is printed but this adapter cannot fail.
Definition at line 54 of file display_motion_path.cpp.
      
  | 
  inline | 
Definition at line 57 of file display_motion_path.cpp.
      
  | 
  overridedefault | 
      
  | 
  inlineoverridevirtual | 
Adapt the planning response.
| planning_scene | Representation of the environment for the planning | 
| req | Motion planning request with a set of constraints | 
| res | Motion planning response containing the solution that is adapted. | 
Implements planning_interface::PlanningResponseAdapter.
Definition at line 78 of file display_motion_path.cpp.

      
  | 
  inlineoverridevirtual | 
Get a description of this adapter.
Implements planning_interface::PlanningResponseAdapter.
Definition at line 73 of file display_motion_path.cpp.

      
  | 
  inlineoverridevirtual | 
Initialize parameters using the passed Node and parameter namespace.
| node | Node instance used by the adapter | 
| parameter_namespace | Parameter namespace for adapter | 
The default implementation is empty
Reimplemented from planning_interface::PlanningResponseAdapter.
Definition at line 63 of file display_motion_path.cpp.