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

#include <helper.h>

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

Public Types

typedef boost::shared_ptr< const SimpleActionServer< ActionSpec > > ConstPtr
 
typedef boost::function< void()> ExecuteCallback
 
typedef boost::function< void()> PreemptCallback
 
typedef boost::shared_ptr< SimpleActionServer< ActionSpec > > Ptr
 
- Public Types inherited from actionlib::SimpleActionServer< ActionSpec >
typedef boost::function< void(const GoalConstPtr &)> ExecuteCallback
 
typedef ActionServer< ActionSpec >::GoalHandle GoalHandle
 

Public Member Functions

template<typename S >
void finish (const S &result)
 
void preempt ()
 
 SimpleActionServer (ros::NodeHandle nh, std::string name, bool auto_start)
 
- Public Member Functions inherited from actionlib::SimpleActionServer< ActionSpec >
boost::shared_ptr< const Goal > acceptNewGoal ()
 
 ACTION_DEFINITION (ActionSpec)
 
bool isActive ()
 
bool isNewGoalAvailable ()
 
bool isPreemptRequested ()
 
void publishFeedback (const FeedbackConstPtr &feedback)
 
void publishFeedback (const Feedback &feedback)
 
void registerGoalCallback (boost::function< void()> cb)
 
void registerPreemptCallback (boost::function< void()> cb)
 
void setAborted (const Result &result=Result(), const std::string &text=std::string(""))
 
void setPreempted (const Result &result=Result(), const std::string &text=std::string(""))
 
void setSucceeded (const Result &result=Result(), const std::string &text=std::string(""))
 
void shutdown ()
 
 SimpleActionServer (ros::NodeHandle n, std::string name, bool auto_start)
 
 SimpleActionServer (std::string name, bool auto_start)
 
 SimpleActionServer (ros::NodeHandle n, std::string name, ExecuteCallback execute_callback, bool auto_start)
 
ROS_DEPRECATED SimpleActionServer (std::string name, ExecuteCallback execute_callback=NULL)
 
ROS_DEPRECATED SimpleActionServer (ros::NodeHandle n, std::string name, ExecuteCallback execute_callback=NULL)
 
 SimpleActionServer (std::string name, ExecuteCallback execute_callback, bool auto_start)
 
void start ()
 
 ~SimpleActionServer ()
 

Static Public Member Functions

static Ptr create (ros::NodeHandle nh, std::string name, bool auto_start, ExecuteCallback execute_cb, PreemptCallback preempt_cb=PreemptCallback())
 

Detailed Description

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

Definition at line 72 of file helper.h.

Member Typedef Documentation

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

Definition at line 78 of file helper.h.

template<typename ActionSpec >
typedef boost::function<void ()> vigir_footstep_planning::SimpleActionServer< ActionSpec >::ExecuteCallback

Definition at line 79 of file helper.h.

template<typename ActionSpec >
typedef boost::function<void ()> vigir_footstep_planning::SimpleActionServer< ActionSpec >::PreemptCallback

Definition at line 80 of file helper.h.

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

Definition at line 77 of file helper.h.

Constructor & Destructor Documentation

template<typename ActionSpec >
vigir_footstep_planning::SimpleActionServer< ActionSpec >::SimpleActionServer ( ros::NodeHandle  nh,
std::string  name,
bool  auto_start 
)
inline

Definition at line 82 of file helper.h.

Member Function Documentation

template<typename ActionSpec >
static Ptr vigir_footstep_planning::SimpleActionServer< ActionSpec >::create ( ros::NodeHandle  nh,
std::string  name,
bool  auto_start,
ExecuteCallback  execute_cb,
PreemptCallback  preempt_cb = PreemptCallback() 
)
inlinestatic

Definition at line 100 of file helper.h.

template<typename ActionSpec >
template<typename S >
void vigir_footstep_planning::SimpleActionServer< ActionSpec >::finish ( const S &  result)
inline

Definition at line 87 of file helper.h.

template<typename ActionSpec >
void vigir_footstep_planning::SimpleActionServer< ActionSpec >::preempt ( )
inline

Definition at line 95 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