Make: *** [px4fmu-v2_default] Error 1

Hello everybody,
I changed my Ubuntu version on my computer and while i’m trying the make px4fmu-v2_default, an error occurred.
This is what Ubuntu says :
I already tried the “sudo apt-get install ninja-build” Then “make distclean” and “make px4fmu-v2_default” but it didn’t change anything.

What can I do ?

drone@drone-Precision-T1600:~/src/Firmware$ make px4fmu-v2_default
– PX4 VERSION: v1.8.0-1788-ge9fb17c51a
– CONFIG: nuttx_px4fmu-v2_default
– Build Type: MinSizeRel
CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:69 (message):
The CMAKE_FORCE_C_COMPILER macro is deprecated. Instead just set
CMAKE_C_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:30 (cmake_force_c_compiler)
/usr/share/cmake-3.10/Modules/CMakeDetermineSystem.cmake:94 (include)
CMakeLists.txt:176 (project)

CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:83 (message):
The CMAKE_FORCE_CXX_COMPILER macro is deprecated. Instead just set
CMAKE_CXX_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:36 (cmake_force_cxx_compiler)
/usr/share/cmake-3.10/Modules/CMakeDetermineSystem.cmake:94 (include)
CMakeLists.txt:176 (project)

CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:69 (message):
The CMAKE_FORCE_C_COMPILER macro is deprecated. Instead just set
CMAKE_C_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:30 (cmake_force_c_compiler)
build/nuttx_px4fmu-v2_default/CMakeFiles/3.10.2/CMakeSystem.cmake:6 (include)
CMakeLists.txt:176 (project)

CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:83 (message):
The CMAKE_FORCE_CXX_COMPILER macro is deprecated. Instead just set
CMAKE_CXX_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:36 (cmake_force_cxx_compiler)
build/nuttx_px4fmu-v2_default/CMakeFiles/3.10.2/CMakeSystem.cmake:6 (include)
CMakeLists.txt:176 (project)

– The ASM compiler identification is GNU
– Found assembler: /usr/bin/arm-none-eabi-gcc
– Found PythonInterp: /usr/bin/python (found version “2.7.15”)
– Found PY_jinja2: /usr/local/lib/python2.7/dist-packages/jinja2
– C compiler: arm-none-eabi-gcc (15:6.3.1+svn253039-1build1) 6.3.1 20170620
– C++ compiler: arm-none-eabi-g++ (15:6.3.1+svn253039-1build1) 6.3.1 20170620
– PX4 ECL: Very lightweight Estimation & Control Library v0.9.0-608-gacde4eb
– Building and including px4io-v2
– NuttX: px4fmu-v2 nsh cortex-m4
– ROMFS: px4fmu_common
– Configuring done
– Generating done
– Build files have been written to: /home/drone/src/Firmware/build/nuttx_px4fmu-v2_default
ninja: Entering directory `/home/drone/src/Firmware/build/nuttx_px4fmu-v2_default’
[0/647] git submodule platforms/nuttx/NuttX/nuttx
[1/647] git submodule src/lib/ecl
[2/647] git submodule src/drivers/gps/devices
[7/647] Building px4io-v2
– PX4 VERSION: v1.8.0-1788-ge9fb17c51a
– CONFIG: nuttx_px4io-v2_default
– Build Type: MinSizeRel
CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:69 (message):
The CMAKE_FORCE_C_COMPILER macro is deprecated. Instead just set
CMAKE_C_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:30 (cmake_force_c_compiler)
/usr/share/cmake-3.10/Modules/CMakeDetermineSystem.cmake:94 (include)
CMakeLists.txt:176 (project)

CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:83 (message):
The CMAKE_FORCE_CXX_COMPILER macro is deprecated. Instead just set
CMAKE_CXX_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:36 (cmake_force_cxx_compiler)
/usr/share/cmake-3.10/Modules/CMakeDetermineSystem.cmake:94 (include)
CMakeLists.txt:176 (project)

CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:69 (message):
The CMAKE_FORCE_C_COMPILER macro is deprecated. Instead just set
CMAKE_C_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:30 (cmake_force_c_compiler)
build/nuttx_px4io-v2_default/CMakeFiles/3.10.2/CMakeSystem.cmake:6 (include)
CMakeLists.txt:176 (project)

CMake Deprecation Warning at /usr/share/cmake-3.10/Modules/CMakeForceCompiler.cmake:83 (message):
The CMAKE_FORCE_CXX_COMPILER macro is deprecated. Instead just set
CMAKE_CXX_COMPILER and allow CMake to identify the compiler.
Call Stack (most recent call first):
cmake/toolchains/Toolchain-arm-none-eabi.cmake:36 (cmake_force_cxx_compiler)
build/nuttx_px4io-v2_default/CMakeFiles/3.10.2/CMakeSystem.cmake:6 (include)
CMakeLists.txt:176 (project)

– The ASM compiler identification is GNU
– Found assembler: /usr/bin/arm-none-eabi-gcc
– Found PythonInterp: /usr/bin/python (found version “2.7.15”)
– Found PY_jinja2: /usr/local/lib/python2.7/dist-packages/jinja2
– C compiler: arm-none-eabi-gcc (15:6.3.1+svn253039-1build1) 6.3.1 20170620
– C++ compiler: arm-none-eabi-g++ (15:6.3.1+svn253039-1build1) 6.3.1 20170620
– PX4 ECL: Very lightweight Estimation & Control Library v0.9.0-608-gacde4eb
– NuttX: px4io-v2 nsh cortex-m3
– Configuring done
– Generating done
– Build files have been written to: /home/drone/src/Firmware/build/nuttx_px4io-v2_default
ninja: Entering directory `/home/drone/src/Firmware/build/nuttx_px4io-v2_default’
[0/208] git submodule platforms/nuttx/NuttX/nuttx
[2/208] git submodule platforms/nuttx/NuttX/apps
[208/208] Creating /home/drone/src/Fir…px4io-v2_default/px4io-v2_default.px4
[12/647] git submodule mavlink/include/mavlink/v2.0
[14/647] git submodule platforms/nuttx/NuttX/apps
[645/647] Linking CXX executable nuttx_px4fmu-v2_default.elf
FAILED: nuttx_px4fmu-v2_default.elf
: && /usr/bin/arm-none-eabi-g++ -fno-common -ffunction-sections -fdata-sections -mcpu=cortex-m4 -mthumb -mfpu=fpv4-sp-d16 -mfloat-abi=hard -fno-common -ffunction-sections -fdata-sections -g -fno-exceptions -fno-rtti -std=gnu++11 -fno-threadsafe-statics -DCONFIG_WCHAR_BUILTIN -D__CUSTOM_FILE_IO
_ -fcheck-new -Wall -Wextra -Werror -Warray-bounds -Wdisabled-optimization -Wdouble-promotion -Wfatal-errors -Wfloat-equal -Wformat-security -Winit-self -Wlogical-op -Wmissing-declarations -Wpointer-arith -Wshadow -Wuninitialized -Wunknown-pragmas -Wunused-variable -Wno-implicit-fallthrough -Wno-missing-field-initializers -Wno-missing-include-dirs -Wno-unused-parameter -Wunused-but-set-variable -Wformat=1 -Wno-overloaded-virtual -Wreorder -Wno-format-truncation -fvisibility=hidden -include visibility.h -fno-strict-aliasing -fomit-frame-pointer -fno-math-errno -funsafe-math-optimizations -ffunction-sections -fdata-sections -fno-strength-reduce -fno-builtin-printf -Os -DNDEBUG -mcpu=cortex-m4 -mthumb -mfpu=fpv4-sp-d16 -mfloat-abi=hard -nodefaultlibs -nostdlib -Wl,–warn-common,–gc-sections platforms/nuttx/CMakeFiles/nuttx_px4fmu-v2_default.elf.dir///src/platforms/empty.c.obj -o nuttx_px4fmu-v2_default.elf -L/home/drone/src/Firmware/build/nuttx_px4fmu-v2_default/external/Install/lib -nodefaultlibs -nostdlib -fno-exceptions -fno-rtti -Wl,–script=/home/drone/src/Firmware/build/nuttx_px4fmu-v2_default/NuttX/nuttx/configs/px4fmu-v2/scripts/ld.script -Wl,-Map=nuttx_px4fmu-v2_default.map -Wl,–warn-common -Wl,–gc-sections -Wl,–start-group NuttX/apps/libapps.a NuttX/nuttx/arch/arm/src/libarch.a NuttX/nuttx/binfmt/libbinfmt.a NuttX/nuttx/libc/libc.a NuttX/nuttx/configs/libconfigs.a NuttX/nuttx/libxx/libcxx.a NuttX/nuttx/drivers/libdrivers.a NuttX/nuttx/fs/libfs.a NuttX/nuttx/mm/libmm.a NuttX/nuttx/sched/libsched.a -Wl,–end-group -lm src/modules/uORB/libmodules__uORB.a src/drivers/barometer/ms5611/libdrivers__ms5611.a src/drivers/differential_pressure/ms4525/libdrivers__ms4525_airspeed.a src/drivers/distance_sensor/ll40ls/libdrivers__ll40ls.a src/drivers/distance_sensor/sf0x/libdrivers__sf0x.a src/drivers/gps/libdrivers__gps.a src/drivers/imu/l3gd20/libdrivers__l3gd20.a src/drivers/imu/lsm303d/libdrivers__lsm303d.a src/drivers/imu/mpu6000/libdrivers__mpu6000.a src/drivers/imu/mpu9250/libdrivers__mpu9250.a src/drivers/magnetometer/hmc5883/libdrivers__hmc5883.a src/drivers/px4flow/libdrivers__px4flow.a src/drivers/px4fmu/libdrivers__px4fmu.a src/drivers/px4io/libdrivers__px4io.a src/drivers/rgbled/libdrivers__rgbled.a src/drivers/stm32/adc/libdrivers__adc.a src/drivers/stm32/tone_alarm/libdrivers__tone_alarm.a src/drivers/vmount/libdrivers__vmount.a src/modules/sensors/libmodules__sensors.a src/systemcmds/bl_update/libsystemcmds__bl_update.a src/systemcmds/hardfault_log/libsystemcmds__hardfault_log.a src/systemcmds/mixer/libsystemcmds__mixer.a src/systemcmds/mtd/libsystemcmds__mtd.a src/systemcmds/param/libsystemcmds__param.a src/systemcmds/perf/libsystemcmds__perf.a src/systemcmds/pwm/libsystemcmds__pwm.a src/systemcmds/reboot/libsystemcmds__reboot.a src/systemcmds/top/libsystemcmds__top.a src/systemcmds/tune_control/libsystemcmds__tune_control.a src/systemcmds/ver/libsystemcmds__ver.a src/modules/camera_feedback/libmodules__camera_feedback.a src/modules/commander/libmodules__commander.a src/modules/events/libmodules__events.a src/modules/land_detector/libmodules__land_detector.a src/modules/load_mon/libmake: *** [px4fmu-v2_default] Error 1
modules__load_mon.a src/modules/mavlink/libmodules__mavlink.a src/modules/navigator/libmodules__navigator.a src/modules/ekf2/libmodules__ekf2.a src/modules/fw_att_control/libmodules__fw_att_control.a src/modules/fw_pos_control_l1/libmodules__fw_pos_control_l1.a src/modules/mc_att_control/libmodules__mc_att_control.a src/modules/mc_pos_control/libmodules__mc_pos_control.a src/modules/vtol_att_control/libmodules__vtol_att_control.a src/modules/logger/libmodules__logger.a src/modules/dataman/libmodules__dataman.a src/modules/uORB/libmodules__uORB.a ROMFS/libromfs.a src/lib/drivers/airspeed/libdrivers__airspeed.a src/lib/led/libled.a src/lib/battery/libbattery.a src/lib/ecl/validation/libecl_validation.a src/lib/mixer/libmixer.a src/lib/tunes/libtunes.a src/lib/DriverFramework/framework/src/libdf_driver_framework.a src/lib/airspeed/libairspeed.a src/lib/ecl/EKF/libecl_EKF.a src/lib/ecl/geo_lookup/libecl_geo_lookup.a src/lib/ecl/attitude_fw/libecl_attitude_fw.a src/lib/landing_slope/liblanding_slope.a src/lib/ecl/l1/libecl_l1.a src/lib/ecl/tecs/libecl_tecs.a src/modules/fw_pos_control_l1/launchdetection/liblaunchdetection.a src/modules/fw_pos_control_l1/runway_takeoff/librunway_takeoff.a src/lib/circuit_breaker/libcircuit_breaker.a src/lib/conversion/libconversion.a src/lib/mathlib/libmathlib.a src/lib/ecl/geo/libecl_geo.a src/lib/controllib/libcontrollib.a src/lib/FlightTasks/libFlightTasks.a src/lib/FlightTasks/tasks/ManualAltitudeSmooth/libFlightTaskManualAltitudeSmooth.a src/lib/FlightTasks/tasks/ManualPositionSmooth/libFlightTaskManualPositionSmooth.a src/lib/FlightTasks/tasks/ManualPositionSmoothVel/libFlightTaskManualPositionSmoothVel.a src/lib/FlightTasks/tasks/ManualPosition/libFlightTaskManualPosition.a src/lib/FlightTasks/tasks/ManualAltitude/libFlightTaskManualAltitude.a src/lib/FlightTasks/tasks/Manual/libFlightTaskManual.a src/lib/FlightTasks/tasks/AutoLine/libFlightTaskAutoLine.a src/lib/FlightTasks/tasks/AutoMapper/libFlightTaskAutoMapper.a src/lib/FlightTasks/tasks/AutoLineSmoothVel/libFlightTaskAutoLineSmoothVel.a src/lib/FlightTasks/tasks/Utility/libFlightTaskUtility.a src/lib/FlightTasks/tasks/AutoMapper2/libFlightTaskAutoMapper2.a src/lib/FlightTasks/tasks/AutoFollowMe/libFlightTaskAutoFollowMe.a src/lib/FlightTasks/tasks/Auto/libFlightTaskAuto.a src/lib/FlightTasks/tasks/Offboard/libFlightTaskOffboard.a src/lib/FlightTasks/tasks/Failsafe/libFlightTaskFailsafe.a src/lib/FlightTasks/tasks/Transition/libFlightTaskTransition.a src/lib/FlightTasks/tasks/FlightTask/libFlightTask.a src/lib/WeatherVane/libWeatherVane.a src/lib/CollisionPrevention/libCollisionPrevention.a src/lib/pwm_limit/libpwm_limit.a src/lib/version/libversion.a src/platforms/common/libplatforms__common.a platforms/nuttx/src/px4_layer/libpx4_layer.a NuttX/nuttx/arch/arm/src/libarch.a src/drivers/boards/px4fmu-v2/libdrivers_board.a src/drivers/stm32/libdrivers_arch.a src/drivers/boards/common/libdrivers_boards_common.a src/drivers/boards/common/stm32/libdrivers_boards_common_arch.a src/modules/systemlib/libsystemlib.a src/lib/drivers/device/libdrivers__device.a src/lib/drivers/led/libdrivers__led.a src/lib/parameters/libparameters.a src/lib/cdev/libcdev.a src/lib/parameters/flashparams/libflashparams.a NuttX/nuttx/arch/arm/src/libarch.a src/drivers/boards/px4fmu-v2/libdrivers_board.a src/drivers/stm32/libdrivers_arch.a src/drivers/boards/common/libdrivers_boards_common.a src/drivers/boards/common/stm32/libdrivers_boards_common_arch.a src/modules/systemlib/libsystemlib.a src/lib/drivers/device/libdrivers__device.a src/lib/drivers/led/libdrivers__led.a src/lib/parameters/libparameters.a src/lib/cdev/libcdev.a src/lib/parameters/flashparams/libflashparams.a NuttX/apps/libapps.a src/lib/perf/libperf.a src/lib/parameters/tinybson/libtinybson.a NuttX/nuttx/libxx/libcxx.a NuttX/nuttx/libc/libc.a NuttX/nuttx/drivers/libdrivers.a NuttX/nuttx/fs/libfs.a NuttX/nuttx/mm/libmm.a NuttX/nuttx/sched/libsched.a -lm -lgcc msg/libuorb_msgs.a && :
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_fpclassify.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_fpclassify.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_cos.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_cos.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_sin.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_sin.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_atan.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_atan.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_ceil.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_ceil.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_cos.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_cos.o)
/
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_asin.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_asin.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_atan2.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_atan2.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_exp.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_exp.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_log.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_log.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_pow.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-wf_pow.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-e_acos.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-e_acos.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-e_asin.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-e_asin.o)

/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-k_cos.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-k_cos.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-k_rem_pio2.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-k_rem_pio2.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-k_sin.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-k_sin.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_cos.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_cos.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_rem_pio2.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_rem_pio2.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_sin.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_sin.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_tan.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-kf_tan.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_atan.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_atan.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_fabs.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_fabs.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_finite.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_finite.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_floor.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_floor.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_lib_ver.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_lib_ver.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_matherr.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_matherr.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_nan.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_nan.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_rint.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_rint.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_scalbn.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_scalbn.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_finite.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_finite.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_nan.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_nan.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_scalbn.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_scalbn.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_copysign.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-s_copysign.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: error: nuttx_px4fmu-v2_default.elf uses VFP register arguments, /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_copysign.o) does not
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: failed to merge target specific data of file /usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/lib/libm.a(lib_a-sf_copysign.o)
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: nuttx_px4fmu-v2_default.elf section .text' will not fit in region flash’
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: address 0x8103890 of nuttx_px4fmu-v2_default.elf section __param' is not within region flash’
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: address 0x8103890 of nuttx_px4fmu-v2_default.elf section __param' is not within region flash’
/usr/lib/gcc/arm-none-eabi/6.3.1/…/…/…/arm-none-eabi/bin/ld: region `flash’ overflowed by 17985 bytes
collect2: error: ld returned 1 exit status
ninja: build stopped: subcommand failed.
Makefile:176: recipe for target ‘px4fmu-v2_default’ failed
make: *** [px4fmu-v2_default] Error 1

This is probably the actual error that you have: the binary produced is too big for the Pixhawk with the silicon errata which can only hold 1MB (more info).

Different compilers and compiler versions will lead to different flash sizes, so that’s expected. Now, generally, it should compile if you stick to the compiler recommended by the PX4 docs.

The current recommendation is currently GCC 7-2017-q4. Instructions how to remove the system arm-none-eabi-gcc and install this specific version can be found here:
https://dev.px4.io/en/setup/dev_env_linux_ubuntu.html#nuttx-based-hardware

Thanks for your answer.

I tried this part of code but when I look for the actual version on my computer, it still shows the 6.3.1…

drone@drone-Precision-T1600:~$ tar -jxf gcc-arm-none-eabi-7-2017-q4-major-linux.tar.bz2

drone@drone-Precision-T1600:~$ exportline=“export PATH=$HOME/gcc-arm-none-eabi-7-2017-q4-major/bin:$PATH”
drone@drone-Precision-T1600:~$ if grep -Fxq “$exportline” ~/.profile; then echo nothing to do ; else echo $exportline >> ~/.profile; fi
nothing to do
drone@drone-Precision-T1600:~$ popd
~/src/Firmware
drone@drone-Precision-T1600:~/src/Firmware$ arm-none-eabi-gcc --version
arm-none-eabi-gcc (15:6.3.1+svn253039-1build1) 6.3.1 20170620
Copyright © 2016 Free Software Foundation, Inc.
This is free software; see the source for copying conditions. There is NO
warranty; not even for MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE.

Ok, have you done this step?

sudo apt-get remove gcc-arm-none-eabi gdb-arm-none-eabi binutils-arm-none-eabi gcc-arm-embedded
sudo add-apt-repository --remove ppa:team-gcc-arm-embedded/ppa

And take into account that you need to logout and log back in to have changes of .profile in effect, or you have to manually do source ~/.profile in each shell.

Yes I did.
After doing so I verified the actual version, and gcc-arm-none-eabi was succesfully removed, the computer was not able to find it.

Then after installation, it still doesn’t work. I tried to manually install the 7.2.1 version but it didn’t work, the computer still shows me the 6.3.1 version…

Any ideas ?

To check where your zombie gcc comes from you can do:

which arm-none-eabi-gcc

This will point to the path where it is installed.

Also, you can check your path variable:

echo $PATH

Whatever is first in the path we’ll be used. To fix the path, check the files ~/.profile and ~/.bashrc (or ~/.zshrc if you’re using zsh). Some distributions also come with ~/.xprofile. And after chaning ~/.profile, you need to logout and log back in.

drone@drone-Precision-T1600:~$ which arm-none-eabi-gcc
/usr/bin/arm-none-eabi-gcc
drone@drone-Precision-T1600:~$ echo $PATH
/usr/local/sbin:/usr/local/bin:/usr/sbin:/usr/bin:/sbin:/bin:/usr/games:/usr/local/games:/snap/bin:/home/drone/.local/bin

sorry, I an not familiar with Ubuntu.
Once I did that what do I have to do to check the ~/.profile and ~/.bashrc files ? And then how do I change that ?
While doing the ls command I have no .profile or .bashrc in ~

Hm, so when you do these two steps:

sudo apt-get remove gcc-arm-none-eabi gdb-arm-none-eabi binutils-arm-none-eabi gcc-arm-embedded
sudo add-apt-repository --remove ppa:team-gcc-arm-embedded/ppa

Then do you still have arm-none-eabi-gcc installed?

What you told made me an error, it was still there but it worked with :

sudo apt-get remove gcc-arm-none-eabi
sudo apt autoremove

Then while checking the version :
Command ‘arm-none-eabi-gcc’ not found
So I guess it has been deleted

Good, so now you install the correct toolchain as described in the wiki, easiest is using the script:
https://dev.px4.io/en/setup/dev_env_linux_ubuntu.html#how-to-use-the-scripts

The steps where it installs the toolchain are here:


You can also manually copy paste that line by line if you want to follow how it’s done.

It worked, I now have the 7.2.1 version.

Now, I tried again to compile the code with “make px4fmu-v2_default”
And this error occured “/bin/sh: 1: /usr/bin/arm-none-eabi-g++: not found”
Some additional packages to add with the new gcc ?

Have you tried make clean?