#include <vector>
#include <string>
#include <ros/ros.h>
#include <tf/tf.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <actionlib/client/simple_action_client.h>
#include <geometry_msgs/Pose2D.h>
#include <lse_sensor_msgs/Nostril.h>
#include <roomba_500_series/Battery.h>
#include <geometry_msgs/Twist.h>
#include <fctuc_open_day/Poses.h>
Go to the source code of this file.
Typedefs | |
typedef actionlib::SimpleActionClient < move_base_msgs::MoveBaseAction > | MoveBaseClient |
Functions | |
void | batteryCallback (const roomba_500_series::Battery::ConstPtr &batt) |
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 | noseCallback (const lse_sensor_msgs::Nostril::ConstPtr &nose) |
void | posesCallback (const fctuc_open_day::Poses::ConstPtr &poses) |
Variables | |
roomba_500_series::Battery | battery |
bool | needToBackUp |
bool | sendNewGoal |
std::vector < geometry_msgs::Pose2D > ::iterator | target |
std::vector < geometry_msgs::Pose2D > | targets |
typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient |
void batteryCallback | ( | const roomba_500_series::Battery::ConstPtr & | batt | ) |
void goalActiveCallback | ( | ) |
void goalDoneCallback | ( | const actionlib::SimpleClientGoalState & | state, |
const move_base_msgs::MoveBaseResultConstPtr & | result | ||
) |
void goalFeedbackCallback | ( | const move_base_msgs::MoveBaseFeedbackConstPtr & | feedback | ) |
void noseCallback | ( | const lse_sensor_msgs::Nostril::ConstPtr & | nose | ) |
void posesCallback | ( | const fctuc_open_day::Poses::ConstPtr & | poses | ) |
bool needToBackUp |
bool sendNewGoal |