Precision Landing with ROS, Realsense T265 Camera and AprilTag 3 - Part 2⁄2

1. Introduction

This is the second half of the 2-part blog posts. See part 1 if you are interested in a Python implementation of this same project but not related to Robot Operating System.

Synopsis

Utilizing the Intel RealSense Tracking Camera T265 for multiple purposes:

  1. Stable, accurate GPS-less flight with its standalone 6-dof (200Hz): The first and foremost usage of the VIO tracking camera, which has been realized in this GSoC 2019 project. Wikis are available for non-ROS (Python) and ROS (C++) support.
  2. Precision landing: without (part 1) and with (part 2, this blog post) ROS.

In the below sections I will first briefly outline the system, followed by a step-by-step guide to make the system work and actual experimental process, and finally some discussions on the many choices for implementation. Note that details on some parts will be omitted if they are already covered in the linked wikis or previous blog posts.

Let’s dive in.

2. Prerequisite

Hardware

  • Vehicle: A copter vehicle to your liking. If you are new to the DIY world, the Copter wiki is your one-stop shop for all the basics that you need to learn.
  • Onboard computer: a Linux system with USB3 port(s) is required. The Up board is what I am using, but the Jetson Nano or RPi 4 are also suitable alternatives for low budget setup.
  • Sensor: the Realsense T265 camera in downfacing configuration (USB port pointing to the right of the vehicle). Different camera orientations require some parameter modifications.
  • Landing target: One AprilTag’s fiducial marker printed, measured and fixed to the landing surface.

Software

Prepare the landing target

  • First, select (or create) the tag that you want to use as a landing target. Say you decide to use tag id 00 of the 36h11 type. Print, measure and note down the actual tag’s size (the black part of the tag), which should be 0.144m if printed on an A4 paper.

  • Fix the tag to some landing pad or to the ground, make sure that it won’t get blown away when the copter is descending.

The pdf for all tags of the 36h11 family can be found here. Other tag options can be found here.

3. How does it work?

How to perform accurate localization and navigation in ROS?

You can take a look at our past GSoC 2019 project for a complete explaination on the VIO integration part.

How to perform precision landing in ROS?

In a nutshell, the process includes:

  1. Obtaining the raw images from the downfacing camera.
  2. Applying the computer vision algorithm of choice to acquire the target.
  3. Performing requisite calculation to obtain the right kind of data for the flight stack in use, then send them to the FCU.
  4. Experimenting to figure out the limits of the system, which include things like the min-max target detection range for a given target size, min-max data rate for a stable landing and how it affects other parts of the system, tuning parameters to achieve desired results, etc.

The main purpose of this blog post is demonstrating how to realize step #1-#3 for one specific setup which includes the Intel Realsense T265 as the sensor of choice, AprilTag as the target detection algorithm, and ArduPilot as our flight stack.

More specifically, below are the main components of our ROS-based precision landing system given the aforementioned setup:

ID Launch command Description
1 roslaunch realsense2_camera rs_t265.launch The camera driver node realsense-ros, which publishes all raw data, including images in the topics /camera/fisheye1/image_raw and /camera/fisheye2/image_raw.
2 roslaunch vision_to_mavros t265_fisheye_undistort.launch A node that subscribes to the raw stereo images, undistorts and rectifies them, then publishes the rectified images as well as corresponding camera_info topics.
3 roslaunch apriltag_ros continuous_detection.launch ROS wrapper node for the apriltag visual fiducial marker system which takes in rectified image and corresponding camera_info topics to detect and calculate the tag’s pose relative to the camera frame, given accurate configurations in the tags.yaml file.
4 roslaunch vision_to_mavros t265_downfacing_tf_to_mavros.launch 1. Transform 6-DoF pose data from T265 to VISION_POSITION_ESTIMATE data for mavros.
2. Transform landing tag’s pose in the camera frame (output from apriltag_ros) into LANDING_TARGET data for MAVROS.
5 roslaunch mavros apm.launch MAVROS node for communication between ROS and ArduPilot.

4. Installation

A quick clarification before we start:

  • apriltag_ros (and mavros, if built from source) is built with catkin build, whereas vision_to_mavros (and realsense-ros, if built from source) is built with catkin_make.
  • Thus, there are two separate catkin workspaces (catkin_ws for catkin_make, and catkin_ws_build for catkin build) in the sections below.

Install AprilTag 3 library and ROS wrapper

  • Note that apriltag_ros requires catkin build workspace, which must be separated from catkin_make workspace for realsense-ros (if built from source) and vision_to_mavros packages.

  • The commands below are adopted from the apriltag_ros repo. Always check the repo for the most up-to-date instructions. Currently, ROS Kinetic and Melodic are supported.

export ROS_DISTRO=kinetic               # Set this to your distro, e.g. kinetic or melodic
source /opt/ros/$ROS_DISTRO/setup.bash  # Source your ROS distro 
mkdir -p ~/catkin_ws_build/src          # Make a new workspace, change the name if you have a catkin_ws folder created with catkin_make
cd ~/catkin_ws_build/src                                        # Navigate to the source space
git clone https://github.com/AprilRobotics/apriltag.git         # Clone Apriltag library
git clone https://github.com/AprilRobotics/apriltag_ros.git     # Clone Apriltag ROS wrapper
cd ~/catkin_ws_build                                            # Navigate to the workspace
rosdep install --from-paths src --ignore-src -r -y  # Install any missing packages
catkin build                                        # Build all packages in the workspace (catkin_make_isolated will work also)
source devel/setup.bash   # Make sure to source otherwise ros cannot find the nodes from this workspace
  • The default installation will place headers in /usr/local/include and shared library in /usr/local/lib. Python wrapper will also be installed if python3 is installed.

Install vision_to_mavros package

mkdir -p ~/catkin_ws/src
cd ~/catkin_ws/src
git clone https://github.com/hoangthien94/vision_to_mavros.git
cd ..
catkin_make
echo "source ~/catkin_ws/devel/setup.bash" >> ~/.bashrc  # Add source command to .bashrc, if you have not done so
source ~/.bashrc

Install mavros and establish connection between companion computer and ArduPilot

Follow the wiki page, then it would be simplier if all changes are included in apm.launch. Otherwise, remember to append the exact params (such as fcu_url) in all the subsequent launch commands for MAVROS.

5. Modification of parameters

After all packages are installed, certain parameters need to be changed for things to work properly.

Change camera calibration file for vision_to_mavros package according your specific device

These parameters are required to perform image rectification with the Kanalla-Brandt distortion model which is implemented in OpenCV as the “fisheye” module.

  1. Obtain the real params: With the T265 plugged in a computer with librealsense installed, you can run rs-enumerate-devices -c, which will show a host of information under the name Stream Profiles supported by Tracking Module. Example output of the command can be seen here.

  2. Then, modify the params K1, D1, K2, D2, R, T in the calibration file catkin_ws/src/vision_to_mavros/cfg/t265.yaml as follows:

Params in t265.yaml Description Output obtained from rs-enumerate-devices -c
K1 Intrinsic matrix of left camera Intrinsic of “Fisheye 1” : PPX, PPY, Fx, Fy
K2 Intrinsic matrix of right camera Intrinsic of “Fisheye 2” : PPX, PPY, Fx, Fy
D1 Distortion coefficients of left camera Intrinsic of “Fisheye 1” : First 4 numbers of Coeffs
D2 Distortion coefficients of right camera Intrinsic of “Fisheye 2” : First 4 numbers of Coeffs
R Rotation matrix from left camera to right camera Extrinsic from “Fisheye 1” To “Fisheye 2” : Rotation Matrix
T Translation vector from left camera to right camera Extrinsic from “Fisheye 1” To “Fisheye 2” : Translation Vector
with the camera matrix K as:
Fx 0 PPX
:—: :—: :—:
0 Fy PPY
0 0 1

Change configuration of apriltag_ros package according to the landing tag

  • Find the file apriltag_ros/apriltag_ros/config/tags.yaml and add a standalone tag with the actual id, size and set NAME as landing_target. For example, with the example A4 tag above we would have:

    standalone_tags:
    [
     {id: 0, size: 0.144, name: landing_target}
    ]
    

    The id and size are required for the AprilTag algorithm, and the name is the frame_id under which the tag’s pose in the camera frame would be published in the /tf ROS topic.

  • Next, modify camera_name, camera_frame and image_topic params in the launch file apriltag_ros/apriltag_ros/launch/continuous_detection.launch as follows:

    <arg name="camera_name" default="/camera/fisheye2/rect" />
    <arg name="camera_frame" default="camera_fisheye2_optical_frame" />
    <arg name="image_topic" default="image" />
    

    Where do these values come from? Note that the outputs from t265_fisheye_undistort node include:

    • Rectified image topics: /camera/fisheye1/rect/image (left) and /camera/fisheye2/rect/image (right).
    • Camera info topics: /camera/fisheye1/rect/camera_info (left) and /camera/fisheye1/rect/camera_info (right).

    and since apriltag_ros subscribes to $(arg camera_name)/$(arg image_topic), we split the image topic’s name into 2 parts, and we wish to use the right camera (fisheye2), thus we end up with the above params.

  • camera_frame can be anything, but the name of camera’s frame as published by realsense-ros is camera_fisheye2_optical_frame (default value for the right camera), thus we will also use it for consistency. This might come in handy for calculation related to /tf as well as visualization in RViz.

    Note: if you wish to use the left camera, simply find all instances of fisheye2 and change them into fisheye1 in 2 launch files: continuous_detection.launch and t265_downfacing_tf_to_mavros.launch.

  • Finally, make sure:

    • precland_target_frame_id in t265_downfacing_tf_to_mavros.launch must matches the tag’s name in apriltag_ros/apriltag_ros/config/tags.yaml, and
    • precland_camera_frame_id in t265_downfacing_tf_to_mavros.launch must matches camera_frame in apriltag_ros/apriltag_ros/launch/continuous_detection.launch.

Change MAVROS setting to allow relaying LANDING_TARGET messages

Navigate to mavros launch folder, edit the apm_config.yaml file and change listen_lt from false to true.

roscd mavros/launch
sudo nano apm_config.yaml
# Find landing_target, change liten_lt: true

ArduPilot params

  • The params required to facilitate VIO flight are documented in this wiki.
  • Set the following parameters through Mission Planner (or other GCS) to enable the precision landing feature and then reboot the flight controller.
    PLND_ENABLED = 1
    PLND_TYPE = 1
    
  • Setup the vehicle with one of the flight modes to LAND.
  • Other PLND_* param can be set according to your references, see here for the full list.

Once all of the params are set correctly, it’s time for some ground test.

6. Ground test

Let’s take the system apart, and test them one by one before any real flights. You might want to run the following commands one by one, make sure each of them produces the right results before moving on:

  1. roslaunch realsense2_camera rs_t265.launch: all the data from the tracking camera should be coming through, including the raw fisheye images:
  2. roslaunch vision_to_mavros t265_fisheye_undistort.launch: view the rectified image /camera/fisheye2/rect/image with rqt_image_view or RViz. Additionally, check that /camera/fisheye2/rect/camera_info are being published.
  3. roslaunch apriltag_ros continuous_detection.launch: view the detection image tag_detections_image with rqt_image_view or RViz. Then move the copter so that the camera points at the landing tag, then /tag_detections and /tf should publish the detected tag’s pose in the camera’s frame.
  4. roslaunch vision_to_mavros t265_downfacing_tf_to_mavros.launch: the ROS topics /mavros/vision_pose/pose and /mavros/landing_target/raw should be populated. The latter only has data coming in when the landing target is in the field of view of the camera (and distinguishable, i.e. not too far away or too close).
  5. roslaunch mavros apm.launch: there should be connection with the FCU, with messages popping up on the terminal.

After launching all the 5 nodes, hold the vehicle on top of the landing tag such that the camera can see the landing tag clearly. Then, check on the GCS:

Verify that ArduPilot is receiving LANDING_TARGET data

  • Whenever the landing tag is in the camera’s view and MAVROS is running correctly, view MAVLink messages on the GCS (Mission Planner: Ctrl+F > MAVLink Inspector, QGC: Widgets > MAVLink Inspector). LANDING_TARGET should have updated values in the angle_x, angle_y, distance fields (the rest are mostly ignored).
  • Move the camera around and check the values in all xyz directions are correct. In this project’s default configuration (USB port to the right), the camera’s x-axis will point to the right, y-axis will point to the back, and z-axis points downward (to the ground).

Verify that ArduPilot is receiving VISION_POSE data

  • Similarly, check that the message VISION_POSITION_ESTIMATE is coming through to the flight controller.

Improve detection rate of AprilTag if it is too low

Ideally, the LANDING_TARGET message should come at 10Hz and above for a smooth landing. If the output of AprilTag is lower than 10Hz (check the rate in ROS with rostopic hz /tag_detections, or in GCS with a stable telemetry connection or USB connection), you can improve the detection rate by checking out the corresponding ROS wiki and adjust the settings in settings.yaml, particularly the param tag_threads and tag_decimate.

7. Flight test

Once everything is confirmed to work properly, all of the individual launch files are grouped in the t265_precland.launch. Thus, for the flight tests the only command needed is:

roslaunch vision_to_mavros t265_precland.launch

Thereafter, we can simply follow the ArduPilot precision landing with IR-Lock wiki for instructions on how to actuate the landing in-flight. Below is a short summary:

  • For downfacing configuration of the Realsense T265, there is a problem with inconsistent yaw angle between runs. The temporary fix is to tilt the nose up a little, so that the camera is not facing flat down, when the script starts. Once the FCU starts receiving vision messages, the vehicle can be put flat on the ground.
    Initialization
  • Take-off and hover above the target.
  • When target is detected (see above about verifying that ArduPilot is receiving LANDING_TARGET data), you can switch the vehicle to LAND.
  • If everything is working properly, the copter should move towards then land on the tag.
  • As usual, be prepared to retake control if there are sudden unexpected movements (i.e. change back the mode to Stabilize, AltHold or Loiter).
  • If all is well, some successful flight tests can be seen below:

8. Discussion and alternative approaches

For this blog post, almost every steps have some alternatives that should be considered for your particular situation.

Fiducial marker system

There are many other options out there such as Aruco which is already supported in this wiki. Note that Aruco is now GPL licensed while AprilTag is using BSD license. The latest version of AprilTag (3) also support new and flexible layouts (circle, nested, etc.). You can find some comparisons in this paper.

Camera orientation

  • It is implicitly assumed that the camera’s x axis is aligned with the vehicle’s y axis (to the right) while the camera’s y axis aligned with the vehicle’s -x (to the back). This is the same as pitching the camera down 90 degrees from facing forward.
  • If your camera is oriented differently, then a transformation is mandatory. For reference, here’s the T265’s coordinates (note the fisheye’s axes), whereas the FCU’s local frame is (X Forward, Y Right and Z Down).

Image rectification for AprilTag detection

  • The AprilTag’s algorithm assumes rectified image and camera_info topics as input. Since the Kannala-Brandt distortion model (so-called fisheye model in OpenCV) employed by the T265 is not yet supported in the image_proc pipeline, we need to perform rectification in some other ways.

  • In this project, a new ROS node (t265_fisheye_undistort_node) was created which takes inspiration from the sample script t265_stereo.py but in C++ and ROS. Additionally, left and right images are also synced with ApproximateTime_Policy to produce time-synched rectified stereo images which might be useful for other purposes such as generating disparity maps, at the cost of a slightly reduced image rate compared to the raw data.

  • I would highly recommend you check out the image_undistort repo, which supports a number of other less popular models and a bunch of cool computer vision functions, however not the ones we specifically need for this project.

How to run MAVROS landing target plugin?

There seems to be no documentation anywhere on how to use the plugin correctly that I could find. Hence, to the source code!

Below is a brief rundown from my understanding of the code.

  • First, take a look at the main source code for landing_target plugin and the definition of the LandingTarget message.
  • All input params for this plugin can be set in this section of apm_config.yaml before launching mavros.
  • The data input type for landing_target plugin can be in 1 of 3 forms, as seen in this part:
    1. Through listening to /tf transform. Can be enabled by setting listen_tf to true.
    2. Through subscribing to /mavros/landing_target/pose messages (of type PoseStamped). Can be enabled by setting both listen_tf and listen_lt to false.
    3. Through subscribing to /mavros/landing_target/raw messages (of type LandingTarget). Can be enabled by setting listen_tf to false and listen_lt to true.
  • You can choose whichever input method that works for you. However, note that for option 1 and 2 (as of this writing) there are several ENU-NED frame transformation functions implemented in the code that one needs to decipher in order to get the correct output given an (presumably well-understood) input. Generally, follow the callback function for your type of input which will lead to this function to figure out the dataflow, frame conversions, related parameters and what goes where.
  • In this project, option 3 was selected for it provides the most control of the final MAVLink messages to be sent. Looky here. If you are working with PX4, however, the results might not be the same (see point below).

How to populate the LANDING_TARGET data messages?

  • If the landing tag is detected in the image, precision landing can be performed following MAVLink’s landing target protocol.
  • As of this writing, different flight stack (PX4 and AP) supports different kinds of input. See the MAVLink wiki for details. For ArduPilot, only LANDING_TARGET fields relative to the captured image are supported (hence the ignored fields in the LANDING_TARGET message).

9. Useful links

Happy flying!

9 Likes

Hello Tian
I am your big fan
In the video above, I am curious how to watch the realsense video and Rviz of the Raspberry Pi mounted on the drone.

Is this a TCP / UDP network? Or is it some sort of VNC?

Thank you.

In this post, I am using ROS, which maintains communication through the TCP network. On the other hand, if you take a look at Part1/2, VNC was used to view the images instead.

Hi Thien,

I followed this tutorial and it works beautifully most of the time. However, when it does not, I get an error about a NaN value in the camera_pose_frame. This error almost always happens when the drone is standing on the ground (camera pointing down) and when the camera`s odometry starts to drift significantly (probably due to the close proximity of the ground - not enough features for SLAM). I am using manual exposure (minimal settings to see the AprilTag) - the visibility of the tag is much worse with an automatic one (image is too bright). The error seems to happen after 7-15 minutes after the start of all the nodes.

Have you maybe had a similar issue, or might know a workaround this issue? Even if it does not show up as an error, the precision landing seems to be much jerkier when a significant drift has been accumulated.

Thank you a lot in advance!

Hi @DeafMic, from your description the problem comes from the T265: the NaN or drifted pose data are known issue with the T265 (see here for an example). The situations that you encountered the problems are also similar to my experience (too close to the ground, few features, high vibration etc.).

As of now the inner workings of the T265 is closed, so we can only observe the data and make necessary corrections. Below are some ideas that I have yet to implement:

  • For the NaN case, the solution can be: detect the issue (which is straightforward), save the last “good” pose, hard-reset the camera, then append the previous pose as a transformation to the new pose to make the pose data continuous.
    • Some potential problems with this approach: 1) the data might not simply changes from good->NaN but good->bad->NaN; 2) reset the camera on the flight might yield other issues that we don’t know about yet (timeout/confidence values etc.) hence more troubleshooting ensues;
  • For the drift case, only way I can think of is to have some additional sensor that can be used as a sanity check and reset the camera, like above, when the drift exceeds a certain threshold. For example, the T265’s z position shouldn’t be too far off from altitude data obtained from a rangefinder, or the changes of T265’s xy position should agree with optical flow.
    • Nonetheless, these ideas are just speculative, each has some underlying assumptions and would not be general, so there are no guarantees that they would actually work.

Hope this helps.

Is it for ArduCopter? You didn’t mention you only wrote ArduPilot. Is it compatible for all?

Read again as it mention COPTER as vehicle :wink:

Oh, okay, my bad. Sorry for being rude. Thanks a lot ppoirier :slight_smile:

No problem, most of activities are happening on the vision discord channel if you are interested

1 Like

I can come here to, I am learning most of the tips from you. Thanks again.

1 Like

Hi Tian.
I make drone with your blog.
I was roslaunch, some roslaunch is good. But some roslaunch is show the error message.

Do you read my error message. and give me some advice?

And my system is not equal your syste.

I change to right.

Mission Computer : Raspberry Pi → Jetson Nano
Flight Control : ardupilot ----> PX4

1 roslaunch realsense2_camera rs_t265.launch → [Good]
2 roslaunch vision_to_mavros t265_fisheye_undistort.launch → [Error]
3 roslaunch apriltag_ros continuous_detection.launch → [Error]
4 roslaunch vision_to_mavros t265_downfacing_tf_to_mavros.launch → [Good]
5 roslaunch mavros apm.launch → [Good]

====================================================================================================
​====================================================================================================
[ roslaunch vision_to_mavros t265_fisheye_undistort.launch LOG ]

kang@kang-desktop:~$ roslaunch vision_to_mavros t265_fisheye_undistort.launch
… logging to /home/kang/.ros/log/333bb5d6-8bd5-11ed-b171-48b02d5ba27a/roslaunch-kang-desktop-16702.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

started roslaunch server http://localhost:40327/

SUMMARY


PARAMETERS

  • /rosdistro: melodic
  • /rosversion: 1.14.13
  • /t265_fisheye_undistort/param_file_path: /home/kang/catkin…

    NODES
    /
    t265_fisheye_undistort (vision_to_mavros/t265_fisheye_undistort_node)

    ROS_MASTER_URI=http://localhost:11311

    process[t265_fisheye_undistort-1]: started with pid [16722]
    [ WARN] [1672798539.524992544]: Using parameter file: /home/kang/catkin_ws/src/vision_to_mavros/cfg/t265.yaml
    [t265_fisheye_undistort-1] process has died [pid 16722, exit code -11, cmd /home/kang/catkin_ws/devel/lib/vision_to_mavros/t265_fisheye_undistort_node __name:=t265_fisheye_undistort __log:=/home/kang/.ros/log/333bb5d6-8bd5-11ed-b171-48b02d5ba27a/t265_fisheye_undistort-1.log].
    log file: /home/kang/.ros/log/333bb5d6-8bd5-11ed-b171-48b02d5ba27a/t265_fisheye_undistort-1*.log
    all processes on machine have died, roslaunch will exit
    shutting down processing monitor…
    … shutting down processing monitor complete
    done
    kang@kang-desktop:~$
    kang@kang-desktop:~$
    kang@kang-desktop:~$
    kang@kang-desktop:~$
    kang@kang-desktop:~$
    kang@kang-desktop:~$
    kang@kang-desktop:~$

====================================================================================================
​====================================================================================================
[ roslaunch apriltag_ros continuous_detection.launch Error LOG ]

kang@kang-desktop:~$ roslaunch apriltag_ros continuous_detection.launch
RLException: [continuous_detection.launch] is neither a launch file in package [apriltag_ros] nor is [apriltag_ros] a launch file name
The traceback for the exception was written to the log file
kang@kang-desktop:~$
kang@kang-desktop:~$
kang@kang-desktop:~$

====================================================================================================
​====================================================================================================

[ roslaunch mavros apm.launch Error Log ]

kang@kang-desktop:~$ roslaunch mavros px4.launch
… logging to /home/kang/.ros/log/333bb5d6-8bd5-11ed-b171-48b02d5ba27a/roslaunch-kang-desktop-16834.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

started roslaunch server http://localhost:44601/

SUMMARY


CLEAR PARAMETERS

  • /mavros/

    PARAMETERS
  • /mavros/camera/frame_id: base_link
  • /mavros/cmd/use_comp_id_system_control: False
  • /mavros/conn/heartbeat_rate: 1.0
  • /mavros/conn/system_time_rate: 1.0
  • /mavros/conn/timeout: 10.0
  • /mavros/conn/timesync_rate: 10.0
  • /mavros/distance_sensor/hrlv_ez4_pub/field_of_view: 0.0
  • /mavros/distance_sensor/hrlv_ez4_pub/frame_id: hrlv_ez4_sonar
  • /mavros/distance_sensor/hrlv_ez4_pub/id: 0
  • /mavros/distance_sensor/hrlv_ez4_pub/orientation: PITCH_270
  • /mavros/distance_sensor/hrlv_ez4_pub/send_tf: True
  • /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/x: 0.0
  • /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/y: 0.0
  • /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/z: -0.1
  • /mavros/distance_sensor/laser_1_sub/id: 3
  • /mavros/distance_sensor/laser_1_sub/orientation: PITCH_270
  • /mavros/distance_sensor/laser_1_sub/subscriber: True
  • /mavros/distance_sensor/lidarlite_pub/field_of_view: 0.0
  • /mavros/distance_sensor/lidarlite_pub/frame_id: lidarlite_laser
  • /mavros/distance_sensor/lidarlite_pub/id: 1
  • /mavros/distance_sensor/lidarlite_pub/orientation: PITCH_270
  • /mavros/distance_sensor/lidarlite_pub/send_tf: True
  • /mavros/distance_sensor/lidarlite_pub/sensor_position/x: 0.0
  • /mavros/distance_sensor/lidarlite_pub/sensor_position/y: 0.0
  • /mavros/distance_sensor/lidarlite_pub/sensor_position/z: -0.1
  • /mavros/distance_sensor/sonar_1_sub/horizontal_fov_ratio: 1.0
  • /mavros/distance_sensor/sonar_1_sub/id: 2
  • /mavros/distance_sensor/sonar_1_sub/orientation: PITCH_270
  • /mavros/distance_sensor/sonar_1_sub/subscriber: True
  • /mavros/distance_sensor/sonar_1_sub/vertical_fov_ratio: 1.0
  • /mavros/fake_gps/eph: 2.0
  • /mavros/fake_gps/epv: 2.0
  • /mavros/fake_gps/fix_type: 3
  • /mavros/fake_gps/geo_origin/alt: 408.0
  • /mavros/fake_gps/geo_origin/lat: 47.3667
  • /mavros/fake_gps/geo_origin/lon: 8.55
  • /mavros/fake_gps/gps_rate: 5.0
  • /mavros/fake_gps/mocap_transform: True
  • /mavros/fake_gps/satellites_visible: 5
  • /mavros/fake_gps/tf/child_frame_id: fix
  • /mavros/fake_gps/tf/frame_id: map
  • /mavros/fake_gps/tf/listen: False
  • /mavros/fake_gps/tf/rate_limit: 10.0
  • /mavros/fake_gps/tf/send: False
  • /mavros/fake_gps/use_mocap: True
  • /mavros/fake_gps/use_vision: False
  • /mavros/fcu_protocol: v2.0
  • /mavros/fcu_url: /dev/ttyTHS1:115200
  • /mavros/gcs_url:
  • /mavros/global_position/child_frame_id: base_link
  • /mavros/global_position/frame_id: map
  • /mavros/global_position/gps_uere: 1.0
  • /mavros/global_position/rot_covariance: 99999.0
  • /mavros/global_position/tf/child_frame_id: base_link
  • /mavros/global_position/tf/frame_id: map
  • /mavros/global_position/tf/global_frame_id: earth
  • /mavros/global_position/tf/send: False
  • /mavros/global_position/use_relative_alt: True
  • /mavros/image/frame_id: px4flow
  • /mavros/imu/angular_velocity_stdev: 0.0003490659 // 0…
  • /mavros/imu/frame_id: base_link
  • /mavros/imu/linear_acceleration_stdev: 0.0003
  • /mavros/imu/magnetic_stdev: 0.0
  • /mavros/imu/orientation_stdev: 1.0
  • /mavros/landing_target/camera/fov_x: 2.0071286398
  • /mavros/landing_target/camera/fov_y: 2.0071286398
  • /mavros/landing_target/image/height: 480
  • /mavros/landing_target/image/width: 640
  • /mavros/landing_target/land_target_type: VISION_FIDUCIAL
  • /mavros/landing_target/listen_lt: True
  • /mavros/landing_target/mav_frame: LOCAL_NED
  • /mavros/landing_target/target_size/x: 0.3
  • /mavros/landing_target/target_size/y: 0.3
  • /mavros/landing_target/tf/child_frame_id: camera_center
  • /mavros/landing_target/tf/frame_id: landing_target
  • /mavros/landing_target/tf/listen: False
  • /mavros/landing_target/tf/rate_limit: 10.0
  • /mavros/landing_target/tf/send: True
  • /mavros/local_position/frame_id: map
  • /mavros/local_position/tf/child_frame_id: base_link
  • /mavros/local_position/tf/frame_id: map
  • /mavros/local_position/tf/send: False
  • /mavros/local_position/tf/send_fcu: False
  • /mavros/mission/pull_after_gcs: True
  • /mavros/mission/use_mission_item_int: True
  • /mavros/mocap/use_pose: True
  • /mavros/mocap/use_tf: False
  • /mavros/mount/debounce_s: 4.0
  • /mavros/mount/err_threshold_deg: 10.0
  • /mavros/mount/negate_measured_pitch: False
  • /mavros/mount/negate_measured_roll: False
  • /mavros/mount/negate_measured_yaw: False
  • /mavros/odometry/fcu/odom_child_id_des: base_link
  • /mavros/odometry/fcu/odom_parent_id_des: map
  • /mavros/plugin_blacklist: [‘safety_area’, '…
  • /mavros/plugin_whitelist: []
  • /mavros/px4flow/frame_id: px4flow
  • /mavros/px4flow/ranger_fov: 0.118682
  • /mavros/px4flow/ranger_max_range: 5.0
  • /mavros/px4flow/ranger_min_range: 0.3
  • /mavros/safety_area/p1/x: 1.0
  • /mavros/safety_area/p1/y: 1.0
  • /mavros/safety_area/p1/z: 1.0
  • /mavros/safety_area/p2/x: -1.0
  • /mavros/safety_area/p2/y: -1.0
  • /mavros/safety_area/p2/z: -1.0
  • /mavros/setpoint_accel/send_force: False
  • /mavros/setpoint_attitude/reverse_thrust: False
  • /mavros/setpoint_attitude/tf/child_frame_id: target_attitude
  • /mavros/setpoint_attitude/tf/frame_id: map
  • /mavros/setpoint_attitude/tf/listen: False
  • /mavros/setpoint_attitude/tf/rate_limit: 50.0
  • /mavros/setpoint_attitude/use_quaternion: False
  • /mavros/setpoint_position/mav_frame: LOCAL_NED
  • /mavros/setpoint_position/tf/child_frame_id: target_position
  • /mavros/setpoint_position/tf/frame_id: map
  • /mavros/setpoint_position/tf/listen: False
  • /mavros/setpoint_position/tf/rate_limit: 50.0
  • /mavros/setpoint_raw/thrust_scaling: 1.0
  • /mavros/setpoint_velocity/mav_frame: LOCAL_NED
  • /mavros/startup_px4_usb_quirk: False
  • /mavros/sys/disable_diag: False
  • /mavros/sys/min_voltage: 10.0
  • /mavros/target_component_id: 1
  • /mavros/target_system_id: 1
  • /mavros/tdr_radio/low_rssi: 40
  • /mavros/time/time_ref_source: fcu
  • /mavros/time/timesync_avg_alpha: 0.6
  • /mavros/time/timesync_mode: MAVLINK
  • /mavros/vibration/frame_id: base_link
  • /mavros/vision_pose/tf/child_frame_id: vision_estimate
  • /mavros/vision_pose/tf/frame_id: odom
  • /mavros/vision_pose/tf/listen: False
  • /mavros/vision_pose/tf/rate_limit: 10.0
  • /mavros/vision_speed/listen_twist: True
  • /mavros/vision_speed/twist_cov: True
  • /mavros/wheel_odometry/child_frame_id: base_link
  • /mavros/wheel_odometry/count: 2
  • /mavros/wheel_odometry/frame_id: odom
  • /mavros/wheel_odometry/send_raw: True
  • /mavros/wheel_odometry/send_twist: False
  • /mavros/wheel_odometry/tf/child_frame_id: base_link
  • /mavros/wheel_odometry/tf/frame_id: odom
  • /mavros/wheel_odometry/tf/send: False
  • /mavros/wheel_odometry/use_rpm: False
  • /mavros/wheel_odometry/vel_error: 0.1
  • /mavros/wheel_odometry/wheel0/radius: 0.05
  • /mavros/wheel_odometry/wheel0/x: 0.0
  • /mavros/wheel_odometry/wheel0/y: -0.15
  • /mavros/wheel_odometry/wheel1/radius: 0.05
  • /mavros/wheel_odometry/wheel1/x: 0.0
  • /mavros/wheel_odometry/wheel1/y: 0.15
  • /rosdistro: melodic
  • /rosversion: 1.14.13

    NODES
    /
    mavros (mavros/mavros_node)

    ROS_MASTER_URI=http://localhost:11311

    process[mavros-1]: started with pid [16852]
    [ INFO] [1672798682.367858453]: FCU URL: /dev/ttyTHS1:115200
    [ INFO] [1672798682.377068227]: serial0: device: /dev/ttyTHS1 @ 115200 bps
    [FATAL] [1672798682.377675114]: FCU: DeviceError:serial:open: Permission denied
    ================================================================================REQUIRED process [mavros-1] has died!
    process has finished cleanly
    log file: /home/kang/.ros/log/333bb5d6-8bd5-11ed-b171-48b02d5ba27a/mavros-1*.log
    Initiating shutdown!
    ================================================================================
    [mavros-1] killing on exit
    shutting down processing monitor…
    … shutting down processing monitor complete
    done
    kang@kang-desktop:~$
    kang@kang-desktop:~$ ​
    ​​

Hello,

If my camera orientation is facing outward vs downward, where would I apply this orientation transform? Additionally, would this method work on rovers as well?

Thank you,
Matt

Hi Tian,
Can you please tell me that what is benefits to perform precision landing with and without ROS ?

Hi @fuji_xd , I would say the main benefit of ROS is that it simplifies the development and integration of different modules by being the middleware for communication and coordination between nodes. On the flip side, you might need to allocate more resources (hardware, software) for ROS, which might be unnecessary if your application only focuses on a single thing.

If you are unfamiliar with ROS, I suggest exploring both options to know which is the best option for your case. Even if you don’t end up using ROS, there is no harm in adding a new tool to your toolbox.

I am also building an autonomous drone for my masters thesis and I am trying to use the vision to mavros with Intel realsense d455 and I am having a hard time implementing it can anyone assist me please. I will be very grateful