Public Types | Public Member Functions | Static Public Member Functions | List of all members
vigir_footstep_planning::SimpleActionClient< ActionSpec > Class Template Reference

#include <helper.h>

Inheritance diagram for vigir_footstep_planning::SimpleActionClient< ActionSpec >:
Inheritance graph
[legend]

Public Types

typedef boost::shared_ptr< const SimpleActionClientConstPtr
 
typedef boost::shared_ptr< SimpleActionClientPtr
 
- Public Types inherited from actionlib::SimpleActionClient< ActionSpec >
typedef boost::function< void()> SimpleActiveCallback
 
typedef boost::function< void(const SimpleClientGoalState &state, const ResultConstPtr &result)> SimpleDoneCallback
 
typedef boost::function< void(const FeedbackConstPtr &feedback)> SimpleFeedbackCallback
 

Public Member Functions

 SimpleActionClient (ros::NodeHandle nh, std::string name, bool spin_thread=true)
 
- Public Member Functions inherited from actionlib::SimpleActionClient< ActionSpec >
void cancelAllGoals ()
 
void cancelGoal ()
 
void cancelGoalsAtAndBeforeTime (const ros::Time &time)
 
ResultConstPtr getResult () const
 
SimpleClientGoalState getState () const
 
bool isServerConnected () const
 
void sendGoal (const Goal &goal, SimpleDoneCallback done_cb=SimpleDoneCallback(), SimpleActiveCallback active_cb=SimpleActiveCallback(), SimpleFeedbackCallback feedback_cb=SimpleFeedbackCallback())
 
SimpleClientGoalState sendGoalAndWait (const Goal &goal, const ros::Duration &execute_timeout=ros::Duration(0, 0), const ros::Duration &preempt_timeout=ros::Duration(0, 0))
 
 SimpleActionClient (const std::string &name, bool spin_thread=true)
 
 SimpleActionClient (ros::NodeHandle &n, const std::string &name, bool spin_thread=true)
 
void stopTrackingGoal ()
 
bool waitForResult (const ros::Duration &timeout=ros::Duration(0, 0))
 
bool waitForServer (const ros::Duration &timeout=ros::Duration(0, 0)) const
 
 ~SimpleActionClient ()
 

Static Public Member Functions

static Ptr create (ros::NodeHandle nh, std::string name, bool spin_thread=true)
 

Detailed Description

template<typename ActionSpec>
class vigir_footstep_planning::SimpleActionClient< ActionSpec >

Definition at line 52 of file helper.h.

Member Typedef Documentation

template<typename ActionSpec >
typedef boost::shared_ptr<const SimpleActionClient> vigir_footstep_planning::SimpleActionClient< ActionSpec >::ConstPtr

Definition at line 58 of file helper.h.

template<typename ActionSpec >
typedef boost::shared_ptr<SimpleActionClient> vigir_footstep_planning::SimpleActionClient< ActionSpec >::Ptr

Definition at line 57 of file helper.h.

Constructor & Destructor Documentation

template<typename ActionSpec >
vigir_footstep_planning::SimpleActionClient< ActionSpec >::SimpleActionClient ( ros::NodeHandle  nh,
std::string  name,
bool  spin_thread = true 
)
inline

Definition at line 60 of file helper.h.

Member Function Documentation

template<typename ActionSpec >
static Ptr vigir_footstep_planning::SimpleActionClient< ActionSpec >::create ( ros::NodeHandle  nh,
std::string  name,
bool  spin_thread = true 
)
inlinestatic

Definition at line 65 of file helper.h.


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


vigir_footstep_planning_lib
Author(s): Alexander Stumpf
autogenerated on Mon Jun 10 2019 15:47:33