Install pigpio:
Follow instructions in:
https://abyz.me.uk/rpi/pigpio/download.html
wget https://github.com/joan2937/pigpio/archive/master.zip
unzip master.zip
cd pigpio-master
make
sudo make install
Install EigenDense:
sudo apt-get install libeigen3-dev
Install ros-sensor_msgs_ext:
git clone https://github.com/pcdangio/ros-sensor_msgs_ext.git
ROS web page for IMU sensors:
http://wiki.ros.org/Sensors/Pose%20Estimation
http://wiki.ros.org/Sensors#Pose_Estimation_.28GPS.2FIMU.29
Install mpu9250 ros driver node:
git clone https://github.com/pcdangio/ros-driver_mpu9250.git src/driver_mpu9250
Clone repository to your catkin_ws/src/
git clone https://github.com/sbgisen/wt901b_ros.git
- Rename all “wt901B” to “wt901b”, including file names
Launch the node
roslaunch wt901b_ros wt901B_ros.launch
WIT repositories:
git clone https://github.com/Rophier/WIT-IMU.git
git clone https://github.com/yowlings/wit_node
sudo apt install ros-noetic-ecl-*
sudo apt install ros-noetic-geometry2
Install IMU-tools for get correct orientation
sudo apt-get install ros-noetic-imu-tools
Install complementary filter (comes with launch file):
sudo apt install ros-noetic-imu-complementary-filter
Install tf_conversions:
sudo apt-get install python-tf-conversions
sudo apt-get install ros-noetic-geometry