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

#include <execute_task_solution_capability.h>

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

Public Member Functions

 ExecuteTaskSolutionCapability ()
 
void initialize () override
 
- 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

bool constructMotionPlan (const moveit_task_constructor_msgs::Solution &solution, plan_execution::ExecutableMotionPlan &plan)
 
void execCallback (const moveit_task_constructor_msgs::ExecuteTaskSolutionGoalConstPtr &goal)
 
void preemptCallback ()
 

Private Attributes

std::unique_ptr< actionlib::SimpleActionServer< moveit_task_constructor_msgs::ExecuteTaskSolutionAction > > as_
 

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 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
 
void convertToMsg (const std::vector< plan_execution::ExecutableTrajectory > &trajectory, moveit_msgs::RobotState &first_state_msg, std::vector< 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
 
planning_pipeline::PlanningPipelinePtr resolvePlanningPipeline (const std::string &pipeline_id) 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 85 of file execute_task_solution_capability.h.

Constructor & Destructor Documentation

◆ ExecuteTaskSolutionCapability()

move_group::ExecuteTaskSolutionCapability::ExecuteTaskSolutionCapability ( )

Definition at line 83 of file execute_task_solution_capability.cpp.

Member Function Documentation

◆ constructMotionPlan()

bool move_group::ExecuteTaskSolutionCapability::constructMotionPlan ( const moveit_task_constructor_msgs::Solution &  solution,
plan_execution::ExecutableMotionPlan plan 
)
private

Definition at line 127 of file execute_task_solution_capability.cpp.

◆ execCallback()

void move_group::ExecuteTaskSolutionCapability::execCallback ( const moveit_task_constructor_msgs::ExecuteTaskSolutionGoalConstPtr &  goal)
private

Definition at line 94 of file execute_task_solution_capability.cpp.

◆ initialize()

void move_group::ExecuteTaskSolutionCapability::initialize ( )
overridevirtual

◆ preemptCallback()

void move_group::ExecuteTaskSolutionCapability::preemptCallback ( )
private

Definition at line 122 of file execute_task_solution_capability.cpp.

Member Data Documentation

◆ as_

std::unique_ptr<actionlib::SimpleActionServer<moveit_task_constructor_msgs::ExecuteTaskSolutionAction> > move_group::ExecuteTaskSolutionCapability::as_
private

Definition at line 131 of file execute_task_solution_capability.h.


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


capabilities
Author(s):
autogenerated on Sat May 3 2025 02:40:24