20 _actionServer(*nh, topicForAction, false) {
51 ROS_WARN_STREAM (
"ROSACTION SERVER no goal is in execution (no one has" <<
52 "arrived or the last one is already completed. EMPTY GOAL RETURNING");
53 return rosee_msg::ROSEEActionControl();
85 rosee_msg::ROSEECommandResult result;
97 ROS_INFO_STREAM(
"ROSACTION SERVER Sending feedback " << completation_percentage );
99 rosee_msg::ROSEECommandFeedback feedback;
100 feedback.completation_percentage = completation_percentage;
101 if (currentAction.size() == 0) {
104 feedback.action_name_current = currentAction;
118 rosee_msg::ROSEECommandResult result;
void sendFeedback(double completation_percentage, std::string currentAction)
send Feedback to the client who has requested the goal.
boost::shared_ptr< const Goal > acceptNewGoal()
void publishFeedback(const FeedbackConstPtr &feedback)
RosActionServer(std::string topicForAction, ros::NodeHandle *nh)
rosee_msg::ROSEEActionControl actionControlMsg
std::string topicForAction
void setSucceeded(const Result &result=Result(), const std::string &text=std::string(""))
void abortGoal(std::string errorMsg="")
void preemptReceivedCallback()
double getWantedNormError() const
in message there is a field where norm error of joint position can be set If it is not present in the...
void setPreempted(const Result &result=Result(), const std::string &text=std::string(""))
rosee_msg::ROSEEActionControl getGoal()
void registerPreemptCallback(boost::function< void()> cb)
#define ROS_WARN_STREAM(args)
actionlib::SimpleActionServer< rosee_msg::ROSEECommandAction > _actionServer
void setAborted(const Result &result=Result(), const std::string &text=std::string(""))
void goalReceivedCallback()
#define ROS_INFO_STREAM(args)
void registerGoalCallback(boost::function< void()> cb)
#define DEFAULT_ERROR_NORM