-
## Describe the bug
In PX4-Autopilot/boards/px4/fmu-v6x/default.px4board is missing parameter for setting up telemetry port.
File path : PX4-Autopilot/boards/px4/fmu-v6x/default.px4board
Missing l…
-
from /usr/include/gazebo-9/gazebo/sensors/CameraSensor.hh:22,
from /home/lamda/px4/PX4-Autopilot/Tools/sitl_gazebo/include/gazebo_geotagged_images_plugin.h:23,
…
-
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…
-
Hello! I have a question about the using the PX4-Autopilot package with the gazebo-classic simulator and ROS2 Foxy. In the github repository of the PX4-Autopilot package under this path “PX4-Autopilo…
-
## Describe the bug
`make scumaker_pilotpi_default` fails with:
```
[...]/PX4-Autopilot/src/drivers/distance_sensor/lightware_laser_serial/lightware_laser_serial.cpp: In member function ‘virtual vo…
-
So for my PR https://github.com/PX4/PX4-Autopilot/pull/17100, I'm bringing this new python module kconfiglib, unfortunely I've lost count on which places I've had to add the dependencies.
Would it …
-
Hi,
Having problem with building the code.
Command:
$ make px4_fmu-v3_default
Generating C implementation in directory /cygdrive/c/PX4/home/PX4-Autopilot/build/px4_fmu-v3_default/mavlink/com…
-
I want to debug the px4 firmware using GDB in Linux(ubuntu)
I followed as same as in the documentation
https://dev.px4.io/v1.11_noredirect/en/debug/simulation_debugging.html
and I started simul…
-
# TL;DR
`px4_breaktrace` does not continue to run after `break` despite `continue`
The MCU halts forever and thus only one function call is sampled.
# What?
I want to create a callgraph for some…
-
### Describe the bug
Attempting to run `make px4_sitl gazebo-classic` fails on Ubuntu 20.04. Specifically, I get the following output:
```
alex@UbuntuVM20:~/dev/PX4-Autopilot$ make px4_sitl gazebo-…