I’m trying to modify Gazebo’s source code from the gz-sim repo and rebuild it to run with make px4_sitl gz_r1_rover
using my custom build. After following the Source Install from Gazebo, my changes aren’t appearing in the simulation, suggesting it’s still using the standard Gazebo installation. Is there an environment variable I need to set to make PX4 use my local Gazebo build?
This is important for a gz-sim PR I’m planning, to update the mecanum plugin for individual wheel control, in addition to the current body (x,y) and angular (z) velocity controls, as the PX4 side will manage inverse kinematics.