mkdir -p ~/ros2_ws/src && cd ~/ros2_ws/src
git clone git@github.com:omeredemen/px4_odometry.git
# before build please be sure px4_msgs package is sourced on your system
colcon build
# after build
source ~/ros2_ws/install/setup.bash
px4_odom
package contains a node called px4_odom_node
, some launch and config files.
px4_odom_node provides some features:
- Subscribe the odometry topics and get odometry messages from VIO packages and convert them to
VehicleOdometry
messages that can be understandable by PX4. - Publish these messages to
/fmu/in/vehicle_visual_odometry
topic. - This node gets
VehicleOdometry
messages from PX4 and broadcast astf
Also this package contains some launch files. This file can be used for starting realsense2_camera
, openvins
, rtabmap_ros
packages.
Here list of launch files and their usage:
-
px4_odom.launch.py
: this file startspx4_odom_node
. Its config file’s name is config.yaml and here is its contextsensor_debug: true broadcast_tf: true vio_topic: "/ov_msckf/odomimu" px4_pose_topic: "/px4_odom/pose"
-
rs_openvins.launch.py
: this launch file startsrealsense2_camera
andov_msckf
packages. A file path that has configurations for openvins needs to be passed in command line.ros2 launch px4_odom rs_openvins.launch.py openvins_config_path:=/home/omer/rs_d456_stereo/estimator_config.yaml
-
rs_rtapmab.launch.py
: this launch file startsrealsense2_camera
andrtabmap_ros
packages.ros2 launch px4_odom rs_rtabmap.launch.py
-
rs.launch.py
: this file starts realsense2_camera withconfig/rs_stereo.yaml
ros2 launch px4_odom rs.launch.py