Go to the documentation of this file.
37 #ifndef ACTIONLIB__SERVER__ACTION_SERVER_H_
38 #define ACTIONLIB__SERVER__ACTION_SERVER_H_
41 #include <boost/thread.hpp>
42 #include <boost/thread/reverse_lock.hpp>
43 #include <boost/shared_ptr.hpp>
44 #include <actionlib_msgs/GoalID.h>
45 #include <actionlib_msgs/GoalStatusArray.h>
46 #include <actionlib_msgs/GoalStatus.h>
71 template<
class ActionSpec>
72 class ActionServer :
public ActionServerBase<ActionSpec>
148 virtual void publishResult(
const actionlib_msgs::GoalStatus & status,
const Result & result);
155 virtual void publishFeedback(
const actionlib_msgs::GoalStatus & status,
156 const Feedback & feedback);
179 #endif // ACTIONLIB__SERVER__ACTION_SERVER_H_
ros::Subscriber cancel_sub_
#define ACTION_DEFINITION(ActionSpec)
virtual void publishResult(const actionlib_msgs::GoalStatus &status, const Result &result)
Publishes a result for a given goal.
ros::Publisher status_pub_
virtual void publishFeedback(const actionlib_msgs::GoalStatus &status, const Feedback &feedback)
Publishes feedback for a given goal.
virtual void initialize()
Initialize all ROS connections and setup timers.
ros::Subscriber goal_sub_
ros::Publisher result_pub_
ServerGoalHandle< ActionSpec > GoalHandle
friend class ServerGoalHandle< ActionSpec >
virtual ~ActionServer()
Destructor for the ActionServer.
ros::Publisher feedback_pub_
virtual void publishStatus()
Explicitly publish status.
ActionServer(ros::NodeHandle n, std::string name, boost::function< void(GoalHandle)> goal_cb, boost::function< void(GoalHandle)> cancel_cb, bool auto_start)
Constructor for an ActionServer.
actionlib
Author(s): Eitan Marder-Eppstein, Vijay Pradeep, Mikael Arguedas
autogenerated on Fri May 19 2023 02:36:55