Typedefs | Enumerations | Functions | Variables
move_base_simple.cpp File Reference
#include <ros/ros.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Twist.h>
#include <nav_msgs/Odometry.h>
#include <tf/tf.h>
#include <angles/angles.h>
Include dependency graph for move_base_simple.cpp:

Go to the source code of this file.

Typedefs

typedef enum _SimpleNavigationState SimpleNavigationState

Enumerations

enum  _SimpleNavigationState {
  SN_STOPPED = 1, SN_MOVING = 2, SN_ROTATING = 3, SN_MOVING_AS = 4,
  SN_ROTATING_AS = 5, SN_STOPPED = 1, SN_MOVING = 2, SN_ROTATING = 3,
  SN_MOVING_AS = 4, SN_ROTATING_AS = 5
}

Functions

void goalReceived (const geometry_msgs::PoseStamped::ConstPtr &msg)
int main (int argc, char **argv)
void odomReceived (const nav_msgs::Odometry::ConstPtr &msg)

Variables

std::string global_frame_id
geometry_msgs::PoseStamped goal
nav_msgs::Odometry odom
bool rotate_in_place
SimpleNavigationState state

Typedef Documentation


Enumeration Type Documentation

Enumerator:
SN_STOPPED 
SN_MOVING 
SN_ROTATING 
SN_MOVING_AS 
SN_ROTATING_AS 
SN_STOPPED 
SN_MOVING 
SN_ROTATING 
SN_MOVING_AS 
SN_ROTATING_AS 

Definition at line 46 of file move_base_simple.cpp.


Function Documentation

void goalReceived ( const geometry_msgs::PoseStamped::ConstPtr &  msg)

Definition at line 69 of file move_base_simple.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 83 of file move_base_simple.cpp.

void odomReceived ( const nav_msgs::Odometry::ConstPtr &  msg)

Definition at line 77 of file move_base_simple.cpp.


Variable Documentation

std::string global_frame_id

Definition at line 60 of file move_base_simple.cpp.

geometry_msgs::PoseStamped goal

Definition at line 63 of file move_base_simple.cpp.

nav_msgs::Odometry odom

Definition at line 65 of file move_base_simple.cpp.

Definition at line 67 of file move_base_simple.cpp.

Definition at line 57 of file move_base_simple.cpp.



move_base_simple
Author(s): Gonçalo Cabrita
autogenerated on Mon Jan 6 2014 11:25:58