$search
#include <ros/ros.h>
#include <nav_msgs/Odometry.h>
#include <sensor_msgs/Imu.h>
#include <art_msgs/BrakeCommand.h>
#include <art_msgs/BrakeState.h>
#include <art_msgs/Shifter.h>
#include <art_msgs/SteeringCommand.h>
#include <art_msgs/SteeringState.h>
#include <art_msgs/ThrottleCommand.h>
#include <art_msgs/ThrottleState.h>
#include "device_interface.h"
Go to the source code of this file.
Classes | |
class | device_interface::DeviceBrake |
class | device_interface::DeviceImu |
class | device_interface::DeviceOdom |
class | device_interface::DeviceShifter |
class | device_interface::DeviceSteering |
class | device_interface::DeviceThrottle |
Namespaces | |
namespace | device_interface |
ART autonomous vehicle device interface implementations for pilot node.
This is an implementation header. It is only included by pilot.cc, to instantiate the derived classes. Any other modules using these interfaces should include device_interface.h, instead.
Definition in file device_impl.h.