Browse Source

build: change from Arduino.mk to apm.mk

mission-4.1.18
Andrew Tridgell 12 years ago
parent
commit
374af1cd14
  1. 2
      APMrover2/Makefile
  2. 2
      ArduCopter/Makefile
  3. 2
      Tools/APM_radio_test/Makefile
  4. 2
      Tools/CPUInfo/Makefile
  5. 2
      Tools/Failsafe/Makefile
  6. 2
      Tools/Hello/Makefile
  7. 2
      Tools/VARTest/Makefile
  8. 2
      libraries/AC_PID/examples/AC_PID_test/Makefile
  9. 2
      libraries/APM_OBC/Failsafe_Board/Makefile
  10. 2
      libraries/APM_OBC/examples/trivial_APM_OBC/Makefile
  11. 2
      libraries/AP_ADC/examples/AP_ADC_test/Makefile
  12. 2
      libraries/AP_AHRS/examples/AHRS_Test/Makefile
  13. 2
      libraries/AP_Airspeed/examples/Airspeed/Makefile
  14. 2
      libraries/AP_Baro/examples/AP_Baro_BMP085_test/Makefile
  15. 2
      libraries/AP_Baro/examples/AP_Baro_MS5611_test/Makefile
  16. 2
      libraries/AP_Compass/examples/AP_Compass_test/Makefile
  17. 2
      libraries/AP_Declination/examples/AP_Declination_test/Makefile
  18. 2
      libraries/AP_GPS/examples/GPS_406_test/Makefile
  19. 2
      libraries/AP_GPS/examples/GPS_AUTO_test/Makefile
  20. 2
      libraries/AP_GPS/examples/GPS_MTK_test/Makefile
  21. 2
      libraries/AP_GPS/examples/GPS_NMEA_test/Makefile
  22. 2
      libraries/AP_GPS/examples/GPS_UBLOX_test/Makefile
  23. 2
      libraries/AP_HAL_AVR/examples/AnalogIn/Makefile
  24. 2
      libraries/AP_HAL_AVR/examples/ArduCopterLibs/Makefile
  25. 2
      libraries/AP_HAL_AVR/examples/ArduPlaneLibs/Makefile
  26. 2
      libraries/AP_HAL_AVR/examples/Blink/Makefile
  27. 2
      libraries/AP_HAL_AVR/examples/Console/Makefile
  28. 2
      libraries/AP_HAL_AVR/examples/I2CDriver_HMC5883L/Makefile
  29. 2
      libraries/AP_HAL_AVR/examples/LCDTest/Makefile
  30. 2
      libraries/AP_HAL_AVR/examples/RCInputTest/Makefile
  31. 2
      libraries/AP_HAL_AVR/examples/RCPassthroughTest/Makefile
  32. 2
      libraries/AP_HAL_AVR/examples/SPIDriver_MPU6000/Makefile
  33. 2
      libraries/AP_HAL_AVR/examples/Scheduler/Makefile
  34. 2
      libraries/AP_HAL_AVR/examples/Storage/Makefile
  35. 2
      libraries/AP_HAL_AVR/examples/UARTDriver/Makefile
  36. 2
      libraries/AP_HAL_AVR/examples/UtilityStringTest/Makefile
  37. 2
      libraries/AP_HAL_Empty/examples/empty_example/Makefile
  38. 2
      libraries/AP_HAL_PX4/examples/simple/Makefile
  39. 2
      libraries/AP_InertialNav/examples/AP_InertialNav_test/Makefile
  40. 2
      libraries/AP_InertialSensor/examples/MPU6000/Makefile
  41. 2
      libraries/AP_LeadFilter/examples/AP_LeadFilter/Makefile
  42. 2
      libraries/AP_Math/examples/eulers/Makefile
  43. 2
      libraries/AP_Math/examples/location/Makefile
  44. 2
      libraries/AP_Math/examples/polygon/Makefile
  45. 2
      libraries/AP_Math/examples/rotations/Makefile
  46. 2
      libraries/AP_Menu/examples/menu/Makefile
  47. 2
      libraries/AP_Motors/examples/AP_Motors_test/Makefile
  48. 2
      libraries/AP_Mount/examples/trivial_AP_Mount/Makefile
  49. 2
      libraries/AP_OpticalFlow/examples/AP_OpticalFlow_test/Makefile
  50. 2
      libraries/AP_RangeFinder/examples/MaxsonarXL_test/Makefile
  51. 2
      libraries/DataFlash/examples/DataFlash_test/Makefile
  52. 2
      libraries/Filter/examples/Derivative/Makefile
  53. 2
      libraries/Filter/examples/Filter/Makefile
  54. 2
      libraries/Filter/examples/LowPassFilter/Makefile
  55. 2
      libraries/GCS_Console/examples/Console/Makefile
  56. 2
      libraries/PID/examples/pid/Makefile
  57. 2
      libraries/RC_Channel/examples/RC_Channel/Makefile

2
APMrover2/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
include ../mk/Arduino.mk
include ../mk/apm.mk
include ../mk/targets.mk

2
ArduCopter/Makefile

@ -1,3 +1,3 @@ @@ -1,3 +1,3 @@
include ../mk/Arduino.mk
include ../mk/apm.mk
include ../mk/targets.mk

2
Tools/APM_radio_test/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../mk/Arduino.mk
include ../../mk/apm.mk

2
Tools/CPUInfo/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
#
# Trivial makefile for building APM
#
include ../../mk/Arduino.mk
include ../../mk/apm.mk

2
Tools/Failsafe/Makefile

@ -1,5 +1,5 @@ @@ -1,5 +1,5 @@
#
# Trivial makefile for building APM
#
include ../../mk/Arduino.mk
include ../../mk/apm.mk

2
Tools/Hello/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
#
# Trivial makefile for building APM
#
include ../../mk/Arduino.mk
include ../../mk/apm.mk

2
Tools/VARTest/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
#
# Trivial makefile for building APM
#
include ../../mk/Arduino.mk
include ../../mk/apm.mk

2
libraries/AC_PID/examples/AC_PID_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/APM_OBC/Failsafe_Board/Makefile

@ -2,5 +2,5 @@ @@ -2,5 +2,5 @@
# Trivial makefile for building APM
#
BOARD=uno
include ../../../libraries/../mk/Arduino.mk
include ../../../libraries/../mk/apm.mk

2
libraries/APM_OBC/examples/trivial_APM_OBC/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_ADC/examples/AP_ADC_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega2560
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_AHRS/examples/AHRS_Test/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_Airspeed/examples/Airspeed/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_Baro/examples/AP_Baro_BMP085_test/Makefile

@ -1,5 +1,5 @@ @@ -1,5 +1,5 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk
apm2:
make -f Makefile EXTRAFLAGS="-DAPM2_HARDWARE=1"

2
libraries/AP_Baro/examples/AP_Baro_MS5611_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega2560
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_Compass/examples/AP_Compass_test/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_Declination/examples/AP_Declination_test/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk
sitl:
make -f ../../../../libraries/Desktop/Desktop.mk

2
libraries/AP_GPS/examples/GPS_406_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_GPS/examples/GPS_AUTO_test/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_GPS/examples/GPS_MTK_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_GPS/examples/GPS_NMEA_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_GPS/examples/GPS_UBLOX_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/AnalogIn/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/ArduCopterLibs/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/ArduPlaneLibs/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/Blink/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/Console/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/I2CDriver_HMC5883L/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/LCDTest/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/RCInputTest/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/RCPassthroughTest/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/SPIDriver_MPU6000/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/Scheduler/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/Storage/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/UARTDriver/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_AVR/examples/UtilityStringTest/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_Empty/examples/empty_example/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_HAL_PX4/examples/simple/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_InertialNav/examples/AP_InertialNav_test/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_InertialSensor/examples/MPU6000/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_LeadFilter/examples/AP_LeadFilter/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_Math/examples/eulers/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk
sitl:
make -f ../../../../libraries/Desktop/Desktop.mk

2
libraries/AP_Math/examples/location/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk
sitl:
make -f ../../../../libraries/Desktop/Desktop.mk

2
libraries/AP_Math/examples/polygon/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_Math/examples/rotations/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk
sitl:
make -f ../../../../libraries/Desktop/Desktop.mk

2
libraries/AP_Menu/examples/menu/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_Motors/examples/AP_Motors_test/Makefile

@ -1,5 +1,5 @@ @@ -1,5 +1,5 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk
apm2:
make -f Makefile EXTRAFLAGS="-DAPM2_HARDWARE=1"

2
libraries/AP_Mount/examples/trivial_AP_Mount/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_OpticalFlow/examples/AP_OpticalFlow_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega2560
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/AP_RangeFinder/examples/MaxsonarXL_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/DataFlash/examples/DataFlash_test/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/Filter/examples/Derivative/Makefile

@ -1,4 +1,4 @@ @@ -1,4 +1,4 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk
sitl:
make -f ../../../../libraries/Desktop/Desktop.mk

2
libraries/Filter/examples/Filter/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/Filter/examples/LowPassFilter/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/GCS_Console/examples/Console/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/PID/examples/pid/Makefile

@ -1 +1 @@ @@ -1 +1 @@
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

2
libraries/RC_Channel/examples/RC_Channel/Makefile

@ -1,2 +1,2 @@ @@ -1,2 +1,2 @@
BOARD = mega
include ../../../../mk/Arduino.mk
include ../../../../mk/apm.mk

Loading…
Cancel
Save