Error Compiling v3.3.3 and latest: No such file or directory

Hello,

I am having trouble compiling ArduCoptor on Windows with the Arduino IDE after walking through the instructions (link below). Can someone tell me what I am missing with the configuration?

Any tips would be greatly appreciated. Thanks.

Error w/ latest v3.3.3:
In file included from AP_State.cpp:3:0:
Copter.h:33:33: fatal error: AP_Common/AP_Common.h: No such file or directory
#include <AP_Common/AP_Common.h>

Error w/ latest:
In file included from adsb.cpp:20:0:
Copter.h:35:27: fatal error: AP_HAL/AP_HAL.h: No such file or directory
#include <AP_HAL/AP_HAL.h>

Info:

Instructions I followed: dev.ardupilot.com/wiki/building- … o-windows/
Note: The sketch file was missing for each release, so I manually downloaded it to the ArduCopter directory from (prev release):
i. github.com/diydrones/ardupilot/ … Copter.pde

Downloaded source from:
a. (v3.3.3) github.com/diydrones/ardupilot/ … ter-stable
b. (latest) github.com/diydrones/ardupilot/ … master.zip

Windows 7
Arduino IDE custom build (downloaded today): firmware.diydrones.com/Tools/Ard … indows.zip

Additional info in case it helps - compile errors. I was able to verify the location of the offending .h file so I don’t understand why I’m getting the error. I also updated the preferences to ‘c:\git\ardupilot333’. Any help?

Building for ArduPilot Mega 2.x Excluding arduino core from include paths C:\Users\fa\Documents\Projects\Quadcopter\ArduPilot-Arduino-1.0.3-windows\hardware\tools\avr\bin\avr-g++ -c -g -Os -Wall -fno-exceptions -ffunction-sections -fdata-sections -mmcu=atmega2560 -DF_CPU=16000000L -MMD -DUSB_VID=null -DUSB_PID=null -DARDUINO=103 -mcall-prologues -DCONFIG_HAL_BOARD=HAL_BOARD_APM2 -DEXCLUDECORE -IC:\Git\ardupilot333\libraries\AP_Progmem -IC:\Git\ardupilot333\libraries\AP_Common -IC:\Git\ardupilot333\libraries\AP_Menu -IC:\Git\ardupilot333\libraries\AP_Param -IC:\Git\ardupilot333\libraries\StorageManager -IC:\Git\ardupilot333\libraries\AP_HAL -IC:\Git\ardupilot333\libraries\AP_HAL_AVR -IC:\Git\ardupilot333\libraries\AP_HAL_PX4 -IC:\Git\ardupilot333\libraries\AP_HAL_VRBRAIN -IC:\Git\ardupilot333\libraries\AP_HAL_FLYMAPLE -IC:\Git\ardupilot333\libraries\AP_HAL_Linux -IC:\Git\ardupilot333\libraries\AP_HAL_Empty -IC:\Git\ardupilot333\libraries\GCS_MAVLink -IC:\Git\ardupilot333\libraries\AP_GPS -IC:\Git\ardupilot333\libraries\DataFlash -IC:\Git\ardupilot333\libraries\AP_ADC -IC:\Git\ardupilot333\libraries\AP_ADC_AnalogSource -IC:\Git\ardupilot333\libraries\AP_Baro -IC:\Git\ardupilot333\libraries\AP_Compass -IC:\Git\ardupilot333\libraries\AP_Math -IC:\Git\ardupilot333\libraries\AP_Curve -IC:\Git\ardupilot333\libraries\AP_InertialSensor -IC:\Git\ardupilot333\libraries\AP_AHRS -IC:\Git\ardupilot333\libraries\AP_NavEKF -IC:\Git\ardupilot333\libraries\AP_Mission -IC:\Git\ardupilot333\libraries\AP_Rally -IC:\Git\ardupilot333\libraries\AC_PID -IC:\Git\ardupilot333\libraries\AC_AttitudeControl -IC:\Git\ardupilot333\libraries\RC_Channel -IC:\Git\ardupilot333\libraries\AP_Motors -IC:\Git\ardupilot333\libraries\AP_RangeFinder -IC:\Git\ardupilot333\libraries\AP_OpticalFlow -IC:\Git\ardupilot333\libraries\Filter -IC:\Git\ardupilot333\libraries\AP_Buffer -IC:\Git\ardupilot333\libraries\AP_Relay -IC:\Git\ardupilot333\libraries\AP_ServoRelayEvents -IC:\Git\ardupilot333\libraries\AP_Camera -IC:\Git\ardupilot333\libraries\AP_Mount -IC:\Git\ardupilot333\libraries\AP_Airspeed -IC:\Git\ardupilot333\libraries\AP_Vehicle -IC:\Git\ardupilot333\libraries\AP_InertialNav -IC:\Git\ardupilot333\libraries\AC_WPNav -IC:\Git\ardupilot333\libraries\AP_Declination -IC:\Git\ardupilot333\libraries\AC_Fence -IC:\Git\ardupilot333\libraries\SITL -IC:\Git\ardupilot333\libraries\AP_Scheduler -IC:\Git\ardupilot333\libraries\AP_RCMapper -IC:\Git\ardupilot333\libraries\AP_Notify -IC:\Git\ardupilot333\libraries\AP_BattMonitor -IC:\Git\ardupilot333\libraries\AP_BoardConfig -IC:\Git\ardupilot333\libraries\AP_Frsky_Telem -IC:\Git\ardupilot333\libraries\AC_Sprayer -IC:\Git\ardupilot333\libraries\AP_EPM -IC:\Git\ardupilot333\libraries\AP_Parachute -IC:\Git\ardupilot333\libraries\AP_Terrain C:\Users\fa\AppData\Local\Temp\build7114308644661618295.tmp\AP_State.cpp -o C:\Users\fa\AppData\Local\Temp\build7114308644661618295.tmp\AP_State.cpp.o In file included from AP_State.cpp:3:0: Copter.h:33:33: fatal error: AP_Common/AP_Common.h: No such file or directory #include <AP_Common/AP_Common.h> ^ compilation terminated.