#include <actionlib/action_definition.h>#include <actionlib/server/action_server.h>#include <ros/ros.h>#include <boost/thread.hpp>#include <boost/shared_ptr.hpp>#include <actionlib_msgs/GoalID.h>#include <actionlib_msgs/GoalStatusArray.h>#include <actionlib_msgs/GoalStatus.h>#include <actionlib/enclosure_deleter.h>#include <actionlib/goal_id_generator.h>#include <actionlib/server/status_tracker.h>#include <actionlib/server/handle_tracker_deleter.h>#include <actionlib/server/server_goal_handle.h>#include <actionlib/destruction_guard.h>#include <list>#include <actionlib/server/action_server_imp.h>

Go to the source code of this file.
Classes | |
| class | actionlib::ServiceServer |
| class | actionlib::ServiceServerImp |
| class | actionlib::ServiceServerImpT< ActionSpec > |
Namespaces | |
| namespace | actionlib |
Functions | |
| template<class ActionSpec > | |
| ServiceServer | actionlib::advertiseService (ros::NodeHandle n, std::string name, boost::function< bool(const typename ActionSpec::_action_goal_type::_goal_type &, typename ActionSpec::_action_result_type::_result_type &result)> service_cb) |