moveit2
The MoveIt Motion Planning Framework for ROS 2.
Loading...
Searching...
No Matches
Public Member Functions | Public Attributes | List of all members
pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo Class Reference

This class is used to extract needed information from motion plan request. More...

#include <trajectory_generator.h>

Public Member Functions

 MotionPlanInfo (const planning_scene::PlanningSceneConstPtr &scene, const planning_interface::MotionPlanRequest &req)
 

Public Attributes

std::string group_name
 
std::string link_name
 
Eigen::Isometry3d start_pose
 
Eigen::Isometry3d goal_pose
 
std::map< std::string, double > start_joint_position
 
std::map< std::string, double > goal_joint_position
 
std::pair< std::string, Eigen::Vector3d > circ_path_point
 
planning_scene::PlanningSceneConstPtr start_scene
 

Detailed Description

This class is used to extract needed information from motion plan request.

Definition at line 116 of file trajectory_generator.h.

Constructor & Destructor Documentation

◆ MotionPlanInfo()

pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::MotionPlanInfo ( const planning_scene::PlanningSceneConstPtr &  scene,
const planning_interface::MotionPlanRequest req 
)

Definition at line 361 of file trajectory_generator.cpp.

Here is the call graph for this function:

Member Data Documentation

◆ circ_path_point

std::pair<std::string, Eigen::Vector3d> pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::circ_path_point

Definition at line 127 of file trajectory_generator.h.

◆ goal_joint_position

std::map<std::string, double> pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::goal_joint_position

Definition at line 126 of file trajectory_generator.h.

◆ goal_pose

Eigen::Isometry3d pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::goal_pose

Definition at line 124 of file trajectory_generator.h.

◆ group_name

std::string pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::group_name

Definition at line 121 of file trajectory_generator.h.

◆ link_name

std::string pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::link_name

Definition at line 122 of file trajectory_generator.h.

◆ start_joint_position

std::map<std::string, double> pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::start_joint_position

Definition at line 125 of file trajectory_generator.h.

◆ start_pose

Eigen::Isometry3d pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::start_pose

Definition at line 123 of file trajectory_generator.h.

◆ start_scene

planning_scene::PlanningSceneConstPtr pilz_industrial_motion_planner::TrajectoryGenerator::MotionPlanInfo::start_scene

Definition at line 128 of file trajectory_generator.h.


The documentation for this class was generated from the following files: