Classes | Variables
create_driver.h File Reference
#include "ca_msgs/ChargingState.h"
#include "ca_msgs/Mode.h"
#include "ca_msgs/Bumper.h"
#include "ca_msgs/DefineSong.h"
#include "ca_msgs/PlaySong.h"
#include "create/create.h"
#include <diagnostic_updater/diagnostic_updater.h>
#include <geometry_msgs/TransformStamped.h>
#include <geometry_msgs/Twist.h>
#include <nav_msgs/Odometry.h>
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
#include <std_msgs/Bool.h>
#include <std_msgs/Empty.h>
#include <std_msgs/Float32.h>
#include <std_msgs/Int16.h>
#include <std_msgs/UInt16.h>
#include <std_msgs/UInt8MultiArray.h>
#include <tf/transform_broadcaster.h>
#include <limits>
#include <string>
Include dependency graph for create_driver.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  CreateDriver

Variables

static const double COVARIANCE [36]
static const double MAX_DBL = std::numeric_limits<double>::max()

Detailed Description

Software License Agreement (BSD)

Authors:
Jacob Perron <jacobmperron@gmail.com>

Definition in file create_driver.h.


Variable Documentation

const double COVARIANCE[36] [static]
Initial value:
 {1e-5, 1e-5, 0.0,     0.0,     0.0,     1e-5,  
                                      1e-5, 1e-5, 0.0,     0.0,     0.0,     1e-5,
                                      0.0,  0.0,  MAX_DBL, 0.0,     0.0,     0.0,
                                      0.0,  0.0,  0.0,     MAX_DBL, 0.0,     0.0,
                                      0.0,  0.0,  0.0,     0.0,     MAX_DBL, 0.0,
                                      1e-5, 1e-5, 0.0,     0.0,     0.0,     1e-5}

Definition at line 56 of file create_driver.h.

const double MAX_DBL = std::numeric_limits<double>::max() [static]

Definition at line 55 of file create_driver.h.



ca_driver
Author(s): Jacob Perron
autogenerated on Thu Jun 6 2019 20:38:21