Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
pick_place::PickPlacePlanBase Class Reference

#include <pick_place.h>

Inheritance diagram for pick_place::PickPlacePlanBase:
Inheritance graph
[legend]

Public Member Functions

const moveit_msgs::MoveItErrorCodes & getErrorCode () const
 
const std::vector< ManipulationPlanPtr > & getFailedManipulationPlans () const
 
double getLastPlanTime () const
 
const std::vector< ManipulationPlanPtr > & getSuccessfulManipulationPlans () const
 
 PickPlacePlanBase (const PickPlaceConstPtr &pick_place, const std::string &name)
 
 ~PickPlacePlanBase ()
 

Protected Member Functions

void emptyQueue ()
 
void foundSolution ()
 
void initialize ()
 
void waitForPipeline (const ros::WallTime &endtime)
 

Protected Attributes

bool done_
 
boost::condition_variable done_condition_
 
boost::mutex done_mutex_
 
moveit_msgs::MoveItErrorCodes error_code_
 
double last_plan_time_
 
PickPlaceConstPtr pick_place_
 
ManipulationPipeline pipeline_
 
bool pushed_all_poses_
 

Detailed Description

Definition at line 85 of file pick_place.h.

Constructor & Destructor Documentation

◆ PickPlacePlanBase()

pick_place::PickPlacePlanBase::PickPlacePlanBase ( const PickPlaceConstPtr &  pick_place,
const std::string &  name 
)

Definition at line 83 of file pick_place.cpp.

◆ ~PickPlacePlanBase()

pick_place::PickPlacePlanBase::~PickPlacePlanBase ( )
default

Member Function Documentation

◆ emptyQueue()

void pick_place::PickPlacePlanBase::emptyQueue ( )
protected

Definition at line 99 of file pick_place.cpp.

◆ foundSolution()

void pick_place::PickPlacePlanBase::foundSolution ( )
protected

Definition at line 92 of file pick_place.cpp.

◆ getErrorCode()

const moveit_msgs::MoveItErrorCodes& pick_place::PickPlacePlanBase::getErrorCode ( ) const
inline

Definition at line 100 of file pick_place.h.

◆ getFailedManipulationPlans()

const std::vector<ManipulationPlanPtr>& pick_place::PickPlacePlanBase::getFailedManipulationPlans ( ) const
inline

Definition at line 95 of file pick_place.h.

◆ getLastPlanTime()

double pick_place::PickPlacePlanBase::getLastPlanTime ( ) const
inline

Definition at line 105 of file pick_place.h.

◆ getSuccessfulManipulationPlans()

const std::vector<ManipulationPlanPtr>& pick_place::PickPlacePlanBase::getSuccessfulManipulationPlans ( ) const
inline

Definition at line 91 of file pick_place.h.

◆ initialize()

void pick_place::PickPlacePlanBase::initialize ( )
protected

Definition at line 109 of file pick_place.cpp.

◆ waitForPipeline()

void pick_place::PickPlacePlanBase::waitForPipeline ( const ros::WallTime endtime)
protected

Definition at line 115 of file pick_place.cpp.

Member Data Documentation

◆ done_

bool pick_place::PickPlacePlanBase::done_
protected

Definition at line 120 of file pick_place.h.

◆ done_condition_

boost::condition_variable pick_place::PickPlacePlanBase::done_condition_
protected

Definition at line 122 of file pick_place.h.

◆ done_mutex_

boost::mutex pick_place::PickPlacePlanBase::done_mutex_
protected

Definition at line 123 of file pick_place.h.

◆ error_code_

moveit_msgs::MoveItErrorCodes pick_place::PickPlacePlanBase::error_code_
protected

Definition at line 124 of file pick_place.h.

◆ last_plan_time_

double pick_place::PickPlacePlanBase::last_plan_time_
protected

Definition at line 119 of file pick_place.h.

◆ pick_place_

PickPlaceConstPtr pick_place::PickPlacePlanBase::pick_place_
protected

Definition at line 116 of file pick_place.h.

◆ pipeline_

ManipulationPipeline pick_place::PickPlacePlanBase::pipeline_
protected

Definition at line 117 of file pick_place.h.

◆ pushed_all_poses_

bool pick_place::PickPlacePlanBase::pushed_all_poses_
protected

Definition at line 121 of file pick_place.h.


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


manipulation
Author(s): Ioan Sucan , Sachin Chitta
autogenerated on Mon May 27 2024 02:27:51