microstrain_mips
microstrain_mips copied to clipboard
As indicated by Frama-C, the string `System Initialization` (copied to `temp_string`) requires 22 bytes, including the null terminator, but the buffer was declared with only 20. The change has not...
**Problem** The timestamp in the IMU ROS message being published from this node is invalid and non-synchronous. After some investigation, we realized that the issue is originating from how the...
I am using Lord Microstrain GX5-15. I am trying to be consistent with the frame i.e., to get all of the IMU data in the same frame. I understand that...
When running the launch file in this repo, the 3DM-GX5-25 appears to give a few warnings as well as a parser error. I've attached screenshots of rqt_robot_monitor while running said...
Imu is on the robot. When the robot is rotating IMU(3DM-GX5-25) give value close to accurate but when we stop the robot for some time IMU output(yaw) keep increasing. I...
This PR applies a patch to how the NED to ENU swap is done. As pointed out in issue #4 when applying the X & Y swap with Z inverted...
Currently the streams for the AHRS are not included. For AHRS only units like the -25 it would be helpful to have include the covariance estimates in the sensor_msgs/Imu messages.
I was trying to run 3DM-GX5-35 model with this package. here is the output: `robin@robin-HP-Pavilion-Laptop-15-cc1xx:~/catkin_ws$ roslaunch microstrain_mips microstrain.launch ... logging to /home/robin/.ros/log/0bfa9dd4-a137-11e9-bb9b-88b111f58561/roslaunch-robin-HP-Pavilion-Laptop-15-cc1xx-3330.log Checking log directory for disk usage. This may...
I would like to know where on an IMU the "gx5_link" reference frame is located to build an accurate transform to it. Not all Lord IMU's are shaped the same,...
I see that a conversion is done from the NED quaternion returned from the INS into an ENU quaternion expected by ROS by swapping the x/y components and negating z....