37 #ifndef ACTIONLIB__SERVER__SERVICE_SERVER_H_ 38 #define ACTIONLIB__SERVER__SERVICE_SERVER_H_ 65 template<
class ActionSpec>
67 boost::function<
bool(
const typename ActionSpec::_action_goal_type::_goal_type &,
68 typename ActionSpec::_action_result_type::_result_type & result)> service_cb);
70 template<
class ActionSpec>
80 boost::function<
bool(
const Goal &, Result & result)> service_cb);
81 void goalCB(GoalHandle g);
85 boost::function<bool(const Goal &, Result & result)>
service_cb_;
92 #endif // ACTIONLIB__SERVER__SERVICE_SERVER_H_
virtual ~ServiceServerImp()
ServiceServer(boost::shared_ptr< ServiceServerImp > server)
boost::shared_ptr< ActionServer< ActionSpec > > as_
ServiceServer 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)
boost::shared_ptr< ServiceServerImp > server_
Encapsulates a state machine for a given goal that the user can trigger transitions on...
#define ACTION_DEFINITION(ActionSpec)
ActionServer< ActionSpec >::GoalHandle GoalHandle
boost::function< bool(const Goal &, Result &result)> service_cb_