156 questions
- Bountied 0
- Unanswered
- Frequent
- Score
- Trending
- Week
- Month
- Unanswered (my tags)
Advice
0
votes
2
replies
23
views
rotation matrix for sensor Body-axis to UAV Body-axis Conversion
My IMU is not aligned with the UAV body axis. Euler angles are [roll: 0 deg Pitch: 180 deg Yaw: 0.0 deg]. How can I translate IMU measurements to the UAV body axis? What rotation matrix should I use ...
1
vote
1
answer
87
views
„Why does my ICM-42688-P always read the same AX/AY/AZ values on PSoC (LED never changes)?"
I am using a PSoC 5LP together with the 6DOF IMU 14 Click (ICM-42688-P) from MikroE.
The IMU is connected via I2C, address 0x68, and the WHO_AM_I register correctly returns 0x47, so the sensor is ...
1
vote
0
answers
65
views
Issues interfacing BNO086 with STM32 using CubeIDE (I²C + interrupt/reset)
I am currently trying to read the angles from a BNO086 IMU using an STM32 microcontroller (using CubeIDE), and I use this library : https://www.grozeaion.com/electronics/stm32/stm32-i2c-library-for-...
0
votes
0
answers
126
views
ESP32 micro-ROS RPLIDAR N10 + MPU6050 publishes /scan & /imu/data_raw but SLAM Toolbox shows "No map received"
I’m building a handheld mapping setup with:
ESP32‐WROVER‐E running micro‐ROS
UART2 → RPLIDAR N10 → publishes /scan (sensor_msgs/LaserScan)
I2C → MPU6050 → publishes /imu/data_raw (sensor_msgs/Imu)
...
0
votes
0
answers
34
views
Problems with using VisPy to visualize the orientation of an IMU sensor, with RaspberryPi 4B
I have a project where I need to visualize the orientation of an IMU sensor as a 3D cube using VisPy, however, I keep getting the OSError: [Errno 5] Input/output error. I had another code using ...
0
votes
0
answers
220
views
Problem with the Pitch and Yaw data from IMU ICM20948
I'm having a problem on the yaw angle. The Roll and the Pitch are behaving correctly with values between -180° and 180°, but the Yaw gives me values between -25° and 30° and usually if I stop the ...
0
votes
0
answers
133
views
I3C In-band Interrupt on ICM-45686 IMU connected to STM32 MCU
I am communicating with the TDK's ICM-45686 sensor from a STM32H5 microcontroller through I3C however cannot seem to get I3C's In-band Interrupt (IBI) to work with the sensor. The datasheet explicitly ...
0
votes
0
answers
83
views
Bluetooth connectivity issues when connecting multiple Muse IMU devices with Python/Bleak
I'm currently am using python with bleak and I'm finding it difficult to connect and maintain a stable connection to multiple Bluetooth enabled imu devices (muse), especially when trying to connect ...
2
votes
0
answers
186
views
how to modify imu_filter_madgwick to transform RPY from imu_sensor frame to base_link frame?
I am utilizing imu_filter_madgwick (https://github.com/CCNYRoboticsLab/imu_tools/blob/noetic/imu_filter_madgwick/src/imu_filter_ros.cpp) (ros2 iron) to obtain roll, pitch, and yaw (RPY) from the ...
0
votes
0
answers
37
views
Issue with Magnetometer-Based Quaternion Heading Using Madgwick Algorithm
Currently, I am calculating quaternions using the Madgwick algorithm, incorporating magnetometer values. I have tried the code provided in Madgwick's original paper and also the implementation by Kris ...
0
votes
0
answers
92
views
My GPS Tracker Project Device Stops Working After 1-2 Months. Ublox MAX M10S, BMI270, JDY-23, STM32
I built a GPS tracker with an IMU that sends data via BLE 5.0. The device includes a button for power control: a single press turns it on, and another press turns it off (not a toggle switch). ...
1
vote
0
answers
63
views
IMU Data Integration for EuRoC Dataset in Python
I'm trying to derive the pose of a drone (x, y, z, roll, pitch, yaw) using IMU data in the form:
(timestamp, Angular Velocity X, Angular Velocity Y, Angular Velocity Z, Acceleration X, Acceleration Y, ...
1
vote
1
answer
344
views
How to transform IMU data from sensor frame to baselink frame?
I have two IMU sensors (front and rear) on my robot. I want to transform the linear acceleration data from both sensors to the robot's base_link frame and then calculate the pitch and roll using this ...
0
votes
1
answer
86
views
When using two sensors at the same time in an embedded system, I want to prevent performance loss
Currently, I am using the mpu6050 and uhf rfid module simultaneously on the lolin d32 pro (esp32) development board.
MPU6050 has a sampling rate of 100hz. I hope RFID also has a sampling rate of at ...
0
votes
1
answer
321
views
Creating a Device Tree Binding for LSM6DS3TR-C (only i2c nodes accepted issue)
I am trying to use the LSM6DS3TR-C IMU on the Seeed xiao sense board using Zephyr. Through discussions I have seen that the bindings of the examples only work in particular conditions so as a result I ...