#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 <roomba_500_series/GoDockAction.h>
#include <geometry_msgs/Twist.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) |
Variables | |
roomba_500_series::Battery | battery |
bool | needToBackUp |
bool | nextGoal |
typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient |
Definition at line 50 of file demo_not_working.cpp.
void batteryCallback | ( | const roomba_500_series::Battery::ConstPtr & | batt | ) |
Definition at line 79 of file demo_not_working.cpp.
void goalActiveCallback | ( | ) |
Definition at line 64 of file demo_not_working.cpp.
void goalDoneCallback | ( | const actionlib::SimpleClientGoalState & | state, |
const move_base_msgs::MoveBaseResultConstPtr & | result | ||
) |
Definition at line 57 of file demo_not_working.cpp.
void goalFeedbackCallback | ( | const move_base_msgs::MoveBaseFeedbackConstPtr & | feedback | ) |
Definition at line 69 of file demo_not_working.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 85 of file demo_not_working.cpp.
void noseCallback | ( | const lse_sensor_msgs::Nostril::ConstPtr & | nose | ) |
Definition at line 74 of file demo_not_working.cpp.
Definition at line 55 of file demo_not_working.cpp.
bool needToBackUp |
Definition at line 53 of file demo_not_working.cpp.
bool nextGoal |
Definition at line 52 of file demo_not_working.cpp.