Public Attributes | List of all members
plan_execution::ExecutableMotionPlan Struct Reference

A generic representation on what a computed motion plan looks like. More...

#include <plan_representation.h>

Public Attributes

moveit_msgs::MoveItErrorCodes error_code_
 An error code reflecting what went wrong (if anything) More...
 
robot_trajectory::RobotTrajectoryPtr executed_trajectory_
 
std::vector< ExecutableTrajectoryplan_components_
 
planning_scene::PlanningSceneConstPtr planning_scene_
 
planning_scene_monitor::PlanningSceneMonitorPtr planning_scene_monitor_
 

Detailed Description

A generic representation on what a computed motion plan looks like.

Definition at line 69 of file plan_representation.h.

Member Data Documentation

moveit_msgs::MoveItErrorCodes plan_execution::ExecutableMotionPlan::error_code_

An error code reflecting what went wrong (if anything)

Definition at line 80 of file plan_representation.h.

robot_trajectory::RobotTrajectoryPtr plan_execution::ExecutableMotionPlan::executed_trajectory_

Definition at line 77 of file plan_representation.h.

std::vector<ExecutableTrajectory> plan_execution::ExecutableMotionPlan::plan_components_

Definition at line 74 of file plan_representation.h.

planning_scene::PlanningSceneConstPtr plan_execution::ExecutableMotionPlan::planning_scene_

Definition at line 72 of file plan_representation.h.

planning_scene_monitor::PlanningSceneMonitorPtr plan_execution::ExecutableMotionPlan::planning_scene_monitor_

Definition at line 71 of file plan_representation.h.


The documentation for this struct was generated from the following file:


planning
Author(s): Ioan Sucan , Sachin Chitta
autogenerated on Sun Oct 18 2020 13:17:34