Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
locomotor::LocomotorActionServer Class Reference

#include <locomotor_action_server.h>

Public Member Functions

void completeNavigation ()
 
void failNavigation (const locomotor_msgs::ResultCode &result_code)
 
 LocomotorActionServer (const ros::NodeHandle nh, NewGoalCallback cb, const std::string name="navigate")
 
void publishFeedback (const locomotor_msgs::NavigationState &nav_state)
 

Protected Member Functions

void preemptCallback ()
 
void preGoalCallback ()
 

Protected Attributes

locomotor_msgs::NavigateToPoseFeedback feedback_
 
NewGoalCallback goal_cb_
 
actionlib::SimpleActionServer< locomotor_msgs::NavigateToPoseAction > navigate_action_server_
 

Detailed Description

Definition at line 47 of file locomotor_action_server.h.

Constructor & Destructor Documentation

locomotor::LocomotorActionServer::LocomotorActionServer ( const ros::NodeHandle  nh,
NewGoalCallback  cb,
const std::string  name = "navigate" 
)

Definition at line 42 of file locomotor_action_server.cpp.

Member Function Documentation

void locomotor::LocomotorActionServer::completeNavigation ( )

Definition at line 75 of file locomotor_action_server.cpp.

void locomotor::LocomotorActionServer::failNavigation ( const locomotor_msgs::ResultCode &  result_code)

Definition at line 80 of file locomotor_action_server.cpp.

void locomotor::LocomotorActionServer::preemptCallback ( )
protected

Definition at line 99 of file locomotor_action_server.cpp.

void locomotor::LocomotorActionServer::preGoalCallback ( )
protected

Definition at line 88 of file locomotor_action_server.cpp.

void locomotor::LocomotorActionServer::publishFeedback ( const locomotor_msgs::NavigationState &  nav_state)

Definition at line 49 of file locomotor_action_server.cpp.

Member Data Documentation

locomotor_msgs::NavigateToPoseFeedback locomotor::LocomotorActionServer::feedback_
protected

Definition at line 58 of file locomotor_action_server.h.

NewGoalCallback locomotor::LocomotorActionServer::goal_cb_
protected

Definition at line 59 of file locomotor_action_server.h.

actionlib::SimpleActionServer<locomotor_msgs::NavigateToPoseAction> locomotor::LocomotorActionServer::navigate_action_server_
protected

Definition at line 57 of file locomotor_action_server.h.


The documentation for this class was generated from the following files:


locomotor
Author(s):
autogenerated on Sun Jan 10 2021 04:08:39