-
Hi developers,
We are currently working on a px4 project but we need to verify the simulated results before we want to deploy it on the real drone. However, a problem has come to our mind that o…
-
### Describe the bug
when I use `MacOS Development Environment`, after:
```
git clone https://github.com/PX4/PX4-Autopilot.git --recursive
cd PX4-Autopilot/Tools/setup
sh macos.sh
```
output…
-
### Describe the bug
PX4 software-in-the-loop calculates the airspeed using differential pressure in ***SensorAirspeed.cpp*** in the ***simulation*** module. However, SensorAirspeed.cpp generates the…
-
Hi, I was running PX4 based on NuttX on esp32s3 and found an error.
a float data will be nan after a simple multiplication.
![nan_float](https://github.com/apache/nuttx/assets/40821031/5d326f3a-652e…
-
After https://github.com/PX4/PX4-Autopilot/pull/22313 you have to use ROS2 services to send VehicleCommands.
Doc update is required.
Example of usage is here: https://github.com/PX4/px4_ros_com/pu…
-
## Describe the bug
in `PX4-Autopilot/build/px4_sitl_rtps/src/modules/micrortps_bridge/micrortps_agent/build`, run make, have error. In the generated code is Timesync_Publisher.h but the file is name…
-
You write:
> ArduPilot and PX4 autopilots do not yet safely support vision based precision landing.
Your project is utterly compelling. Why do you say the above? Are you saying that the shortco…
-
I just want to inform you that the CMakeLists.txt file needs to be updated to include physics_msgs:
`install(TARGETS ${plugins} mav_msgs nav_msgs std_msgs sensor_msgs physics_msgs DESTINATION ${PLUGI…
-
## Description
This is an issue to track tasks & have discussions on improving the Control Allocation user experience. I previously had a google doc to keep these tracked, but now making it public on…
-
Hello,
Testing the take_off action (void ModeExecutorBase::takeoff). I realized that the heading was not taken into account.
Given my quick investigation, this is due to the handling on PX4 sid…