Public Member Functions | |
WPServer () | |
~WPServer () | |
Private Member Functions | |
void | poseCallback (const geometry_msgs::PoseStampedConstPtr &pose) |
gets called on pose updates to determine if the current waypoint is reached | |
void | wpExecuteCB (const asctec_hl_comm::WaypointGoalConstPtr &goal) |
accepts new goal waypoint and sends the helicopter there | |
Private Attributes | |
geometry_msgs::PoseStamped | current_pose_ |
boost::mutex | current_pose_mutex_ |
ros::NodeHandle | nh_ |
ros::Subscriber | pose_sub_ |
ros::Publisher | wp_pub_ |
WaypointActionServer * | wp_server_ |
Definition at line 43 of file waypoint_server.cpp.
WPServer::WPServer | ( | ) | [inline] |
Definition at line 155 of file waypoint_server.cpp.
WPServer::~WPServer | ( | ) | [inline] |
Definition at line 163 of file waypoint_server.cpp.
void WPServer::poseCallback | ( | const geometry_msgs::PoseStampedConstPtr & | pose | ) | [inline, private] |
gets called on pose updates to determine if the current waypoint is reached
Definition at line 57 of file waypoint_server.cpp.
void WPServer::wpExecuteCB | ( | const asctec_hl_comm::WaypointGoalConstPtr & | goal | ) | [inline, private] |
accepts new goal waypoint and sends the helicopter there
Definition at line 64 of file waypoint_server.cpp.
geometry_msgs::PoseStamped WPServer::current_pose_ [private] |
Definition at line 52 of file waypoint_server.cpp.
boost::mutex WPServer::current_pose_mutex_ [private] |
Definition at line 53 of file waypoint_server.cpp.
ros::NodeHandle WPServer::nh_ [private] |
Definition at line 46 of file waypoint_server.cpp.
ros::Subscriber WPServer::pose_sub_ [private] |
Definition at line 48 of file waypoint_server.cpp.
ros::Publisher WPServer::wp_pub_ [private] |
Definition at line 47 of file waypoint_server.cpp.
WaypointActionServer* WPServer::wp_server_ [private] |
Definition at line 50 of file waypoint_server.cpp.