#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 | |
bool | arrived = false |
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 | robot_arrived |
int | TEAMSIZE |
uint | vertex_arrived |
double | xPos [NUM_MAX_ROBOTS] |
double | yPos [NUM_MAX_ROBOTS] |
#define NUM_MAX_ROBOTS 32 |
typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient |
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 | ( | ) |
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 | ( | ) |
bool end_simulation = false |
bool goal_complete |
bool initialize = true |
bool interference |
int next_vertex = -1 |
bool ResendGoal |
int robot_arrived |
double xPos[NUM_MAX_ROBOTS] |
double yPos[NUM_MAX_ROBOTS] |