|
template<typename S > |
void | finish (const S &result) |
|
void | preempt () |
|
| SimpleActionServer (ros::NodeHandle nh, std::string name, bool auto_start) |
|
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 () |
|
template<typename ActionSpec>
class vigir_footstep_planning::SimpleActionServer< ActionSpec >
Definition at line 72 of file helper.h.