#include <ros/ros.h>#include <move_base_msgs/MoveBaseAction.h>#include <actionlib/client/simple_action_client.h>#include <tf/transform_broadcaster.h>#include <nav_msgs/Odometry.h>#include "getgraph.h"#include "algorithms.h"
Go to the source code of this file.
Defines | |
| #define | NUM_MAX_ROBOTS 32 |
Typedefs | |
| typedef actionlib::SimpleActionClient < move_base_msgs::MoveBaseAction > | MoveBaseClient |
| typedef unsigned int | uint |
Functions | |
| void | backup () |
| bool | check_interference (void) |
| void | goalActiveCallback () |
| void | goalDoneCallback (const actionlib::SimpleClientGoalState &state, const move_base_msgs::MoveBaseResultConstPtr &result) |
| void | goalFeedbackCallback (const move_base_msgs::MoveBaseFeedbackConstPtr &feedback) |
| void | initialize_node () |
| int | main (int argc, char **argv) |
| void | odomCB (const nav_msgs::Odometry::ConstPtr &msg) |
| void | positionsCB (const nav_msgs::Odometry::ConstPtr &msg) |
| void | resultsCB (const geometry_msgs::PointStamped::ConstPtr &msg) |
| void | send_goal_result (uint vertex) |
| void | send_interference () |
Variables | |
| uint | backUpCounter |
| ros::Publisher | cmd_vel_pub |
| bool | end_simulation = false |
| bool | goal_complete |
| int | ID_ROBOT |
| bool | initialize = true |
| bool | interference |
| int | next_vertex = -1 |
| ros::Publisher | odom_pub |
| ros::Subscriber | odom_sub |
| bool | ResendGoal |
| ros::Publisher | results_pub |
| ros::Subscriber | results_sub |
| int | TEAMSIZE |
| double | xPos [NUM_MAX_ROBOTS] |
| double | yPos [NUM_MAX_ROBOTS] |
| #define NUM_MAX_ROBOTS 32 |
Definition at line 47 of file Heuristic_Conscientious_Reactive.cpp.
| typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient |
Definition at line 50 of file Heuristic_Conscientious_Reactive.cpp.
| typedef unsigned int uint |
Definition at line 49 of file Heuristic_Conscientious_Reactive.cpp.
| void backup | ( | ) |
Definition at line 92 of file Heuristic_Conscientious_Reactive.cpp.
| bool check_interference | ( | void | ) |
Definition at line 277 of file Heuristic_Conscientious_Reactive.cpp.
| void goalActiveCallback | ( | ) |
Definition at line 148 of file Heuristic_Conscientious_Reactive.cpp.
| void goalDoneCallback | ( | const actionlib::SimpleClientGoalState & | state, |
| const move_base_msgs::MoveBaseResultConstPtr & | result | ||
| ) |
Definition at line 128 of file Heuristic_Conscientious_Reactive.cpp.
| void goalFeedbackCallback | ( | const move_base_msgs::MoveBaseFeedbackConstPtr & | feedback | ) |
Definition at line 299 of file Heuristic_Conscientious_Reactive.cpp.
| void initialize_node | ( | ) |
Definition at line 228 of file Heuristic_Conscientious_Reactive.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 335 of file Heuristic_Conscientious_Reactive.cpp.
| void odomCB | ( | const nav_msgs::Odometry::ConstPtr & | msg | ) |
Definition at line 153 of file Heuristic_Conscientious_Reactive.cpp.
| void positionsCB | ( | const nav_msgs::Odometry::ConstPtr & | msg | ) |
Definition at line 168 of file Heuristic_Conscientious_Reactive.cpp.
| void resultsCB | ( | const geometry_msgs::PointStamped::ConstPtr & | msg | ) |
Definition at line 210 of file Heuristic_Conscientious_Reactive.cpp.
| void send_goal_result | ( | uint | vertex | ) |
Definition at line 72 of file Heuristic_Conscientious_Reactive.cpp.
| void send_interference | ( | ) |
Definition at line 256 of file Heuristic_Conscientious_Reactive.cpp.
Definition at line 58 of file Heuristic_Conscientious_Reactive.cpp.
Definition at line 70 of file Heuristic_Conscientious_Reactive.cpp.
| bool end_simulation = false |
Definition at line 56 of file Heuristic_Conscientious_Reactive.cpp.
| bool goal_complete |
Definition at line 54 of file Heuristic_Conscientious_Reactive.cpp.
| int ID_ROBOT |
Definition at line 61 of file Heuristic_Conscientious_Reactive.cpp.
| bool initialize = true |
Definition at line 55 of file Heuristic_Conscientious_Reactive.cpp.
| bool interference |
Definition at line 53 of file Heuristic_Conscientious_Reactive.cpp.
| int next_vertex = -1 |
Definition at line 57 of file Heuristic_Conscientious_Reactive.cpp.
Definition at line 67 of file Heuristic_Conscientious_Reactive.cpp.
Definition at line 66 of file Heuristic_Conscientious_Reactive.cpp.
| bool ResendGoal |
Definition at line 52 of file Heuristic_Conscientious_Reactive.cpp.
Definition at line 69 of file Heuristic_Conscientious_Reactive.cpp.
Definition at line 68 of file Heuristic_Conscientious_Reactive.cpp.
| int TEAMSIZE |
Definition at line 60 of file Heuristic_Conscientious_Reactive.cpp.
| double xPos[NUM_MAX_ROBOTS] |
Definition at line 63 of file Heuristic_Conscientious_Reactive.cpp.
| double yPos[NUM_MAX_ROBOTS] |
Definition at line 64 of file Heuristic_Conscientious_Reactive.cpp.