I have a Fixed Wing model built in Gazebo to use with HITL in a Pixhawk 5x. If I select the HILStar (Xplane) while the Pixhawk has the original firmware PX4 Pro Stable Release v1.12.3 it works well, the motors move in the simulation. If I make a new firmware using
make px4_fmu-v5x_default
and I uploaded through QGC the motors don’t respond, even when I select the same HILStar.
Something I noticed is that when using the custom firmware sometimes I cannot see the topic /gazebo/command/motor_speed
in gazebo and I just see
/gazebo/command/.
Something else is that this folder:
PX4-Autopilot/build/px4_sitl_default/build_gazebo
does not exist in this folder:
PX4-Autopilot/build/px4_fmu-v5x_default
I wonder if I missing something when I make px4_fmu-v5x_default
Also before starting the HITL simulation I tried the following:
~/PX4-Autopilot$ DONT_RUN=1 make px4_fmu-v5x_default gazebo
but I get this error:
ninja: error: unknown target 'gazebo', did you mean 'geo'?
make: *** [Makefile:230: px4_fmu-v5x_default] Error 1
Since my model needs two independent ailerons, basically I could just modify the HILStar mixer or add a new airframe, but this needs a new firmware to be uploaded which is giving the problem.
I would greatly appreciate some suggestion or some workaround.