$search

stageros.cpp File Reference

#include <stdio.h>
#include <stdlib.h>
#include <string.h>
#include <sys/types.h>
#include <sys/stat.h>
#include <unistd.h>
#include <signal.h>
#include <stage.hh>
#include <ros/ros.h>
#include <boost/thread/mutex.hpp>
#include <boost/thread/thread.hpp>
#include <sensor_msgs/LaserScan.h>
#include <nav_msgs/Odometry.h>
#include <geometry_msgs/Twist.h>
#include <rosgraph_msgs/Clock.h>
#include "tf/transform_broadcaster.h"
Include dependency graph for stageros.cpp:

Go to the source code of this file.

Classes

class  StageNode

Defines

#define BASE_POSE_GROUND_TRUTH   "base_pose_ground_truth"
#define BASE_SCAN   "base_scan"
#define CMD_VEL   "cmd_vel"
#define ODOM   "odom"
#define USAGE   "stageros <worldfile>"

Functions

int main (int argc, char **argv)
void sigint_handler (int num)

Variables

static bool quit = false

Define Documentation

#define BASE_POSE_GROUND_TRUTH   "base_pose_ground_truth"

Definition at line 54 of file stageros.cpp.

#define BASE_SCAN   "base_scan"

Definition at line 53 of file stageros.cpp.

#define CMD_VEL   "cmd_vel"

Definition at line 55 of file stageros.cpp.

#define ODOM   "odom"

Definition at line 52 of file stageros.cpp.

#define USAGE   "stageros <worldfile>"

Definition at line 51 of file stageros.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 410 of file stageros.cpp.

void sigint_handler ( int  num  ) 

Definition at line 404 of file stageros.cpp.


Variable Documentation

bool quit = false [static]

Definition at line 402 of file stageros.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Friends Defines


stage
Author(s): Richard Vaughan, with contributions from many others. See web page for a full credits list.
autogenerated on Sat Mar 2 13:48:25 2013