#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 <sensor_msgs/Image.h>#include <sensor_msgs/image_encodings.h>#include <sensor_msgs/CameraInfo.h>#include <nav_msgs/Odometry.h>#include <geometry_msgs/Twist.h>#include <rosgraph_msgs/Clock.h>#include <std_srvs/Empty.h>#include "tf/transform_broadcaster.h"
Go to the source code of this file.
Classes | |
| class | StageNode |
| struct | StageNode::StageRobot |
Defines | |
| #define | BASE_POSE_GROUND_TRUTH "base_pose_ground_truth" |
| #define | BASE_SCAN "base_scan" |
| #define | CAMERA_INFO "camera_info" |
| #define | CMD_VEL "cmd_vel" |
| #define | DEPTH "depth" |
| #define | IMAGE "image" |
| #define | ODOM "odom" |
| #define | USAGE "stageros <worldfile>" |
Functions | |
| int | main (int argc, char **argv) |
| #define BASE_POSE_GROUND_TRUTH "base_pose_ground_truth" |
Definition at line 62 of file stageros.cpp.
| #define BASE_SCAN "base_scan" |
Definition at line 61 of file stageros.cpp.
| #define CAMERA_INFO "camera_info" |
Definition at line 59 of file stageros.cpp.
| #define CMD_VEL "cmd_vel" |
Definition at line 63 of file stageros.cpp.
| #define DEPTH "depth" |
Definition at line 58 of file stageros.cpp.
| #define IMAGE "image" |
Definition at line 57 of file stageros.cpp.
| #define ODOM "odom" |
Definition at line 60 of file stageros.cpp.
| #define USAGE "stageros <worldfile>" |
Definition at line 56 of file stageros.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 735 of file stageros.cpp.