3 #include <depthai/depthai.hpp> 6 #include <opencv2/opencv.hpp> 8 #include <unordered_map> 11 #include "rclcpp/rclcpp.hpp" 12 #include "sensor_msgs/msg/imu.hpp" 16 #include <boost/make_shared.hpp> 18 #include "sensor_msgs/Imu.h" 26 namespace ImuMsgs = sensor_msgs::msg;
27 using ImuPtr = ImuMsgs::Imu::SharedPtr;
39 double linear_accel_cov = 0.0,
40 double angular_velocity_cov = 0.0);
42 void toRosMsg(std::shared_ptr<dai::IMUData> inData, std::deque<ImuMsgs::Imu>& outImuMsg);
45 void FillImuData_LinearInterpolation(std::vector<IMUPacket>& imuPackets, std::deque<ImuMsgs::Imu>& imuMsgs);
46 ImuMsgs::Imu CreateUnitMessage(dai::IMUReportAccelerometer accel, dai::IMUReportGyroscope gyro);
50 const std::string _frameName =
"";
54 rclcpp::Time _rosBaseTime;
std::chrono::time_point< std::chrono::steady_clock > _steadyBaseTime