#include <string>#include <boost/thread/mutex.hpp>#include <stage.hh>#include <ros/ros.h>#include <tf/transform_broadcaster.h>#include <art_msgs/BrakeState.h>#include <sensor_msgs/Imu.h>#include <nav_msgs/Odometry.h>#include <art_msgs/Shifter.h>#include <art_msgs/SteeringState.h>#include <art_msgs/ThrottleState.h>

Go to the source code of this file.
Classes | |
| class | ArtVehicleModel |
Defines | |
| #define | BRAKE_STATE "brake/state" |
| #define | SHIFTER_STATE "shifter/state" |
| #define | STEERING_STATE "steering/state" |
| #define | THROTTLE_STATE "throttle/state" |
Model speed and turn rate of the ART autonomous vehicle.
Definition in file vehicle_model.h.
| #define BRAKE_STATE "brake/state" |
Definition at line 39 of file vehicle_model.h.
| #define SHIFTER_STATE "shifter/state" |
Definition at line 40 of file vehicle_model.h.
| #define STEERING_STATE "steering/state" |
Definition at line 41 of file vehicle_model.h.
| #define THROTTLE_STATE "throttle/state" |
Definition at line 42 of file vehicle_model.h.