Public Member Functions | Private Member Functions | Private Attributes | List of all members
move_group::MoveGroupMoveAction Class Reference

#include <move_action_capability.h>

Inheritance diagram for move_group::MoveGroupMoveAction:
Inheritance graph
[legend]

Public Member Functions

virtual void initialize ()
 
 MoveGroupMoveAction ()
 
- Public Member Functions inherited from move_group::MoveGroupCapability
const std::string & getName () const
 
 MoveGroupCapability (const std::string &capability_name)
 
void setContext (const MoveGroupContextPtr &context)
 
virtual ~MoveGroupCapability ()
 

Private Member Functions

void executeMoveCallback (const moveit_msgs::MoveGroupGoalConstPtr &goal)
 
void executeMoveCallback_PlanAndExecute (const moveit_msgs::MoveGroupGoalConstPtr &goal, moveit_msgs::MoveGroupResult &action_res)
 
void executeMoveCallback_PlanOnly (const moveit_msgs::MoveGroupGoalConstPtr &goal, moveit_msgs::MoveGroupResult &action_res)
 
bool planUsingPlanningPipeline (const planning_interface::MotionPlanRequest &req, plan_execution::ExecutableMotionPlan &plan)
 
void preemptMoveCallback ()
 
void setMoveState (MoveGroupState state)
 
void startMoveExecutionCallback ()
 
void startMoveLookCallback ()
 

Private Attributes

std::unique_ptr< actionlib::SimpleActionServer< moveit_msgs::MoveGroupAction > > move_action_server_
 
moveit_msgs::MoveGroupFeedback move_feedback_
 
MoveGroupState move_state_
 
bool preempt_requested_
 

Additional Inherited Members

- Protected Member Functions inherited from move_group::MoveGroupCapability
planning_interface::MotionPlanRequest clearRequestStartState (const planning_interface::MotionPlanRequest &request) const
 
moveit_msgs::PlanningScene clearSceneRobotState (const moveit_msgs::PlanningScene &scene) const
 
void convertToMsg (const std::vector< plan_execution::ExecutableTrajectory > &trajectory, moveit_msgs::RobotState &first_state_msg, std::vector< moveit_msgs::RobotTrajectory > &trajectory_msg) const
 
void convertToMsg (const robot_trajectory::RobotTrajectoryPtr &trajectory, moveit_msgs::RobotState &first_state_msg, moveit_msgs::RobotTrajectory &trajectory_msg) const
 
void convertToMsg (const std::vector< plan_execution::ExecutableTrajectory > &trajectory, moveit_msgs::RobotState &first_state_msg, moveit_msgs::RobotTrajectory &trajectory_msg) const
 
std::string getActionResultString (const moveit_msgs::MoveItErrorCodes &error_code, bool planned_trajectory_empty, bool plan_only)
 
bool performTransform (geometry_msgs::PoseStamped &pose_msg, const std::string &target_frame) const
 
std::string stateToStr (MoveGroupState state) const
 
- Protected Attributes inherited from move_group::MoveGroupCapability
std::string capability_name_
 
MoveGroupContextPtr context_
 
ros::NodeHandle node_handle_
 
ros::NodeHandle root_node_handle_
 

Detailed Description

Definition at line 47 of file move_action_capability.h.

Constructor & Destructor Documentation

move_group::MoveGroupMoveAction::MoveGroupMoveAction ( )

Definition at line 46 of file move_action_capability.cpp.

Member Function Documentation

void move_group::MoveGroupMoveAction::executeMoveCallback ( const moveit_msgs::MoveGroupGoalConstPtr &  goal)
private

Definition at line 60 of file move_action_capability.cpp.

void move_group::MoveGroupMoveAction::executeMoveCallback_PlanAndExecute ( const moveit_msgs::MoveGroupGoalConstPtr &  goal,
moveit_msgs::MoveGroupResult &  action_res 
)
private

Definition at line 96 of file move_action_capability.cpp.

void move_group::MoveGroupMoveAction::executeMoveCallback_PlanOnly ( const moveit_msgs::MoveGroupGoalConstPtr &  goal,
moveit_msgs::MoveGroupResult &  action_res 
)
private

Definition at line 160 of file move_action_capability.cpp.

void move_group::MoveGroupMoveAction::initialize ( )
virtual

Implements move_group::MoveGroupCapability.

Definition at line 51 of file move_action_capability.cpp.

bool move_group::MoveGroupMoveAction::planUsingPlanningPipeline ( const planning_interface::MotionPlanRequest req,
plan_execution::ExecutableMotionPlan plan 
)
private

Definition at line 197 of file move_action_capability.cpp.

void move_group::MoveGroupMoveAction::preemptMoveCallback ( )
private

Definition at line 234 of file move_action_capability.cpp.

void move_group::MoveGroupMoveAction::setMoveState ( MoveGroupState  state)
private

Definition at line 240 of file move_action_capability.cpp.

void move_group::MoveGroupMoveAction::startMoveExecutionCallback ( )
private

Definition at line 224 of file move_action_capability.cpp.

void move_group::MoveGroupMoveAction::startMoveLookCallback ( )
private

Definition at line 229 of file move_action_capability.cpp.

Member Data Documentation

std::unique_ptr<actionlib::SimpleActionServer<moveit_msgs::MoveGroupAction> > move_group::MoveGroupMoveAction::move_action_server_
private

Definition at line 67 of file move_action_capability.h.

moveit_msgs::MoveGroupFeedback move_group::MoveGroupMoveAction::move_feedback_
private

Definition at line 68 of file move_action_capability.h.

MoveGroupState move_group::MoveGroupMoveAction::move_state_
private

Definition at line 70 of file move_action_capability.h.

bool move_group::MoveGroupMoveAction::preempt_requested_
private

Definition at line 71 of file move_action_capability.h.


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


move_group
Author(s): Ioan Sucan , Sachin Chitta
autogenerated on Sun Oct 18 2020 13:18:14