#include <angles/angles.h>
#include <algorithm>
#include <cmath>
#include <stdio.h>
#include <math.h>
#include <sys/time.h>
#include <time.h>
#include <art/frames.h>
#include <stdlib.h>
#include <art/conversions.h>
#include <art_msgs/BrakeState.h>
#include <art_msgs/Shifter.h>
#include <art_msgs/SteeringState.h>
#include <art_msgs/ThrottleState.h>
#include <angles/angles.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 "std_msgs/Header.h"
#include "vehicle_model.h"
Go to the source code of this file.
Model speed and turn rate of the ART autonomous vehicle.
Definition in file vehicle_model.cc.