#include <ros/ros.h>#include <move_base_msgs/MoveBaseAction.h>#include <actionlib/client/simple_action_client.h>#include "PPExplorer.h"
Go to the source code of this file.
Typedefs | |
| typedef actionlib::SimpleActionClient < move_base_msgs::MoveBaseAction > | MoveBaseClient |
Functions | |
| void | goalActiveCallback () |
| void | goalDoneCallback (const actionlib::SimpleClientGoalState &state, const move_base_msgs::MoveBaseResultConstPtr &result) |
| void | goalFeedbackCallback (const move_base_msgs::MoveBaseFeedbackConstPtr &feedback) |
| int | main (int argc, char **argv) |
| void | sendRobotToGoal (MoveBaseClient *ac, geometry_msgs::PoseStamped *robot_goal) |
Variables | |
| bool | goal_failed |
| bool | send_goal |
| typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient |
Definition at line 43 of file pp_explorer.cpp.
| void goalActiveCallback | ( | ) |
Definition at line 57 of file pp_explorer.cpp.
| void goalDoneCallback | ( | const actionlib::SimpleClientGoalState & | state, |
| const move_base_msgs::MoveBaseResultConstPtr & | result | ||
| ) |
Definition at line 48 of file pp_explorer.cpp.
| void goalFeedbackCallback | ( | const move_base_msgs::MoveBaseFeedbackConstPtr & | feedback | ) |
Definition at line 62 of file pp_explorer.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 83 of file pp_explorer.cpp.
| void sendRobotToGoal | ( | MoveBaseClient * | ac, |
| geometry_msgs::PoseStamped * | robot_goal | ||
| ) |
Definition at line 67 of file pp_explorer.cpp.
| bool goal_failed |
Definition at line 46 of file pp_explorer.cpp.
| bool send_goal |
Definition at line 45 of file pp_explorer.cpp.