Classes | Macros
inertial_sense_ros.h File Reference
#include <stdio.h>
#include <iostream>
#include <algorithm>
#include <string>
#include <cstdlib>
#include "InertialSense.h"
#include "ros/ros.h"
#include "ros/timer.h"
#include "sensor_msgs/Imu.h"
#include "sensor_msgs/MagneticField.h"
#include "sensor_msgs/FluidPressure.h"
#include "sensor_msgs/JointState.h"
#include "inertial_sense_ros/GPS.h"
#include "inertial_sense_ros/GPSInfo.h"
#include "inertial_sense_ros/PreIntIMU.h"
#include "inertial_sense_ros/FirmwareUpdate.h"
#include "inertial_sense_ros/refLLAUpdate.h"
#include "inertial_sense_ros/RTKRel.h"
#include "inertial_sense_ros/RTKInfo.h"
#include "inertial_sense_ros/GNSSEphemeris.h"
#include "inertial_sense_ros/GlonassEphemeris.h"
#include "inertial_sense_ros/GNSSObservation.h"
#include "inertial_sense_ros/GNSSObsVec.h"
#include "inertial_sense_ros/INL2States.h"
#include "nav_msgs/Odometry.h"
#include "std_srvs/Trigger.h"
#include "std_msgs/Header.h"
#include "geometry_msgs/Vector3Stamped.h"
#include "geometry_msgs/PoseWithCovarianceStamped.h"
#include "diagnostic_msgs/DiagnosticArray.h"
#include <tf/transform_broadcaster.h>
Include dependency graph for inertial_sense_ros.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  InertialSenseROS
 
struct  InertialSenseROS::ros_stream_t
 

Macros

#define GPS_UNIX_OFFSET   315964800
 
#define LEAP_SECONDS   18
 
#define SET_CALLBACK(DID, __type, __cb_fun, __periodmultiple)
 
#define UNIX_TO_GPS_OFFSET   (GPS_UNIX_OFFSET - LEAP_SECONDS)
 

Macro Definition Documentation

◆ GPS_UNIX_OFFSET

#define GPS_UNIX_OFFSET   315964800

Definition at line 38 of file inertial_sense_ros.h.

◆ LEAP_SECONDS

#define LEAP_SECONDS   18

Definition at line 39 of file inertial_sense_ros.h.

◆ SET_CALLBACK

#define SET_CALLBACK (   DID,
  __type,
  __cb_fun,
  __periodmultiple 
)
Value:
IS_.BroadcastBinaryData(DID, __periodmultiple, \
[this](InertialSense*i, p_data_t* data, int pHandle)\
{ \
/* ROS_INFO("Got message %d", DID);*/\
this->__cb_fun(reinterpret_cast<__type*>(data->buf));\
})
USBInterfaceDescriptor data
uint8_t buf[MAX_DATASET_SIZE]
Definition: ISComm.h:392

Definition at line 42 of file inertial_sense_ros.h.

◆ UNIX_TO_GPS_OFFSET

#define UNIX_TO_GPS_OFFSET   (GPS_UNIX_OFFSET - LEAP_SECONDS)

Definition at line 40 of file inertial_sense_ros.h.



inertial_sense_ros
Author(s):
autogenerated on Sun Feb 28 2021 03:17:59