#include <depthai/depthai.hpp>#include <depthai_bridge/depthaiUtility.hpp>#include <iostream>#include <opencv2/opencv.hpp>#include <sstream>#include <unordered_map>#include <ros/ros.h>#include <boost/make_shared.hpp>#include "sensor_msgs/Imu.h"

Go to the source code of this file.
Classes | |
| class | dai::ros::ImuConverter |
Namespaces | |
| dai | |
| dai::ros | |
Typedefs | |
| using | dai::ros::ImuPtr = ImuMsgs::Imu::Ptr |
Enumerations | |
| enum | dai::ros::ImuSyncMethod { dai::ros::ImuSyncMethod::COPY, dai::ros::ImuSyncMethod::LINEAR_INTERPOLATE_GYRO, dai::ros::ImuSyncMethod::LINEAR_INTERPOLATE_ACCEL } |