Rename multiType to mixerMode. Rename MULTITYPE_* to MIXER_*.
[betaflight.git] / Makefile
blobf66e7c73cb7f59e5df0c71c8f07801e2efbfbc19
1 ###############################################################################
2 # "THE BEER-WARE LICENSE" (Revision 42):
3 # <msmith@FreeBSD.ORG> wrote this file. As long as you retain this notice you
4 # can do whatever you want with this stuff. If we meet some day, and you think
5 # this stuff is worth it, you can buy me a beer in return
6 ###############################################################################
8 # Makefile for building the cleanflight firmware.
10 # Invoke this with 'make help' to see the list of supported targets.
13 ###############################################################################
14 # Things that the user might override on the commandline
17 # The target to build, see VALID_TARGETS below
18 TARGET ?= NAZE
20 # Compile-time options
21 OPTIONS ?=
23 # compile for OpenPilot BootLoader support
24 OPBL ?=no
26 # Debugger optons, must be empty or GDB
27 DEBUG ?=
29 # Serial port/Device for flashing
30 SERIAL_DEVICE ?= /dev/ttyUSB0
32 ###############################################################################
33 # Things that need to be maintained as the source changes
36 FORKNAME = cleanflight
38 VALID_TARGETS = NAZE NAZE32PRO OLIMEXINO STM32F3DISCOVERY CHEBUZZF3 CC3D CJMCU EUSTM32F103RC MASSIVEF3 PORT103R SPARKY
40 # Valid targets for OP BootLoader support
41 OPBL_VALID_TARGETS = CC3D
43 REVISION = $(shell git log -1 --format="%h")
45 # Working directories
46 ROOT := $(patsubst %/,%,$(dir $(lastword $(MAKEFILE_LIST))))
47 SRC_DIR = $(ROOT)/src/main
48 OBJECT_DIR = $(ROOT)/obj/main
49 BIN_DIR = $(ROOT)/obj
50 CMSIS_DIR = $(ROOT)/lib/main/CMSIS
51 INCLUDE_DIRS = $(SRC_DIR)
52 LINKER_DIR = $(ROOT)/src/main/target
54 # Search path for sources
55 VPATH := $(SRC_DIR):$(SRC_DIR)/startup
57 ifeq ($(TARGET),$(filter $(TARGET),STM32F3DISCOVERY CHEBUZZF3 NAZE32PRO MASSIVEF3 SPARKY))
59 STDPERIPH_DIR = $(ROOT)/lib/main/STM32F30x_StdPeriph_Driver
60 USBFS_DIR = $(ROOT)/lib/main/STM32_USB-FS-Device_Driver
62 USBPERIPH_SRC = $(notdir $(wildcard $(USBFS_DIR)/src/*.c))
63 STDPERIPH_SRC = $(notdir $(wildcard $(STDPERIPH_DIR)/src/*.c))
65 EXCLUDES = stm32f30x_crc.c \
66 stm32f30x_can.c
68 STDPERIPH_SRC := $(filter-out ${EXCLUDES}, $(STDPERIPH_SRC))
70 DEVICE_STDPERIPH_SRC = $(USBPERIPH_SRC) \
71 $(STDPERIPH_SRC)
74 VPATH := $(VPATH):$(CMSIS_DIR)/CM1/CoreSupport:$(CMSIS_DIR)/CM1/DeviceSupport/ST/STM32F30x:$(USBFS_DIR)/src
75 CMSIS_SRC = $(notdir $(wildcard $(CMSIS_DIR)/CM1/CoreSupport/*.c \
76 $(CMSIS_DIR)/CM1/DeviceSupport/ST/STM32F30x/*.c))
78 INCLUDE_DIRS := $(INCLUDE_DIRS) \
79 $(STDPERIPH_DIR)/inc \
80 $(USBFS_DIR)/inc \
81 $(CMSIS_DIR)/CM1/CoreSupport \
82 $(CMSIS_DIR)/CM1/DeviceSupport/ST/STM32F30x \
83 $(ROOT)/src/main/vcp
85 LD_SCRIPT = $(LINKER_DIR)/stm32_flash_f303_256k.ld
87 ARCH_FLAGS = -mthumb -mcpu=cortex-m4 -mfloat-abi=hard -mfpu=fpv4-sp-d16 -mfpu=fpv4-sp-d16 -fsingle-precision-constant -Wdouble-promotion
88 DEVICE_FLAGS = -DSTM32F303xC -DSTM32F303
89 TARGET_FLAGS = -D$(TARGET)
90 ifeq ($(TARGET),CHEBUZZF3)
91 # CHEBUZZ is a VARIANT of STM32F3DISCOVERY
92 TARGET_FLAGS := $(TARGET_FLAGS) -DSTM32F3DISCOVERY
93 endif
95 ifeq ($(TARGET),MASSIVEF3)
96 # MASSIVEF3 is a VARIANT of STM32F3DISCOVERY
97 TARGET_FLAGS := $(TARGET_FLAGS) -DSTM32F3DISCOVERY
98 endif
101 else ifeq ($(TARGET),$(filter $(TARGET),EUSTM32F103RC PORT103R))
104 STDPERIPH_DIR = $(ROOT)/lib/main/STM32F10x_StdPeriph_Driver
106 STDPERIPH_SRC = $(notdir $(wildcard $(STDPERIPH_DIR)/src/*.c))
108 # Search path and source files for the CMSIS sources
109 VPATH := $(VPATH):$(CMSIS_DIR)/CM3/CoreSupport:$(CMSIS_DIR)/CM3/DeviceSupport/ST/STM32F10x
110 CMSIS_SRC = $(notdir $(wildcard $(CMSIS_DIR)/CM3/CoreSupport/*.c \
111 $(CMSIS_DIR)/CM3/DeviceSupport/ST/STM32F10x/*.c))
113 INCLUDE_DIRS := $(INCLUDE_DIRS) \
114 $(STDPERIPH_DIR)/inc \
115 $(CMSIS_DIR)/CM3/CoreSupport \
116 $(CMSIS_DIR)/CM3/DeviceSupport/ST/STM32F10x \
118 LD_SCRIPT = $(LINKER_DIR)/stm32_flash_f103_256k.ld
120 ARCH_FLAGS = -mthumb -mcpu=cortex-m3
121 TARGET_FLAGS = -D$(TARGET) -pedantic
122 DEVICE_FLAGS = -DSTM32F10X_HD -DSTM32F10X
124 DEVICE_STDPERIPH_SRC = $(STDPERIPH_SRC)
126 else
128 STDPERIPH_DIR = $(ROOT)/lib/main/STM32F10x_StdPeriph_Driver
130 STDPERIPH_SRC = $(notdir $(wildcard $(STDPERIPH_DIR)/src/*.c))
132 # Search path and source files for the CMSIS sources
133 VPATH := $(VPATH):$(CMSIS_DIR)/CM3/CoreSupport:$(CMSIS_DIR)/CM3/DeviceSupport/ST/STM32F10x
134 CMSIS_SRC = $(notdir $(wildcard $(CMSIS_DIR)/CM3/CoreSupport/*.c \
135 $(CMSIS_DIR)/CM3/DeviceSupport/ST/STM32F10x/*.c))
137 INCLUDE_DIRS := $(INCLUDE_DIRS) \
138 $(STDPERIPH_DIR)/inc \
139 $(CMSIS_DIR)/CM3/CoreSupport \
140 $(CMSIS_DIR)/CM3/DeviceSupport/ST/STM32F10x \
142 LD_SCRIPT = $(LINKER_DIR)/stm32_flash_f103_128k.ld
144 ARCH_FLAGS = -mthumb -mcpu=cortex-m3
145 TARGET_FLAGS = -D$(TARGET) -pedantic
146 DEVICE_FLAGS = -DSTM32F10X_MD -DSTM32F10X
148 DEVICE_STDPERIPH_SRC = $(STDPERIPH_SRC)
150 endif
152 TARGET_DIR = $(ROOT)/src/main/target/$(TARGET)
153 TARGET_SRC = $(notdir $(wildcard $(TARGET_DIR)/*.c))
155 INCLUDE_DIRS := $(INCLUDE_DIRS) \
156 $(TARGET_DIR)
158 VPATH := $(VPATH):$(TARGET_DIR)
160 COMMON_SRC = build_config.c \
161 version.c \
162 $(TARGET_SRC) \
163 config/config.c \
164 config/runtime_config.c \
165 common/maths.c \
166 common/printf.c \
167 common/typeconversion.c \
168 main.c \
169 mw.c \
170 flight/altitudehold.c \
171 flight/failsafe.c \
172 flight/flight.c \
173 flight/imu.c \
174 flight/mixer.c \
175 drivers/bus_i2c_soft.c \
176 drivers/serial.c \
177 drivers/sound_beeper.c \
178 drivers/system.c \
179 io/beeper.c \
180 io/rc_controls.c \
181 io/rc_curves.c \
182 io/serial.c \
183 io/serial_cli.c \
184 io/serial_msp.c \
185 io/statusindicator.c \
186 rx/rx.c \
187 rx/pwm.c \
188 rx/msp.c \
189 rx/sbus.c \
190 rx/sumd.c \
191 rx/sumh.c \
192 rx/spektrum.c \
193 rx/xbus.c \
194 sensors/acceleration.c \
195 sensors/battery.c \
196 sensors/boardalignment.c \
197 sensors/compass.c \
198 sensors/gyro.c \
199 sensors/initialisation.c \
200 $(CMSIS_SRC) \
201 $(DEVICE_STDPERIPH_SRC)
203 HIGHEND_SRC = flight/autotune.c \
204 flight/navigation.c \
205 flight/gps_conversion.c \
206 common/colorconversion.c \
207 io/gps.c \
208 io/ledstrip.c \
209 io/display.c \
210 telemetry/telemetry.c \
211 telemetry/frsky.c \
212 telemetry/hott.c \
213 telemetry/msp.c \
214 telemetry/smartport.c \
215 sensors/sonar.c \
216 sensors/barometer.c
218 NAZE_SRC = startup_stm32f10x_md_gcc.S \
219 drivers/accgyro_adxl345.c \
220 drivers/accgyro_bma280.c \
221 drivers/accgyro_l3g4200d.c \
222 drivers/accgyro_mma845x.c \
223 drivers/accgyro_mpu3050.c \
224 drivers/accgyro_mpu6050.c \
225 drivers/accgyro_spi_mpu6500.c \
226 drivers/adc.c \
227 drivers/adc_stm32f10x.c \
228 drivers/barometer_bmp085.c \
229 drivers/barometer_ms5611.c \
230 drivers/bus_spi.c \
231 drivers/bus_i2c_stm32f10x.c \
232 drivers/compass_hmc5883l.c \
233 drivers/display_ug2864hsweg01.h \
234 drivers/gpio_stm32f10x.c \
235 drivers/inverter.c \
236 drivers/light_led_stm32f10x.c \
237 drivers/light_ws2811strip.c \
238 drivers/light_ws2811strip_stm32f10x.c \
239 drivers/sonar_hcsr04.c \
240 drivers/pwm_mapping.c \
241 drivers/pwm_output.c \
242 drivers/pwm_rx.c \
243 drivers/serial_softserial.c \
244 drivers/serial_uart.c \
245 drivers/serial_uart_stm32f10x.c \
246 drivers/sound_beeper_stm32f10x.c \
247 drivers/system_stm32f10x.c \
248 drivers/timer.c \
249 drivers/timer_stm32f10x.c \
250 hardware_revision.c \
251 $(HIGHEND_SRC) \
252 $(COMMON_SRC)
254 EUSTM32F103RC_SRC = startup_stm32f10x_hd_gcc.S \
255 drivers/accgyro_adxl345.c \
256 drivers/accgyro_bma280.c \
257 drivers/accgyro_l3g4200d.c \
258 drivers/accgyro_mma845x.c \
259 drivers/accgyro_mpu3050.c \
260 drivers/accgyro_mpu6050.c \
261 drivers/accgyro_spi_mpu6000.c \
262 drivers/accgyro_spi_mpu6500.c \
263 drivers/adc.c \
264 drivers/adc_stm32f10x.c \
265 drivers/barometer_bmp085.c \
266 drivers/barometer_ms5611.c \
267 drivers/bus_i2c_stm32f10x.c \
268 drivers/bus_spi.c \
269 drivers/compass_ak8975.c \
270 drivers/compass_hmc5883l.c \
271 drivers/display_ug2864hsweg01.c \
272 drivers/gpio_stm32f10x.c \
273 drivers/inverter.c \
274 drivers/light_led_stm32f10x.c \
275 drivers/light_ws2811strip.c \
276 drivers/light_ws2811strip_stm32f10x.c \
277 drivers/pwm_mapping.c \
278 drivers/pwm_output.c \
279 drivers/pwm_rx.c \
280 drivers/serial_softserial.c \
281 drivers/serial_uart.c \
282 drivers/serial_uart_stm32f10x.c \
283 drivers/sonar_hcsr04.c \
284 drivers/sound_beeper_stm32f10x.c \
285 drivers/system_stm32f10x.c \
286 drivers/timer.c \
287 drivers/timer_stm32f10x.c \
288 $(HIGHEND_SRC) \
289 $(COMMON_SRC)
291 PORT103R_SRC = $(EUSTM32F103RC_SRC)
293 OLIMEXINO_SRC = startup_stm32f10x_md_gcc.S \
294 drivers/accgyro_mpu6050.c \
295 drivers/adc.c \
296 drivers/adc_stm32f10x.c \
297 drivers/barometer_bmp085.c \
298 drivers/bus_i2c_stm32f10x.c \
299 drivers/bus_spi.c \
300 drivers/compass_hmc5883l.c \
301 drivers/gpio_stm32f10x.c \
302 drivers/light_led_stm32f10x.c \
303 drivers/light_ws2811strip.c \
304 drivers/light_ws2811strip_stm32f10x.c \
305 drivers/pwm_mapping.c \
306 drivers/pwm_output.c \
307 drivers/pwm_rx.c \
308 drivers/serial_softserial.c \
309 drivers/serial_uart.c \
310 drivers/serial_uart_stm32f10x.c \
311 drivers/sonar_hcsr04.c \
312 drivers/sound_beeper_stm32f10x.c \
313 drivers/system_stm32f10x.c \
314 drivers/timer.c \
315 drivers/timer_stm32f10x.c \
316 $(HIGHEND_SRC) \
317 $(COMMON_SRC)
319 ifeq ($(TARGET),CJMCU)
320 LD_SCRIPT = $(LINKER_DIR)/stm32_flash_f103_64k.ld
321 endif
323 ifeq ($(OPBL),yes)
324 ifneq ($(filter $(TARGET),$(OPBL_VALID_TARGETS)),)
325 LD_SCRIPT = $(LINKER_DIR)/stm32_flash_f103_128k_opbl.ld
326 .DEFAULT_GOAL := binary
327 else
328 $(error OPBL specified with a unsupported target)
329 endif
330 endif
332 CJMCU_SRC = startup_stm32f10x_md_gcc.S \
333 drivers/adc.c \
334 drivers/adc_stm32f10x.c \
335 drivers/accgyro_mpu6050.c \
336 drivers/bus_i2c_stm32f10x.c \
337 drivers/compass_hmc5883l.c \
338 drivers/gpio_stm32f10x.c \
339 drivers/light_led_stm32f10x.c \
340 drivers/pwm_mapping.c \
341 drivers/pwm_output.c \
342 drivers/pwm_rx.c \
343 drivers/serial_uart.c \
344 drivers/serial_uart_stm32f10x.c \
345 drivers/sound_beeper_stm32f10x.c \
346 drivers/system_stm32f10x.c \
347 drivers/timer.c \
348 drivers/timer_stm32f10x.c \
349 $(COMMON_SRC)
351 CC3D_SRC = startup_stm32f10x_md_gcc.S \
352 drivers/accgyro_spi_mpu6000.c \
353 drivers/adc.c \
354 drivers/adc_stm32f10x.c \
355 drivers/bus_spi.c \
356 drivers/gpio_stm32f10x.c \
357 drivers/inverter.c \
358 drivers/light_led_stm32f10x.c \
359 drivers/light_ws2811strip.c \
360 drivers/light_ws2811strip_stm32f10x.c \
361 drivers/pwm_mapping.c \
362 drivers/pwm_output.c \
363 drivers/pwm_rx.c \
364 drivers/serial_softserial.c \
365 drivers/serial_uart.c \
366 drivers/serial_uart_stm32f10x.c \
367 drivers/sound_beeper_stm32f10x.c \
368 drivers/system_stm32f10x.c \
369 drivers/timer.c \
370 drivers/timer_stm32f10x.c \
371 $(HIGHEND_SRC) \
372 $(COMMON_SRC)
374 STM32F30x_COMMON_SRC = startup_stm32f30x_md_gcc.S \
375 drivers/adc.c \
376 drivers/adc_stm32f30x.c \
377 drivers/bus_i2c_stm32f30x.c \
378 drivers/bus_spi.c \
379 drivers/gpio_stm32f30x.c \
380 drivers/light_led_stm32f30x.c \
381 drivers/light_ws2811strip.c \
382 drivers/light_ws2811strip_stm32f30x.c \
383 drivers/pwm_mapping.c \
384 drivers/pwm_output.c \
385 drivers/pwm_rx.c \
386 drivers/serial_uart.c \
387 drivers/serial_uart_stm32f30x.c \
388 drivers/serial_usb_vcp.c \
389 drivers/sound_beeper_stm32f30x.c \
390 drivers/system_stm32f30x.c \
391 drivers/timer.c \
392 drivers/timer_stm32f30x.c \
393 vcp/hw_config.c \
394 vcp/stm32_it.c \
395 vcp/usb_desc.c \
396 vcp/usb_endp.c \
397 vcp/usb_istr.c \
398 vcp/usb_prop.c \
399 vcp/usb_pwr.c
401 NAZE32PRO_SRC = $(STM32F30x_COMMON_SRC) \
402 $(HIGHEND_SRC) \
403 $(COMMON_SRC)
405 STM32F3DISCOVERY_COMMON_SRC = $(STM32F30x_COMMON_SRC) \
406 drivers/accgyro_l3gd20.c \
407 drivers/accgyro_l3gd20.c \
408 drivers/accgyro_lsm303dlhc.c
410 STM32F3DISCOVERY_SRC = $(STM32F3DISCOVERY_COMMON_SRC) \
411 drivers/accgyro_adxl345.c \
412 drivers/accgyro_bma280.c \
413 drivers/accgyro_mma845x.c \
414 drivers/accgyro_mpu3050.c \
415 drivers/accgyro_mpu6050.c \
416 drivers/accgyro_l3g4200d.c \
417 $(HIGHEND_SRC) \
418 $(COMMON_SRC)
420 CHEBUZZF3_SRC = $(STM32F3DISCOVERY_SRC) \
421 $(HIGHEND_SRC) \
422 $(COMMON_SRC)
424 MASSIVEF3_SRC = $(STM32F3DISCOVERY_SRC) \
425 $(HIGHEND_SRC) \
426 $(COMMON_SRC)
428 SPARKY_SRC = $(STM32F30x_COMMON_SRC) \
429 drivers/display_ug2864hsweg01.c \
430 drivers/accgyro_mpu9150.c \
431 drivers/barometer_ms5611.c \
432 drivers/compass_ak8975.c \
433 $(HIGHEND_SRC) \
434 $(COMMON_SRC)
436 ifeq ($(TARGET),MASSIVEF3)
437 LD_SCRIPT = $(LINKER_DIR)/stm32_flash_f303_128k.ld
438 endif
440 # Search path and source files for the ST stdperiph library
441 VPATH := $(VPATH):$(STDPERIPH_DIR)/src
443 ###############################################################################
444 # Things that might need changing to use different tools
447 # Tool names
448 CC = arm-none-eabi-gcc
449 OBJCOPY = arm-none-eabi-objcopy
450 SIZE = arm-none-eabi-size
453 # Tool options.
456 ifeq ($(DEBUG),GDB)
457 OPTIMIZE = -O0
458 LTO_FLAGS = $(OPTIMIZE)
459 else
460 OPTIMIZE = -Os
461 LTO_FLAGS = -flto -fuse-linker-plugin $(OPTIMIZE)
462 endif
464 DEBUG_FLAGS = -ggdb3
466 CFLAGS = $(ARCH_FLAGS) \
467 $(LTO_FLAGS) \
468 $(addprefix -D,$(OPTIONS)) \
469 $(addprefix -I,$(INCLUDE_DIRS)) \
470 $(DEBUG_FLAGS) \
471 -std=gnu99 \
472 -Wall -Wextra -Wunsafe-loop-optimizations -Wdouble-promotion \
473 -ffunction-sections \
474 -fdata-sections \
475 $(DEVICE_FLAGS) \
476 -DUSE_STDPERIPH_DRIVER \
477 $(TARGET_FLAGS) \
478 -D'__FORKNAME__="$(FORKNAME)"' \
479 -D'__TARGET__="$(TARGET)"' \
480 -D'__REVISION__="$(REVISION)"' \
481 -save-temps=obj \
482 -MMD
484 ASFLAGS = $(ARCH_FLAGS) \
485 -x assembler-with-cpp \
486 $(addprefix -I,$(INCLUDE_DIRS)) \
487 -MMD
489 LDFLAGS = -lm \
490 -nostartfiles \
491 --specs=nano.specs \
492 -lc \
493 -lnosys \
494 $(ARCH_FLAGS) \
495 $(LTO_FLAGS) \
496 $(DEBUG_FLAGS) \
497 -static \
498 -Wl,-gc-sections,-Map,$(TARGET_MAP) \
499 -T$(LD_SCRIPT)
501 ###############################################################################
502 # No user-serviceable parts below
503 ###############################################################################
506 # Things we will build
508 ifeq ($(filter $(TARGET),$(VALID_TARGETS)),)
509 $(error Target '$(TARGET)' is not valid, must be one of $(VALID_TARGETS))
510 endif
512 TARGET_BIN = $(BIN_DIR)/$(FORKNAME)_$(TARGET).bin
513 TARGET_HEX = $(BIN_DIR)/$(FORKNAME)_$(TARGET).hex
514 TARGET_ELF = $(OBJECT_DIR)/$(FORKNAME)_$(TARGET).elf
515 TARGET_OBJS = $(addsuffix .o,$(addprefix $(OBJECT_DIR)/$(TARGET)/,$(basename $($(TARGET)_SRC))))
516 TARGET_DEPS = $(addsuffix .d,$(addprefix $(OBJECT_DIR)/$(TARGET)/,$(basename $($(TARGET)_SRC))))
517 TARGET_MAP = $(OBJECT_DIR)/$(FORKNAME)_$(TARGET).map
519 # List of buildable ELF files and their object dependencies.
520 # It would be nice to compute these lists, but that seems to be just beyond make.
522 $(TARGET_HEX): $(TARGET_ELF)
523 $(OBJCOPY) -O ihex --set-start 0x8000000 $< $@
525 $(TARGET_BIN): $(TARGET_ELF)
526 $(OBJCOPY) -O binary $< $@
528 $(TARGET_ELF): $(TARGET_OBJS)
529 $(CC) -o $@ $^ $(LDFLAGS)
530 $(SIZE) $(TARGET_ELF)
532 # Compile
533 $(OBJECT_DIR)/$(TARGET)/%.o: %.c
534 @mkdir -p $(dir $@)
535 @echo %% $(notdir $<)
536 @$(CC) -c -o $@ $(CFLAGS) $<
538 # Assemble
539 $(OBJECT_DIR)/$(TARGET)/%.o: %.s
540 @mkdir -p $(dir $@)
541 @echo %% $(notdir $<)
542 @$(CC) -c -o $@ $(ASFLAGS) $<
544 $(OBJECT_DIR)/$(TARGET)/%.o: %.S
545 @mkdir -p $(dir $@)
546 @echo %% $(notdir $<)
547 @$(CC) -c -o $@ $(ASFLAGS) $<
549 clean:
550 rm -f $(TARGET_BIN) $(TARGET_HEX) $(TARGET_ELF) $(TARGET_OBJS) $(TARGET_MAP)
551 rm -rf $(OBJECT_DIR)/$(TARGET)
553 flash_$(TARGET): $(TARGET_HEX)
554 stty -F $(SERIAL_DEVICE) raw speed 115200 -crtscts cs8 -parenb -cstopb -ixon
555 echo -n 'R' >$(SERIAL_DEVICE)
556 stm32flash -w $(TARGET_HEX) -v -g 0x0 -b 115200 $(SERIAL_DEVICE)
558 flash: flash_$(TARGET)
560 binary: $(TARGET_BIN)
562 unbrick_$(TARGET): $(TARGET_HEX)
563 stty -F $(SERIAL_DEVICE) raw speed 115200 -crtscts cs8 -parenb -cstopb -ixon
564 stm32flash -w $(TARGET_HEX) -v -g 0x0 -b 115200 $(SERIAL_DEVICE)
566 unbrick: unbrick_$(TARGET)
568 help:
569 @echo ""
570 @echo "Makefile for the $(FORKNAME) firmware"
571 @echo ""
572 @echo "Usage:"
573 @echo " make [TARGET=<target>] [OPTIONS=\"<options>\"]"
574 @echo ""
575 @echo "Valid TARGET values are: $(VALID_TARGETS)"
576 @echo ""
578 # rebuild everything when makefile changes
579 $(TARGET_OBJS) : Makefile
581 # include auto-generated dependencies
582 -include $(TARGET_DEPS)