pilot.cc File Reference

#include <ros/ros.h>
#include <angles/angles.h>
#include <algorithm>
#include <cmath>
#include <stdio.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include <boost/function.hpp>
#include <boost/thread/recursive_mutex.hpp>
#include <ros/node_handle.h>
#include <dynamic_reconfigure/ConfigDescription.h>
#include "ros/service_traits.h"
#include "dynamic_reconfigure/Config.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"
#include <art_msgs/ArtHertz.h>
#include "std_msgs/Header.h"
#include "art_msgs/CarDrive.h"
#include <art_msgs/Epsilon.h>
#include <art_msgs/Gear.h>
#include <art_msgs/PilotState.h>
#include <math.h>
#include <sys/time.h>
#include <time.h>
#include <angles/angles.h>
#include <art_msgs/ArtVehicle.h>
#include <art_pilot/PilotConfig.h>
#include "accel.h"
Include dependency graph for pilot.cc:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  PilotNode
 controls the ART vehicle brake, throttle, steering and transmission More...

Typedefs

typedef art_pilot::PilotConfig Config
typedef art_msgs::DriverState DriverState

Functions

int main (int argc, char **argv)

Detailed Description

ROS node for controlling direction and speed of the ART autonomous vehicle.

Todo:

(optionally) stop if no commands received recently.

shift to Park, when appropriate

distinguish device failures before and after initialization

deprecate old CarCommand message interface

Author:
Jack O'Quin

Definition in file pilot.cc.


Typedef Documentation

Definition at line 43 of file pilot.cc.

Definition at line 47 of file pilot.cc.


Function Documentation

int main ( int  argc,
char **  argv 
)

main entry point

Definition at line 525 of file pilot.cc.

 All Classes Namespaces Files Functions Variables Typedefs Friends Defines


art_pilot
Author(s): Austin Robot Technology, Jack O'Quin
autogenerated on Fri Jan 11 09:11:52 2013