#include <helper.h>
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 Member Functions | |
template<typename S > | |
void | finish (const S &result) |
void | preempt () |
SimpleActionServer (ros::NodeHandle nh, std::string name, bool auto_start) | |
Static Public Member Functions | |
static Ptr | create (ros::NodeHandle nh, std::string name, bool auto_start, ExecuteCallback execute_cb, PreemptCallback preempt_cb=PreemptCallback()) |
typedef boost::shared_ptr<const SimpleActionServer<ActionSpec> > vigir_footstep_planning::SimpleActionServer< ActionSpec >::ConstPtr |
typedef boost::function<void ()> vigir_footstep_planning::SimpleActionServer< ActionSpec >::ExecuteCallback |
Reimplemented from actionlib::SimpleActionServer< ActionSpec >.
typedef boost::function<void ()> vigir_footstep_planning::SimpleActionServer< ActionSpec >::PreemptCallback |
typedef boost::shared_ptr<SimpleActionServer<ActionSpec> > vigir_footstep_planning::SimpleActionServer< ActionSpec >::Ptr |
vigir_footstep_planning::SimpleActionServer< ActionSpec >::SimpleActionServer | ( | ros::NodeHandle | nh, |
std::string | name, | ||
bool | auto_start | ||
) | [inline] |
Reimplemented from actionlib::SimpleActionServer< 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() |
||
) | [inline, static] |
void vigir_footstep_planning::SimpleActionServer< ActionSpec >::finish | ( | const S & | result | ) | [inline] |
void vigir_footstep_planning::SimpleActionServer< ActionSpec >::preempt | ( | ) | [inline] |