Classes | Defines | Typedefs | Functions | Variables
artstage.cc 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 <tf/transform_broadcaster.h>
#include <rosgraph_msgs/Clock.h>
#include <art/frames.h>
#include "vehicle_model.h"
Include dependency graph for artstage.cc:

Go to the source code of this file.

Classes

class  StageNode

Defines

#define FRONT_LASER   "front_sick"
#define STAGE_VERSION   3
#define USAGE   "artstage [-g] [ <worldfile> ]"

Typedefs

typedef rosgraph_msgs::Clock Clock
typedef Stg::stg_model_callback_t model_callback_t
typedef Stg::ModelLaser StgLaser
typedef Stg::stg_world_callback_t world_callback_t

Functions

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

Variables

static bool quit = false

Detailed Description

ROS node for simulating the ART autonomous vehicle with Stage..

Todo:
handle multiple robots (code partially exists from stageros.cpp)
Todo:
map multiple lasers to their own frame and topic names
Todo:
terminate when stage window terminates
Author:
Brian Gerkey, Jack O'Quin

Definition in file artstage.cc.


Define Documentation

#define FRONT_LASER   "front_sick"

Definition at line 88 of file artstage.cc.

#define STAGE_VERSION   3

Definition at line 74 of file artstage.cc.

#define USAGE   "artstage [-g] [ <worldfile> ]"

Definition at line 85 of file artstage.cc.


Typedef Documentation

Definition at line 63 of file artstage.cc.

typedef Stg::stg_model_callback_t model_callback_t

Definition at line 76 of file artstage.cc.

typedef Stg::ModelLaser StgLaser

Definition at line 75 of file artstage.cc.

typedef Stg::stg_world_callback_t world_callback_t

Definition at line 77 of file artstage.cc.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 411 of file artstage.cc.

void sigint_handler ( int  num)

Definition at line 404 of file artstage.cc.


Variable Documentation

bool quit = false [static]

Definition at line 402 of file artstage.cc.



simulator_art
Author(s): Jack O'Quin
autogenerated on Fri Jan 3 2014 11:08:28