mavros icon indicating copy to clipboard operation
mavros copied to clipboard

MAVLink to ROS gateway with proxy for Ground Control Station

Results 270 mavros issues
Sort by recently updated
recently updated
newest added

This is only bug and feature tracker, please use it to report bugs or request features. ---- ### Issue details Hi, I'm having issues connecting using mavros to ardupilot rover....

question

Hey guys, I would like to learn how to properly use **/mavros/setpoint_raw/target_attitude** messages to command the FCU to a particular orientation angle. Right now I create a **mavros_msgs.AttitudeTarget** and publish...

### Issue details I wasn't sure if this is the right repository, but posting it here for @vooon 's attention There has not been a `mavlink-gbp-release` for Ubuntu focal for...

Hi, I'm using pixhawk 2.4.8 with px4 latest firmware now while launching the px4.launch file I'm not getting any data with topic **/mavros/imu/data_raw**(rostopic echo /mavros/imu/data_raw) although when I echo the...

question

Fills out the rangefinder properties (`field of view`, `min_range`, and `max_range`) in the `rangefinder_msg` from the mavlink message. I haven't updated the `radiation_type` field as the enums in the [sensors_mgs::Range](http://docs.ros.org/en/noetic/api/sensor_msgs/html/msg/Range.html)...

enhancement
plugin
extras

### Issue details Setup: Try to set mode to OFFBOARD via service `/mavros/set_mode`. Issue: Get warning `[WARN] [1659439086.350950582] [mavros.cmd]: CMD: Unexpected command 176, result 1` Might be caused by [issue...

### Issue details I'm trying to detect if I get TYPE_GCS heartbeat. How can I do it with mavros? I wonder if sys_status plugin may help but I didn't understand...

question
ros2

---- Hi, I'm currently trying to send angular velocities or PWM to the rotors in order to control them individually. I found out that the way to do it is...

question
APM

### Issue details When I try to perform an offboard mission test (1 meter take off & 1 sec hover and then landing) with my drone based on [these script](https://github.com/RuslanAgishev/px4_control),...

We could try to continue use of xml, but probably launch.py would be preferable.

ros2
help wanted