├── .gitignore ├── .project ├── APMrover2 ├── APM_Config.h ├── APM_Config.h.reference ├── APM_Config_HILmode.h ├── APM_Config_Rover.h ├── APM_Config_mavlink_hil.h ├── APMrover2.pde ├── Attitude.pde ├── GCS.h ├── GCS_Mavlink.pde ├── Log.pde ├── Makefile ├── Parameters.h ├── Parameters.pde ├── command_description.txt ├── commands.pde ├── commands_logic.pde ├── commands_process.pde ├── compat.h ├── compat.pde ├── config.h ├── control_modes.pde ├── createTags ├── defines.h ├── events.pde ├── failsafe.pde ├── navigation.pde ├── nocore.inoflag ├── radio.pde ├── sensors.pde ├── setup.pde ├── system.pde └── test.pde ├── ArduCopter ├── .gitignore ├── APM_Config.h ├── APM_Config_mavlink_hil.h ├── AP_State.pde ├── ArduCopter.pde ├── Attitude.pde ├── CMakeLists.txt ├── GCS.h ├── GCS_Mavlink.pde ├── Log.pde ├── Makefile ├── Parameters.h ├── Parameters.pde ├── ReleaseNotes.txt ├── UserCode.pde ├── UserVariables.h ├── command_description.txt ├── commands.pde ├── commands_logic.pde ├── commands_process.pde ├── compat.h ├── compat.pde ├── config.h ├── config_channels.h ├── control_modes.pde ├── defines.h ├── events.pde ├── failsafe.pde ├── flip.pde ├── inertia.pde ├── leds.pde ├── limits.pde ├── motors.pde ├── navigation.pde ├── nocore.inoflag ├── options.cmake ├── perf_info.pde ├── radio.pde ├── read_me.text ├── sensors.pde ├── setup.pde ├── system.pde ├── test.pde └── toy.pde ├── ArduPlane ├── APM_Config.h ├── APM_Config.h.reference ├── ArduPlane.pde ├── Attitude.pde ├── CMakeLists.txt ├── GCS.h ├── GCS_Mavlink.pde ├── Log.pde ├── Makefile ├── Parameters.h ├── Parameters.pde ├── climb_rate.pde ├── command_description.txt ├── commands.pde ├── commands_logic.pde ├── commands_process.pde ├── compat.h ├── compat.pde ├── config.h ├── control_modes.pde ├── createTags ├── defines.h ├── events.pde ├── failsafe.pde ├── geofence.pde ├── navigation.pde ├── nocore.inoflag ├── options.cmake ├── radio.pde ├── sensors.pde ├── setup.pde ├── system.pde └── test.pde ├── COPYING.txt ├── Doxyfile.in ├── README.txt ├── README_AP_HAL.md ├── Tools ├── APM2_2560_bootloader │ ├── FLASH.txt │ ├── License.txt │ ├── Makefile │ ├── README.txt │ ├── avrinterruptnames.h │ ├── command.h │ ├── stk500boot.c │ └── stk500boot_v2_mega2560.hex ├── APM_radio_test │ ├── APM_radio_test.pde │ └── Makefile ├── ArduPPM │ ├── ATMega328p │ │ ├── Encoder-PPM -v3.c │ │ ├── Encoder-PPM.c │ │ ├── Makefile │ │ ├── manual.txt │ │ └── readme.txt │ ├── ATMega32U2 │ │ ├── Arduino-usbdfu.hex │ │ ├── Bootloaders │ │ │ └── arduino-usbdfu │ │ │ │ ├── Arduino-usbdfu.c │ │ │ │ ├── Arduino-usbdfu.h │ │ │ │ ├── Board │ │ │ │ └── LEDs.h │ │ │ │ ├── Descriptors.c │ │ │ │ ├── Descriptors.h │ │ │ │ ├── makefile │ │ │ │ └── readme.txt │ │ ├── Drivers │ │ │ ├── Arduino_MEGA_2560.inf │ │ │ ├── amd64 │ │ │ │ ├── libusb0.dll │ │ │ │ └── libusb0.sys │ │ │ ├── atmel_usb_dfu.inf │ │ │ ├── ia64 │ │ │ │ ├── libusb0.dll │ │ │ │ └── libusb0.sys │ │ │ └── x86 │ │ │ │ ├── libusb0.sys │ │ │ │ └── libusb0_x86.dll │ │ ├── LUFA.pnproj │ │ ├── LUFA │ │ │ ├── Common │ │ │ │ ├── Attributes.h │ │ │ │ ├── BoardTypes.h │ │ │ │ └── Common.h │ │ │ ├── Doxygen.conf │ │ │ ├── DriverStubs │ │ │ │ ├── Buttons.h │ │ │ │ ├── Dataflash.h │ │ │ │ ├── Joystick.h │ │ │ │ └── LEDs.h │ │ │ ├── Drivers │ │ │ │ ├── Board │ │ │ │ │ ├── ATAVRUSBRF01 │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── BENITO │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── BUMBLEB │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ ├── Joystick.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── Buttons.h │ │ │ │ │ ├── Dataflash.h │ │ │ │ │ ├── EVK527 │ │ │ │ │ │ ├── AT45DB321C.h │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ ├── Dataflash.h │ │ │ │ │ │ ├── Joystick.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── JMDBU2 │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── Joystick.h │ │ │ │ │ ├── LEDs.h │ │ │ │ │ ├── RZUSBSTICK │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── STK525 │ │ │ │ │ │ ├── AT45DB321C.h │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ ├── Dataflash.h │ │ │ │ │ │ ├── Joystick.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── STK526 │ │ │ │ │ │ ├── AT45DB642D.h │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ ├── Dataflash.h │ │ │ │ │ │ ├── Joystick.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── TEENSY │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── Temperature.c │ │ │ │ │ ├── Temperature.h │ │ │ │ │ ├── USBKEY │ │ │ │ │ │ ├── AT45DB642D.h │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ ├── Dataflash.h │ │ │ │ │ │ ├── Joystick.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ ├── USBTINYMKII │ │ │ │ │ │ ├── Buttons.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ │ └── XPLAIN │ │ │ │ │ │ ├── AT45DB642D.h │ │ │ │ │ │ ├── Dataflash.h │ │ │ │ │ │ └── LEDs.h │ │ │ │ ├── Misc │ │ │ │ │ └── TerminalCodes.h │ │ │ │ ├── Peripheral │ │ │ │ │ ├── ADC.h │ │ │ │ │ ├── AVRU4U6U7 │ │ │ │ │ │ ├── ADC.h │ │ │ │ │ │ └── TWI.h │ │ │ │ │ ├── SPI.h │ │ │ │ │ ├── Serial.c │ │ │ │ │ ├── Serial.h │ │ │ │ │ ├── SerialStream.c │ │ │ │ │ ├── SerialStream.h │ │ │ │ │ ├── TWI.c │ │ │ │ │ └── TWI.h │ │ │ │ └── USB │ │ │ │ │ ├── Class │ │ │ │ │ ├── Audio.h │ │ │ │ │ ├── CDC.h │ │ │ │ │ ├── Common │ │ │ │ │ │ ├── Audio.h │ │ │ │ │ │ ├── CDC.h │ │ │ │ │ │ ├── HID.h │ │ │ │ │ │ ├── MIDI.h │ │ │ │ │ │ ├── MassStorage.h │ │ │ │ │ │ ├── Printer.h │ │ │ │ │ │ ├── RNDIS.h │ │ │ │ │ │ ├── RNDISConstants.h │ │ │ │ │ │ └── StillImage.h │ │ │ │ │ ├── Device │ │ │ │ │ │ ├── Audio.c │ │ │ │ │ │ ├── Audio.h │ │ │ │ │ │ ├── CDC.c │ │ │ │ │ │ ├── CDC.h │ │ │ │ │ │ ├── HID.c │ │ │ │ │ │ ├── HID.h │ │ │ │ │ │ ├── MIDI.c │ │ │ │ │ │ ├── MIDI.h │ │ │ │ │ │ ├── MassStorage.c │ │ │ │ │ │ ├── MassStorage.h │ │ │ │ │ │ ├── RNDIS.c │ │ │ │ │ │ └── RNDIS.h │ │ │ │ │ ├── HID.h │ │ │ │ │ ├── Host │ │ │ │ │ │ ├── CDC.c │ │ │ │ │ │ ├── CDC.h │ │ │ │ │ │ ├── HID.c │ │ │ │ │ │ ├── HID.h │ │ │ │ │ │ ├── HIDParser.c │ │ │ │ │ │ ├── HIDParser.h │ │ │ │ │ │ ├── HIDReportData.h │ │ │ │ │ │ ├── MIDI.c │ │ │ │ │ │ ├── MIDI.h │ │ │ │ │ │ ├── MassStorage.c │ │ │ │ │ │ ├── MassStorage.h │ │ │ │ │ │ ├── Printer.c │ │ │ │ │ │ ├── Printer.h │ │ │ │ │ │ ├── RNDIS.c │ │ │ │ │ │ ├── RNDIS.h │ │ │ │ │ │ ├── StillImage.c │ │ │ │ │ │ └── StillImage.h │ │ │ │ │ ├── MIDI.h │ │ │ │ │ ├── MassStorage.h │ │ │ │ │ ├── Printer.h │ │ │ │ │ ├── RNDIS.h │ │ │ │ │ └── StillImage.h │ │ │ │ │ ├── HighLevel │ │ │ │ │ ├── ConfigDescriptor.c │ │ │ │ │ ├── ConfigDescriptor.h │ │ │ │ │ ├── DeviceStandardReq.c │ │ │ │ │ ├── DeviceStandardReq.h │ │ │ │ │ ├── Events.c │ │ │ │ │ ├── Events.h │ │ │ │ │ ├── HostStandardReq.c │ │ │ │ │ ├── HostStandardReq.h │ │ │ │ │ ├── StdDescriptors.h │ │ │ │ │ ├── StdRequestType.h │ │ │ │ │ ├── StreamCallbacks.h │ │ │ │ │ ├── USBMode.h │ │ │ │ │ ├── USBTask.c │ │ │ │ │ └── USBTask.h │ │ │ │ │ ├── LowLevel │ │ │ │ │ ├── Device.c │ │ │ │ │ ├── Device.h │ │ │ │ │ ├── Endpoint.c │ │ │ │ │ ├── Endpoint.h │ │ │ │ │ ├── Host.c │ │ │ │ │ ├── Host.h │ │ │ │ │ ├── OTG.h │ │ │ │ │ ├── Pipe.c │ │ │ │ │ ├── Pipe.h │ │ │ │ │ ├── Template │ │ │ │ │ │ ├── Template_Endpoint_Control_R.c │ │ │ │ │ │ ├── Template_Endpoint_Control_W.c │ │ │ │ │ │ ├── Template_Endpoint_RW.c │ │ │ │ │ │ └── Template_Pipe_RW.c │ │ │ │ │ ├── USBController.c │ │ │ │ │ ├── USBController.h │ │ │ │ │ ├── USBInterrupt.c │ │ │ │ │ └── USBInterrupt.h │ │ │ │ │ └── USB.h │ │ │ ├── License.txt │ │ │ ├── ManPages │ │ │ │ ├── AboutLUFA.txt │ │ │ │ ├── AlternativeStacks.txt │ │ │ │ ├── Author.jpg │ │ │ │ ├── BuildingLinkableLibraries.txt │ │ │ │ ├── ChangeLog.txt │ │ │ │ ├── CompileTimeTokens.txt │ │ │ │ ├── CompilingApps.txt │ │ │ │ ├── ConfiguringApps.txt │ │ │ │ ├── DevelopingWithLUFA.txt │ │ │ │ ├── DeviceSupport.txt │ │ │ │ ├── DirectorySummaries.txt │ │ │ │ ├── Donating.txt │ │ │ │ ├── FutureChanges.txt │ │ │ │ ├── GettingStarted.txt │ │ │ │ ├── Groups.txt │ │ │ │ ├── LUFA.png │ │ │ │ ├── LUFAPoweredProjects.txt │ │ │ │ ├── LUFAvsAtmelStack.txt │ │ │ │ ├── LibraryApps.txt │ │ │ │ ├── LibraryResources.txt │ │ │ │ ├── LicenseInfo.txt │ │ │ │ ├── MainPage.txt │ │ │ │ ├── MigrationInformation.txt │ │ │ │ ├── ProgrammingApps.txt │ │ │ │ ├── SchedulerOverview.txt │ │ │ │ ├── SoftwareBootloaderJump.txt │ │ │ │ ├── VIDAndPIDValues.txt │ │ │ │ ├── WhyUseLUFA.txt │ │ │ │ └── WritingBoardDrivers.txt │ │ │ ├── Scheduler │ │ │ │ ├── Scheduler.c │ │ │ │ └── Scheduler.h │ │ │ ├── Version.h │ │ │ └── makefile │ │ ├── Projects │ │ │ └── arduino-usbserial │ │ │ │ ├── Arduino-usbserial.c │ │ │ │ ├── Arduino-usbserial.h │ │ │ │ ├── Board │ │ │ │ └── LEDs.h │ │ │ │ ├── Descriptors.c │ │ │ │ ├── Descriptors.h │ │ │ │ ├── Lib │ │ │ │ └── LightweightRingBuff.h │ │ │ │ ├── makefile │ │ │ │ ├── ppm_encoder.txt │ │ │ │ └── readme.txt │ │ ├── ppm_encoder.txt │ │ ├── readme.txt │ │ └── windows-dfuprogramming.txt │ ├── Binaries │ │ ├── ArduPPM_v0.9.87_Arducopter-APMv1.x.hex │ │ ├── ArduPPM_v0.9.87_Arduplane-APMv1.x.hex │ │ ├── ArduPPM_v2.2.68_ATMega32U2.hex │ │ ├── ArduPPM_v2.3.10_ATMega32U2.hex │ │ ├── ArduPPM_v2.3.12_ATMega32U2.hex │ │ ├── ArduPPM_v2.3.13_ATMega32U2.hex │ │ └── Hash.txt │ ├── Libraries │ │ ├── PPM_Encoder.h │ │ ├── PPM_Encoder_v3.h │ │ ├── changelog_v3.txt │ │ ├── manual_v3.txt │ │ └── readme.txt │ ├── WorkBasket │ │ ├── Experimental │ │ │ └── PPM_Encoder.h │ │ ├── Jeti_Duplex │ │ │ ├── Jeti_telemetry_protocol.pdf │ │ │ ├── Jetibox │ │ │ │ ├── JetiBox.cpp │ │ │ │ └── JetiBox.h │ │ │ └── readme.txt │ │ ├── readme.txt │ │ └── spektrum_to_ppm_encoder │ │ │ └── spektrum_to_ppm_encoder.pde │ └── readme.txt ├── ArduPilotMega_demo │ ├── ArduPilotMega_demo.pde │ └── Timers.pde ├── ArduTracker │ ├── .ArduTracker.pde.swo │ ├── APM_Config.h.reference │ ├── APM_Config_mavlink_hil.h │ ├── APM_Config_xplane.h │ ├── ArduTracker.pde │ ├── Attitude.pde │ ├── GCS.h │ ├── GCS_Ardupilot.pde │ ├── GCS_DebugTerminal.pde │ ├── GCS_Mavlink.pde │ ├── GCS_Standard.pde │ ├── GCS_Xplane.pde │ ├── HIL.h │ ├── HIL_Mavlink.pde │ ├── HIL_Xplane.pde │ ├── Log.pde │ ├── Mavlink_Common.h │ ├── Terminal_commands.txt │ ├── climb_rate.pde │ ├── command_description.txt │ ├── commands.pde │ ├── commands_process.pde │ ├── config.h │ ├── control_modes.pde │ ├── createTags │ ├── debug.pde │ ├── defines.h │ ├── events.pde │ ├── global_data.h │ ├── global_data.pde │ ├── navigation.pde │ ├── param_init.pde │ ├── param_table.c │ ├── param_table.h │ ├── paramgen.awk │ ├── paramgen.in │ ├── radio.pde │ ├── sensors.pde │ ├── setup.pde │ ├── system.pde │ ├── test.pde │ └── updateParams ├── ArdupilotMegaPlanner │ ├── .gitignore │ ├── 3DRRadio │ │ ├── 3DRRadio.csproj │ │ ├── 3dr.ico │ │ ├── ChangeLog.txt │ │ ├── Common.cs │ │ ├── Config.Designer.cs │ │ ├── Config.cs │ │ ├── Config.resx │ │ ├── MainV2.cs │ │ ├── Program.cs │ │ ├── Properties │ │ │ ├── AssemblyInfo.cs │ │ │ ├── Resources.Designer.cs │ │ │ ├── Resources.resx │ │ │ ├── Settings.Designer.cs │ │ │ └── Settings.settings │ │ ├── Resources │ │ │ ├── 3dr.ico │ │ │ └── 3dr3.png │ │ ├── Rssi.Designer.cs │ │ ├── Rssi.cs │ │ ├── Rssi.resx │ │ ├── Terminal.Designer.cs │ │ ├── Terminal.cs │ │ ├── Terminal.resx │ │ ├── ThemeManager.cs │ │ └── app.config │ ├── APMPlannerXplanes │ │ ├── .gitignore │ │ ├── APMPlannerXplanes.sln │ │ ├── APMPlannerXplanes.suo │ │ ├── APMPlannerXplanes │ │ │ ├── APMPlannerXplanes.cpp │ │ │ ├── APMPlannerXplanes.h │ │ │ ├── APMPlannerXplanes.vcxproj │ │ │ ├── APMPlannerXplanes.vcxproj.filters │ │ │ ├── APMPlannerXplanes.vcxproj.user │ │ │ ├── AircraftUtils.cpp │ │ │ ├── AircraftUtils.h │ │ │ ├── AssemblyInfo.cpp │ │ │ ├── ReadMe.txt │ │ │ └── resource.h │ │ └── Debug │ │ │ ├── APMPlannerXplanes.exp │ │ │ ├── APMPlannerXplanes.ilk │ │ │ ├── APMPlannerXplanes.lib │ │ │ ├── APMPlannerXplanes.pdb │ │ │ └── APMPlannerXplanes.xpl │ ├── AeroSimRCAPMHil.zip │ ├── Antenna │ │ ├── ArduTracker.cs │ │ ├── DegreeTracker.cs │ │ ├── ITrackerOutput.cs │ │ ├── Maestro.cs │ │ ├── Tracker.Designer.cs │ │ ├── Tracker.cs │ │ ├── Tracker.de-DE.resx │ │ ├── Tracker.fr.resx │ │ ├── Tracker.resx │ │ └── Tracker.zh-Hans.resx │ ├── ArduCopterConfig.xml │ ├── Arduino │ │ ├── ArduinoComms.cs │ │ ├── ArduinoDetect.cs │ │ ├── ArduinoSTK.cs │ │ └── ArduinoSTKv2.cs │ ├── ArdupilotMega.csproj │ ├── ArdupilotMega.csproj.user │ ├── ArdupilotMega.sln │ ├── Attributes │ │ ├── DisplayTextAttribute.cs │ │ └── PrivateAttribute.cs │ ├── Camera.Designer.cs │ ├── Camera.cs │ ├── Camera.de-DE.resx │ ├── Camera.fr.resx │ ├── Camera.resx │ ├── Camera.zh-Hans.resx │ ├── ChangeLog.txt │ ├── CodeGen.cs │ ├── Common.cs │ ├── Comms │ │ ├── CommsFile.cs │ │ ├── CommsSerialInterface.cs │ │ ├── CommsSerialPort.cs │ │ ├── CommsTCPSerial.cs │ │ ├── CommsUdpSerial.cs │ │ └── ICommsSerial.cs │ ├── CommsSerial.cs │ ├── Controls │ │ ├── AGauge.cs │ │ ├── AGauge.resx │ │ ├── BackstageView │ │ │ ├── BackStageViewContentPanel.cs │ │ │ ├── BackStageViewMenuPanel.cs │ │ │ ├── BackstageView.Designer.cs │ │ │ ├── BackstageView.cs │ │ │ ├── BackstageView.resx │ │ │ └── BackstageViewButton.cs │ │ ├── ConfigPanel.Designer.cs │ │ ├── ConfigPanel.cs │ │ ├── ConfigPanel.resx │ │ ├── ConnectionControl.Designer.cs │ │ ├── ConnectionControl.cs │ │ ├── ConnectionControl.resx │ │ ├── ConnectionStats.Designer.cs │ │ ├── ConnectionStats.cs │ │ ├── ConnectionStats.resx │ │ ├── ConnectionToolStripItem.resx │ │ ├── CustomMessageBox.cs │ │ ├── FlashMessage.cs │ │ ├── FlashMessage.designer.cs │ │ ├── FlashMessage.resx │ │ ├── HSI.Designer.cs │ │ ├── HSI.cs │ │ ├── HSI.resx │ │ ├── HUD.cs │ │ ├── IDynamicParameterControl.cs │ │ ├── ImageLabel.Designer.cs │ │ ├── ImageLabel.cs │ │ ├── ImageLabel.resx │ │ ├── LabelWithPseudoOpacity.cs │ │ ├── LineSeparator.cs │ │ ├── MainSwitcher.Designer.cs │ │ ├── MainSwitcher.cs │ │ ├── MainSwitcher.resx │ │ ├── MavlinkCheckBox.cs │ │ ├── MavlinkComboBox.cs │ │ ├── MavlinkNumericUpDown.cs │ │ ├── ModifyandSet.Designer.cs │ │ ├── ModifyandSet.cs │ │ ├── ModifyandSet.resx │ │ ├── MyButton.cs │ │ ├── MyLabel.cs │ │ ├── MyTrackBar.cs │ │ ├── MyUserControl.cs │ │ ├── OpenGLtest.cs │ │ ├── OpenGLtest.resx │ │ ├── PictureBoxWithPseudoOpacity.cs │ │ ├── ProgressReporterDialogue.cs │ │ ├── ProgressReporterDialogue.designer.cs │ │ ├── ProgressReporterDialogue.resx │ │ ├── PseudoOpacityHelper.cs │ │ ├── QuickView.Designer.cs │ │ ├── QuickView.cs │ │ ├── QuickView.resx │ │ ├── RangeControl.Designer.cs │ │ ├── RangeControl.cs │ │ ├── RangeControl.resx │ │ ├── ToolStripConnectionControl.cs │ │ ├── ValuesControl.Designer.cs │ │ ├── ValuesControl.cs │ │ ├── ValuesControl.resx │ │ └── myGMAP.cs │ ├── CurrentState.cs │ ├── Delta.cs │ ├── Driver │ │ ├── Arduino MEGA 2560.inf │ │ ├── arduino.cat │ │ ├── arduino.inf │ │ ├── dpinst.xml │ │ ├── px4fmu.cat │ │ ├── px4fmu.inf │ │ └── signed.cer │ ├── ElevationProfile.Designer.cs │ ├── ElevationProfile.cs │ ├── ElevationProfile.resx │ ├── Firmware │ │ ├── firmware1.xml │ │ └── firmware2.xml │ ├── FollowMe.Designer.cs │ ├── FollowMe.cs │ ├── FollowMe.de-DE.resx │ ├── FollowMe.es-ES.resx │ ├── FollowMe.fr.resx │ ├── FollowMe.pl.resx │ ├── FollowMe.resx │ ├── GCSViews │ │ ├── ConfigurationView │ │ │ ├── ConfigAP_Limits.Designer.cs │ │ │ ├── ConfigAP_Limits.cs │ │ │ ├── ConfigAP_Limits.de-DE.resx │ │ │ ├── ConfigAP_Limits.fr.resx │ │ │ ├── ConfigAP_Limits.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.Designer.cs │ │ │ ├── ConfigAccelerometerCalibrationPlane.cs │ │ │ ├── ConfigAccelerometerCalibrationPlane.de-DE.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.es-ES.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.fr.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.it-IT.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.pl.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.zh-Hans.resx │ │ │ ├── ConfigAccelerometerCalibrationPlane.zh-TW.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.Designer.cs │ │ │ ├── ConfigAccelerometerCalibrationQuad.cs │ │ │ ├── ConfigAccelerometerCalibrationQuad.de-DE.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.es-ES.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.fr.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.it-IT.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.pl.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.zh-Hans.resx │ │ │ ├── ConfigAccelerometerCalibrationQuad.zh-TW.resx │ │ │ ├── ConfigArducopter.Designer.cs │ │ │ ├── ConfigArducopter.cs │ │ │ ├── ConfigArducopter.de-DE.resx │ │ │ ├── ConfigArducopter.fr.resx │ │ │ ├── ConfigArducopter.resx │ │ │ ├── ConfigArduplane.Designer.cs │ │ │ ├── ConfigArduplane.cs │ │ │ ├── ConfigArduplane.de-DE.resx │ │ │ ├── ConfigArduplane.fr.resx │ │ │ ├── ConfigArduplane.resx │ │ │ ├── ConfigArdurover.Designer.cs │ │ │ ├── ConfigArdurover.cs │ │ │ ├── ConfigArdurover.de-DE.resx │ │ │ ├── ConfigArdurover.fr.resx │ │ │ ├── ConfigArdurover.resx │ │ │ ├── ConfigAteryx.Designer.cs │ │ │ ├── ConfigAteryx.cs │ │ │ ├── ConfigAteryx.de-DE.resx │ │ │ ├── ConfigAteryx.fr.resx │ │ │ ├── ConfigAteryx.resx │ │ │ ├── ConfigAteryxSensors.Designer.cs │ │ │ ├── ConfigAteryxSensors.cs │ │ │ ├── ConfigAteryxSensors.de-DE.resx │ │ │ ├── ConfigAteryxSensors.es-ES.resx │ │ │ ├── ConfigAteryxSensors.fr.resx │ │ │ ├── ConfigAteryxSensors.it-IT.resx │ │ │ ├── ConfigAteryxSensors.pl.resx │ │ │ ├── ConfigAteryxSensors.resx │ │ │ ├── ConfigAteryxSensors.zh-Hans.resx │ │ │ ├── ConfigAteryxSensors.zh-TW.resx │ │ │ ├── ConfigBatteryMonitoring.Designer.cs │ │ │ ├── ConfigBatteryMonitoring.cs │ │ │ ├── ConfigBatteryMonitoring.de-DE.resx │ │ │ ├── ConfigBatteryMonitoring.es-ES.resx │ │ │ ├── ConfigBatteryMonitoring.fr.resx │ │ │ ├── ConfigBatteryMonitoring.it-IT.resx │ │ │ ├── ConfigBatteryMonitoring.pl.resx │ │ │ ├── ConfigBatteryMonitoring.resx │ │ │ ├── ConfigBatteryMonitoring.zh-Hans.resx │ │ │ ├── ConfigBatteryMonitoring.zh-TW.resx │ │ │ ├── ConfigCameraParams.Designer.cs │ │ │ ├── ConfigCameraParams.cs │ │ │ ├── ConfigCameraParams.resx │ │ │ ├── ConfigCameraStab.Designer.cs │ │ │ ├── ConfigCameraStab.cs │ │ │ ├── ConfigCameraStab.resx │ │ │ ├── ConfigFailSafe.Designer.cs │ │ │ ├── ConfigFailSafe.cs │ │ │ ├── ConfigFailSafe.de-DE.resx │ │ │ ├── ConfigFailSafe.es-ES.resx │ │ │ ├── ConfigFailSafe.fr.resx │ │ │ ├── ConfigFailSafe.it-IT.resx │ │ │ ├── ConfigFailSafe.pl.resx │ │ │ ├── ConfigFailSafe.resx │ │ │ ├── ConfigFailSafe.zh-Hans.resx │ │ │ ├── ConfigFailSafe.zh-TW.resx │ │ │ ├── ConfigFlightModes.Designer.cs │ │ │ ├── ConfigFlightModes.cs │ │ │ ├── ConfigFlightModes.de-DE.resx │ │ │ ├── ConfigFlightModes.es-ES.resx │ │ │ ├── ConfigFlightModes.fr.resx │ │ │ ├── ConfigFlightModes.it-IT.resx │ │ │ ├── ConfigFlightModes.pl.resx │ │ │ ├── ConfigFlightModes.resx │ │ │ ├── ConfigFlightModes.zh-Hans.resx │ │ │ ├── ConfigFlightModes.zh-TW.resx │ │ │ ├── ConfigFriendlyParams.Designer.cs │ │ │ ├── ConfigFriendlyParams.cs │ │ │ ├── ConfigFriendlyParams.resx │ │ │ ├── ConfigHardwareOptions.Designer.cs │ │ │ ├── ConfigHardwareOptions.cs │ │ │ ├── ConfigHardwareOptions.de-DE.resx │ │ │ ├── ConfigHardwareOptions.es-ES.resx │ │ │ ├── ConfigHardwareOptions.fr.resx │ │ │ ├── ConfigHardwareOptions.it-IT.resx │ │ │ ├── ConfigHardwareOptions.pl.resx │ │ │ ├── ConfigHardwareOptions.resx │ │ │ ├── ConfigHardwareOptions.zh-Hans.resx │ │ │ ├── ConfigHardwareOptions.zh-TW.resx │ │ │ ├── ConfigMount.cs │ │ │ ├── ConfigMount.designer.cs │ │ │ ├── ConfigMount.fr.resx │ │ │ ├── ConfigMount.resx │ │ │ ├── ConfigMount.zh-Hans.resx │ │ │ ├── ConfigPlanner.Designer.cs │ │ │ ├── ConfigPlanner.cs │ │ │ ├── ConfigPlanner.de-DE.resx │ │ │ ├── ConfigPlanner.fr.resx │ │ │ ├── ConfigPlanner.resx │ │ │ ├── ConfigPlanner.zh-Hans.resx │ │ │ ├── ConfigRadioInput.Designer.cs │ │ │ ├── ConfigRadioInput.cs │ │ │ ├── ConfigRadioInput.de-DE.resx │ │ │ ├── ConfigRadioInput.es-ES.resx │ │ │ ├── ConfigRadioInput.fr.resx │ │ │ ├── ConfigRadioInput.it-IT.resx │ │ │ ├── ConfigRadioInput.pl.resx │ │ │ ├── ConfigRadioInput.resx │ │ │ ├── ConfigRadioInput.zh-Hans.resx │ │ │ ├── ConfigRadioInput.zh-TW.resx │ │ │ ├── ConfigRawParams.Designer.cs │ │ │ ├── ConfigRawParams.cs │ │ │ ├── ConfigRawParams.de-DE.resx │ │ │ ├── ConfigRawParams.fr.resx │ │ │ ├── ConfigRawParams.resx │ │ │ ├── ConfigSignalization.cs │ │ │ ├── ConfigSignalization.designer.cs │ │ │ ├── ConfigSignalization.resx │ │ │ ├── ConfigTradHeli.Designer.cs │ │ │ ├── ConfigTradHeli.cs │ │ │ ├── ConfigTradHeli.de-DE.resx │ │ │ ├── ConfigTradHeli.es-ES.resx │ │ │ ├── ConfigTradHeli.fr.resx │ │ │ ├── ConfigTradHeli.it-IT.resx │ │ │ ├── ConfigTradHeli.pl.resx │ │ │ ├── ConfigTradHeli.resx │ │ │ ├── ConfigTradHeli.zh-Hans.resx │ │ │ ├── ConfigTradHeli.zh-TW.resx │ │ │ ├── GCSViews.ConfigurationView.ConfigMount.de-DE.resx │ │ │ ├── Setup.Designer.cs │ │ │ ├── Setup.cs │ │ │ ├── Setup.resx │ │ │ ├── SetupFresh.Designer.cs │ │ │ ├── SetupFresh.cs │ │ │ └── SetupFresh.resx │ │ ├── Firmware.Designer.cs │ │ ├── Firmware.cs │ │ ├── Firmware.de-DE.resx │ │ ├── Firmware.es-ES.resx │ │ ├── Firmware.fr.resx │ │ ├── Firmware.it-IT.resx │ │ ├── Firmware.pl.resx │ │ ├── Firmware.resx │ │ ├── Firmware.ru-RU.resx │ │ ├── Firmware.zh-Hans.resx │ │ ├── Firmware.zh-TW.resx │ │ ├── FlightData.Designer.cs │ │ ├── FlightData.cs │ │ ├── FlightData.de-DE.resx │ │ ├── FlightData.es-ES.resx │ │ ├── FlightData.fr.resx │ │ ├── FlightData.it-IT.resx │ │ ├── FlightData.pl.resx │ │ ├── FlightData.resx │ │ ├── FlightData.ru-RU.resx │ │ ├── FlightData.zh-Hans.resx │ │ ├── FlightData.zh-TW.resx │ │ ├── FlightPlanner.Designer.cs │ │ ├── FlightPlanner.cs │ │ ├── FlightPlanner.de-DE.resx │ │ ├── FlightPlanner.es-ES.resx │ │ ├── FlightPlanner.fr.resx │ │ ├── FlightPlanner.it-IT.resx │ │ ├── FlightPlanner.pl.resx │ │ ├── FlightPlanner.resx │ │ ├── FlightPlanner.ru-RU.resx │ │ ├── FlightPlanner.zh-Hans.resx │ │ ├── FlightPlanner.zh-TW.resx │ │ ├── HUD.ru.resx │ │ ├── Help.Designer.cs │ │ ├── Help.cs │ │ ├── Help.de-DE.resx │ │ ├── Help.es-ES.resx │ │ ├── Help.fr.resx │ │ ├── Help.it-IT.resx │ │ ├── Help.pl.resx │ │ ├── Help.resx │ │ ├── Help.ru-RU.resx │ │ ├── Help.zh-Hans.resx │ │ ├── Help.zh-TW.resx │ │ ├── JoystickSetup.ru.resx │ │ ├── Simulation.Designer.cs │ │ ├── Simulation.cs │ │ ├── Simulation.de-DE.resx │ │ ├── Simulation.es-ES.resx │ │ ├── Simulation.fr.resx │ │ ├── Simulation.it-IT.resx │ │ ├── Simulation.pl.resx │ │ ├── Simulation.resx │ │ ├── Simulation.ru-RU.resx │ │ ├── Simulation.zh-Hans.resx │ │ ├── Simulation.zh-TW.resx │ │ ├── Terminal.Designer.cs │ │ ├── Terminal.cs │ │ ├── Terminal.de-DE.resx │ │ ├── Terminal.es-ES.resx │ │ ├── Terminal.fr.resx │ │ ├── Terminal.it-IT.resx │ │ ├── Terminal.pl.resx │ │ ├── Terminal.resx │ │ ├── Terminal.ru-RU.resx │ │ ├── Terminal.zh-Hans.resx │ │ └── Terminal.zh-TW.resx │ ├── Gentemp.Designer.cs │ ├── Gentemp.cs │ ├── HIL │ │ ├── AeroSimRC.cs │ │ ├── Aircraft.cs │ │ ├── FlightGear.cs │ │ ├── Hil.cs │ │ ├── JSBSim.cs │ │ ├── Matrix3.cs │ │ ├── Point3d.cs │ │ ├── QuadCopter.cs │ │ ├── Quaternion.cs │ │ ├── Utils.cs │ │ ├── Vector3.cs │ │ ├── Vector3d.cs │ │ ├── Wind.cs │ │ └── XPlane.cs │ ├── Half.cs │ ├── HalfHelper.cs │ ├── JSBSim.exe │ ├── Joystick.cs │ ├── JoystickSetup.Designer.cs │ ├── JoystickSetup.cs │ ├── JoystickSetup.de-DE.resx │ ├── JoystickSetup.es-ES.resx │ ├── JoystickSetup.fr.resx │ ├── JoystickSetup.it-IT.resx │ ├── JoystickSetup.pl.resx │ ├── JoystickSetup.resx │ ├── JoystickSetup.ru-RU.resx │ ├── JoystickSetup.zh-Hans.resx │ ├── JoystickSetup.zh-TW.resx │ ├── Lib │ │ ├── AStar.dll │ │ ├── BSE.Windows.Forms.dll │ │ ├── Core.dll │ │ ├── DirectShowLib-2005.dll │ │ ├── GMap.NET.Core.dll │ │ ├── GMap.NET.WindowsForms.dll │ │ ├── ICSharpCode.SharpZipLib.dll │ │ ├── Ionic.Zip.Reduced.dll │ │ ├── IronPython.Modules.dll │ │ ├── IronPython.dll │ │ ├── KMLib.dll │ │ ├── MetaDataExtractor.dll │ │ ├── Microsoft.DirectX.DirectInput.dll │ │ ├── Microsoft.DirectX.dll │ │ ├── Microsoft.Dynamic.dll │ │ ├── Microsoft.Scripting.Core.dll │ │ ├── Microsoft.Scripting.Debugging.dll │ │ ├── Microsoft.Scripting.ExtensionAttribute.dll │ │ ├── Microsoft.Scripting.dll │ │ ├── OpenTK.GLControl.dll │ │ ├── OpenTK.dll │ │ ├── SharpKml.dll │ │ ├── System.Data.SQLite.DLL │ │ ├── System.Reactive.dll │ │ ├── System.Speech.dll │ │ ├── Transitions.dll │ │ ├── ZedGraph.dll │ │ ├── alglibnet2.dll │ │ ├── log4net.dll │ │ └── netDxf.dll │ ├── Log.Designer.cs │ ├── Log.cs │ ├── Log.de-DE.resx │ ├── Log.es-ES.resx │ ├── Log.fr.resx │ ├── Log.it-IT.resx │ ├── Log.pl.resx │ ├── Log.resx │ ├── Log.zh-Hans.resx │ ├── Log.zh-TW.resx │ ├── LogBrowse.cs │ ├── LogBrowse.de-DE.resx │ ├── LogBrowse.designer.cs │ ├── LogBrowse.es-ES.resx │ ├── LogBrowse.fr.resx │ ├── LogBrowse.it-IT.resx │ ├── LogBrowse.pl.resx │ ├── LogBrowse.resx │ ├── LogBrowse.zh-Hans.resx │ ├── LogBrowse.zh-TW.resx │ ├── MAC │ │ ├── Info.plist │ │ └── run.sh │ ├── MAVLink.xml │ ├── MagCalib.cs │ ├── MainV2.Designer.cs │ ├── MainV2.cs │ ├── MainV2.resx │ ├── Mavlink │ │ ├── MAVLink.cs │ │ ├── MAVLinkTypes.cs │ │ ├── MAVLinkTypes0.9.cs │ │ ├── MavlinkCRC.cs │ │ ├── MavlinkOther.cs │ │ └── MavlinkUtil.cs │ ├── MavlinkLog.Designer.cs │ ├── MavlinkLog.cs │ ├── MavlinkLog.de-DE.resx │ ├── MavlinkLog.es-ES.resx │ ├── MavlinkLog.fr.resx │ ├── MavlinkLog.it-IT.resx │ ├── MavlinkLog.pl.resx │ ├── MavlinkLog.resx │ ├── MavlinkLog.zh-Hans.resx │ ├── Msi │ │ ├── .gitignore │ │ ├── googlecode_upload.py │ │ ├── installer.bat │ │ ├── installer.wxs │ │ ├── originstaller.wxs │ │ └── wix.exe.config │ ├── NetSerial.cs │ ├── NetSerialServer.cs │ ├── OpenGLtest.cs │ ├── OpenGLtest.resx │ ├── PIDTunning.cs │ ├── Presenter │ │ ├── ConfigCameraStabPresenter.cs │ │ ├── DelegateCommand.cs │ │ └── ICommand.cs │ ├── Program.cs │ ├── Properties │ │ ├── AssemblyInfo.cs │ │ ├── DataSources │ │ │ └── CurrentState.datasource │ │ ├── Resources.Designer.cs │ │ ├── Resources.resx │ │ ├── Resources.zh-Hans.resx │ │ └── app.manifest │ ├── Protocol.cs │ ├── RAW_Sensor.Designer.cs │ ├── RAW_Sensor.cs │ ├── RAW_Sensor.de-DE.resx │ ├── RAW_Sensor.es-ES.resx │ ├── RAW_Sensor.fr.resx │ ├── RAW_Sensor.it-IT.resx │ ├── RAW_Sensor.pl.resx │ ├── RAW_Sensor.resx │ ├── Radio │ │ ├── 3DRradio.Designer.cs │ │ ├── 3DRradio.cs │ │ ├── 3DRradio.de-DE.resx │ │ ├── 3DRradio.fr.resx │ │ ├── 3DRradio.resx │ │ ├── 3DRradio.zh-Hans.resx │ │ ├── IHex.cs │ │ └── Uploader.cs │ ├── ResEdit.Designer.cs │ ├── ResEdit.cs │ ├── ResEdit.resx │ ├── Resources │ │ ├── 09028-01.jpg │ │ ├── AC-0004-11-2.jpg │ │ ├── APM_airframes-07.png │ │ ├── APM_airframes-08.png │ │ ├── APM_airframes_001.png │ │ ├── APM_airframes_002.png │ │ ├── APM_rover-firmware.png │ │ ├── BR-0004-03-2.jpg │ │ ├── BR-0016-01-3T.jpg │ │ ├── BR-APMPWRDEAN-2.jpg │ │ ├── BR-HMC5883-01-2.jpg │ │ ├── MAVCmd.txt │ │ ├── MAVCmd.zh-Hans.txt │ │ ├── MAVCmd.zh-TW.txt │ │ ├── MAVParam.txt │ │ ├── MAVParam.zh-Hans.txt │ │ ├── MAVParam.zh-TW.txt │ │ ├── Welcome_CN.rtf │ │ ├── Welcome_TW.rtf │ │ ├── Welcome_to_Michael_Oborne.rtf │ │ ├── apm2.ico │ │ ├── bg.jpg │ │ ├── cameraGimalPitch1.png │ │ ├── cameraGimalRoll1.png │ │ ├── cameraGimalYaw.png │ │ ├── car.png │ │ ├── configuration.png │ │ ├── connect.png │ │ ├── data.png │ │ ├── disconnect.png │ │ ├── down.png │ │ ├── firmware.png │ │ ├── frames-01.png │ │ ├── frames-02.png │ │ ├── frames-03.png │ │ ├── frames-04.png │ │ ├── frames-05.png │ │ ├── frames-06.png │ │ ├── frames-07.png │ │ ├── frames-08.png │ │ ├── frames_color.rar │ │ ├── frames_plus.png │ │ ├── frames_x.png │ │ ├── guagebg.jpg │ │ ├── help.png │ │ ├── icon.png │ │ ├── iconWarning32.png │ │ ├── iconWarning48.png │ │ ├── new frames-01.png │ │ ├── new frames-05.png │ │ ├── new frames-05X.png │ │ ├── new frames-06.png │ │ ├── new frames-09.png │ │ ├── new frames-10.png │ │ ├── new frames-11.png │ │ ├── new frames-12.png │ │ ├── new frames-13.png │ │ ├── new frames-14.png │ │ ├── octox.png │ │ ├── plane2.png │ │ ├── planetracker.png │ │ ├── planner.png │ │ ├── quad.png │ │ ├── quad2.png │ │ ├── rover.png │ │ ├── simulation.png │ │ ├── splash.jpg │ │ ├── terminal.png │ │ ├── up.png │ │ ├── x8.png │ │ └── y6.png │ ├── Script.cs │ ├── SerialOutput.Designer.cs │ ├── SerialOutput.cs │ ├── SerialOutput.resx │ ├── SerialOutput2.Designer.cs │ ├── SerialOutput2.cs │ ├── SerialOutput2.resx │ ├── Splash.Designer.cs │ ├── Splash.cs │ ├── Splash.resx │ ├── Updater │ │ ├── Program.cs │ │ ├── Properties │ │ │ ├── AssemblyInfo.cs │ │ │ ├── Resources.Designer.cs │ │ │ ├── Resources.resx │ │ │ ├── Settings.Designer.cs │ │ │ └── Settings.settings │ │ ├── Updater.csproj │ │ ├── Updater.sln │ │ └── app.config │ ├── Utilities │ │ ├── AviWriter.cs │ │ ├── Capture.cs │ │ ├── CaptureMJPEG.cs │ │ ├── CollectionExtensions.cs │ │ ├── EnumTranslator.cs │ │ ├── LangUtility.cs │ │ ├── ParameterMetaDataConstants.cs │ │ ├── ParameterMetaDataParser.cs │ │ ├── ParameterMetaDataRepository.cs │ │ ├── PathFind.cs │ │ ├── Speech.cs │ │ ├── TCPConsole.cs │ │ ├── ThemeManager.cs │ │ ├── Video.cs │ │ └── hires.cs │ ├── apm2.ico │ ├── app.config │ ├── arducopter-xplane.zip │ ├── block_plane_0.dae │ ├── build.bat │ ├── convert.pl │ ├── dataflashlog.xml │ ├── georefimage.cs │ ├── georefimage.resx │ ├── hud.html │ ├── hudold.cs │ ├── m3u │ │ ├── GeoRefnetworklink.kml │ │ ├── both.m3u │ │ ├── hud.m3u │ │ ├── map.m3u │ │ └── networklink.kml │ ├── mavcmd.xml │ ├── mavlinklist-xml-dontuse.pl │ ├── mavlinklist.pl │ ├── mykey.snk │ ├── paramcompare.Designer.cs │ ├── paramcompare.cs │ ├── paramcompare.resx │ ├── quadhil.xml │ ├── resedit.Form1.de-DE.resx │ ├── resedit │ │ ├── Form1.Designer.cs │ │ ├── Form1.cs │ │ ├── Form1.resx │ │ ├── Program.cs │ │ ├── Properties │ │ │ ├── AssemblyInfo.cs │ │ │ ├── Resources.Designer.cs │ │ │ ├── Resources.resx │ │ │ ├── Settings.Designer.cs │ │ │ └── Settings.settings │ │ ├── app.config │ │ └── resedit.csproj │ ├── srtm.cs │ ├── temp.Designer.cs │ ├── temp.cs │ ├── temp.resx │ └── wix │ │ ├── Program.cs │ │ ├── Properties │ │ ├── AssemblyInfo.cs │ │ ├── Resources.Designer.cs │ │ ├── Resources.resx │ │ ├── Settings.Designer.cs │ │ ├── Settings.settings │ │ └── app.manifest │ │ ├── app.config │ │ └── wix.csproj ├── CPUInfo │ ├── CPUInfo.pde │ ├── Makefile │ ├── nocore.inoflag │ ├── output-px4.txt │ └── output.txt ├── Failsafe │ ├── Failsafe.pde │ └── Makefile ├── FlightGear │ ├── FGShim.c │ ├── MAVLink.xml │ ├── Makefile │ └── fgfs ├── GIT_Test │ └── GIT_Success.txt ├── Hello │ ├── Hello.pde │ ├── Makefile │ └── nocore.inoflag ├── PPM_decoding │ ├── PPM_decoding.pde │ └── Timers.pde ├── SerialProxy │ ├── SerialProxy.sln │ ├── SerialProxy.suo │ └── SerialProxy │ │ ├── Form1.Designer.cs │ │ ├── Form1.cs │ │ ├── Form1.resx │ │ ├── Program.cs │ │ ├── Properties │ │ ├── AssemblyInfo.cs │ │ ├── Resources.Designer.cs │ │ ├── Resources.resx │ │ ├── Settings.Designer.cs │ │ └── Settings.settings │ │ ├── SerialProxy.csproj │ │ ├── SerialProxy.csproj.user │ │ ├── app.config │ │ └── bin │ │ └── Release │ │ ├── SerialProxy.exe │ │ ├── SerialProxy.exe.config │ │ ├── SerialProxy.pdb │ │ └── mac.jpg ├── VARTest │ ├── APM_Config.h │ ├── Makefile │ ├── Parameters.h │ ├── Parameters.pde │ ├── VARTest.pde │ ├── config.h │ ├── defines.h │ └── nocore.inoflag ├── Xplane │ ├── Electrostreak_Brushless_RC.zip │ ├── X-Plane.pl │ ├── X-Plane_Data_In_out_UPD_RATE_50.png │ ├── X-Plane_Data_In_out_settings.png │ ├── X-Plane_Inet_settings.png │ └── serproxy-0.1.3-3 │ │ ├── README-wiring.txt │ │ ├── serproxy │ │ ├── serproxy.cfg │ │ └── serproxy.cfg copy ├── autotest │ ├── ArduCopter.parm │ ├── ArduPlane.parm │ ├── CMAC-circuit.txt │ ├── README │ ├── Rover.parm │ ├── aircraft │ │ ├── Rascal │ │ │ ├── Dialogs │ │ │ │ └── config.xml │ │ │ ├── Engines │ │ │ │ ├── 18x8.xml │ │ │ │ └── Zenoah_G-26A.xml │ │ │ ├── Models │ │ │ │ ├── Rascal.rgb │ │ │ │ ├── Rascal110-000-013.ac │ │ │ │ ├── Rascal110.xml │ │ │ │ ├── Trajectory-Marker.ac │ │ │ │ ├── Trajectory-Marker.xml │ │ │ │ ├── smoke.png │ │ │ │ └── smokeW.xml │ │ │ ├── README.Rascal │ │ │ ├── Rascal-keyboard.xml │ │ │ ├── Rascal-submodels.xml │ │ │ ├── Rascal.xml │ │ │ ├── Rascal110-JSBSim-set.xml │ │ │ ├── Rascal110-JSBSim.xml │ │ │ ├── Rascal110-splash.rgb │ │ │ ├── Systems │ │ │ │ ├── 110-autopilot.xml │ │ │ │ ├── airdata.nas │ │ │ │ ├── electrical.xml │ │ │ │ ├── main.nas │ │ │ │ └── ugear.nas │ │ │ ├── reset_CMAC.xml │ │ │ ├── reset_template.xml │ │ │ └── thumbnail.jpg │ │ └── arducopter │ │ │ ├── Engines │ │ │ ├── a2830-12.xml │ │ │ └── prop10x4.5.xml │ │ │ ├── Models │ │ │ ├── AutoSave_plus_quad.skp │ │ │ ├── Untitled.ac │ │ │ ├── Untitled.skp │ │ │ ├── Y6_test.ac │ │ │ ├── Y6_test.skp │ │ │ ├── Y6_test2.skp │ │ │ ├── _propeller0_.skb │ │ │ ├── _propeller0_.skp │ │ │ ├── arducopter.ac │ │ │ ├── arducopter.xml │ │ │ ├── plus_quad.ac │ │ │ ├── plus_quad.skb │ │ │ ├── plus_quad.skp │ │ │ ├── plus_quad2.ac │ │ │ ├── plus_quad2.dae │ │ │ ├── plus_quad2.skb │ │ │ ├── plus_quad2.skp │ │ │ ├── plus_quad2.xml │ │ │ ├── quad.3ds │ │ │ ├── quad.skp │ │ │ └── shareware_output.3ds │ │ │ ├── README │ │ │ ├── arducopter-set.xml │ │ │ ├── arducopter.jpg │ │ │ ├── arducopter.xml │ │ │ ├── data │ │ │ ├── arducopter_half_step.txt │ │ │ ├── arducopter_step.txt │ │ │ └── rw_generic_pylon.ac │ │ │ ├── initfile.xml │ │ │ ├── plus_quad2-set.xml │ │ │ ├── plus_quad2.xml │ │ │ └── quad.nas │ ├── ap1.txt │ ├── apm_unit_tests │ │ ├── dev │ │ │ ├── arducopter_AP_Limits.py │ │ │ ├── arducopter_Loiter.py │ │ │ ├── arducopter_RTL.py │ │ │ ├── arducopter_climb_descend.py │ │ │ └── arducopter_failsafe.py │ │ ├── examples │ │ │ └── arducopter_example_level.py │ │ └── mustpass │ │ │ ├── arducopter_arm_disarm.py │ │ │ └── arducopter_takeoff.py │ ├── apmrover2.py │ ├── arducopter.py │ ├── arduplane.py │ ├── autotest.py │ ├── autotest_jenkins.py │ ├── common.py │ ├── fakepos.py │ ├── fg_plane_view.sh │ ├── fg_quad_view.sh │ ├── jsbsim │ │ ├── fgout.xml │ │ ├── rascal_test.xml │ │ └── runsim.py │ ├── junit.xml │ ├── mission1.txt │ ├── mission2.txt │ ├── mission3.txt │ ├── mission_ttt.txt │ ├── param_metadata │ │ ├── param.py │ │ └── param_parse.py │ ├── pysim │ │ ├── aircraft.py │ │ ├── fdpexpect.py │ │ ├── fg_display.py │ │ ├── multicopter.py │ │ ├── rotmat.py │ │ ├── rover.py │ │ ├── sim_multicopter.py │ │ ├── sim_rover.py │ │ ├── testwind.py │ │ └── util.py │ ├── rover1.txt │ ├── sim_arducopter.sh │ ├── sim_arducopter10.sh │ ├── sim_arduplane.sh │ ├── sim_arduplane10.sh │ ├── sim_arduplane_kingaroy.sh │ ├── sim_rover.sh │ └── web │ │ ├── css │ │ ├── images │ │ │ ├── bg.png │ │ │ └── logo.png │ │ └── main.css │ │ └── index.html ├── run_sim_mission.py └── scripts │ ├── arduino_version.sh │ ├── build_all.sh │ ├── build_examples.sh │ ├── format.sh │ └── frame_sizes.py ├── archive ├── ArducopterNG │ ├── ArduUser.h │ ├── Arducopter.h │ ├── ArducopterNG.pde │ ├── Attitude.pde │ ├── CLI.pde │ ├── DCM.pde │ ├── Debug.pde │ ├── EEPROM.pde │ ├── Events.pde │ ├── Functions.pde │ ├── GCS.pde │ ├── Heli.h │ ├── Heli.pde │ ├── Log.pde │ ├── Mixer.pde │ ├── Motors.pde │ ├── Navigation.pde │ ├── README │ ├── Radio.pde │ ├── Sensors.pde │ └── System.pde ├── Configurator │ ├── Builds │ │ └── ArduCopterConfigurator │ │ │ └── Executable │ │ │ ├── ArduCopterConfigurator.aliases │ │ │ ├── ArduCopterConfigurator.exe │ │ │ ├── ArduCopterConfigurator.ini │ │ │ └── data │ │ │ ├── ArduCopterConfigurator.ini │ │ │ └── lvanlys.dll │ ├── Configurator.Net │ │ ├── ArducopterConfigurator.csproj │ │ ├── ArducopterConfigurator.sln │ │ ├── CommsSession.cs │ │ ├── Core │ │ │ ├── DelegateCommand.cs │ │ │ ├── IPresentationModel.cs │ │ │ └── IView.cs │ │ ├── FakeCommsSession.cs │ │ ├── Lib3 │ │ │ ├── nunit-console.exe │ │ │ └── nunit.framework.dll │ │ ├── NotifyProperyChangedBase.cs │ │ ├── PresentationModels │ │ │ ├── AcroModeConfigVm.cs │ │ │ ├── AltitudeHoldConfigVm.cs │ │ │ ├── ConfigWithPidsBase.cs │ │ │ ├── CrudVm.cs │ │ │ ├── DoubleVm.cs │ │ │ ├── FlightControlPidsVm.cs │ │ │ ├── GPSstatusVm.cs │ │ │ ├── ItalksToApm.cs │ │ │ ├── MainVm.cs │ │ │ ├── MotorCommandsVm.cs │ │ │ ├── PositionAltitudePidsVm.cs │ │ │ ├── PositionHoldConfigVm.cs │ │ │ ├── SensorsVm.cs │ │ │ ├── SerialMonitorVm.cs │ │ │ ├── StableModeConfigVm.cs │ │ │ ├── TransmitterChannelsVm.cs │ │ │ └── VmBase.cs │ │ ├── Program.cs │ │ ├── Properties │ │ │ ├── AssemblyInfo.cs │ │ │ ├── DataSources │ │ │ │ ├── ArducopterConfigurator.PresentationModels.AcroModeConfigVm.datasource │ │ │ │ ├── ArducopterConfigurator.PresentationModels.FlightDataVm.datasource │ │ │ │ ├── ArducopterConfigurator.PresentationModels.MainVm.datasource │ │ │ │ ├── ArducopterConfigurator.PresentationModels.StableModeConfigVm.datasource │ │ │ │ └── SerialMonitorVm.datasource │ │ │ ├── Resources.Designer.cs │ │ │ ├── Resources.resx │ │ │ ├── Settings.Designer.cs │ │ │ └── Settings.settings │ │ ├── Readme.txt │ │ ├── SensorDisplay.cs │ │ ├── SensorDisplay.resx │ │ ├── Test │ │ │ ├── AcroModeConfigVmTest.cs │ │ │ ├── AltitudeHoldVmTest.cs │ │ │ ├── ArducopterConfiguratorTest.csproj │ │ │ ├── CalibrationOffsetsDataVmTest.cs │ │ │ ├── MainVmTests.cs │ │ │ ├── MockComms.cs │ │ │ ├── MotorCommandsVmTest.cs │ │ │ ├── PositionHoldConfigVmTest.cs │ │ │ ├── Properties │ │ │ │ └── AssemblyInfo.cs │ │ │ ├── StableModeConfigVmTest.cs │ │ │ ├── TransmitterChannelsVmTests.cs │ │ │ └── VmTestBase.cs │ │ ├── VerticalProgressBar.cs │ │ ├── Views │ │ │ ├── AcroConfigView.Designer.cs │ │ │ ├── AcroConfigView.cs │ │ │ ├── AcroConfigView.resx │ │ │ ├── AltitudeHoldConfigView.Designer.cs │ │ │ ├── AltitudeHoldConfigView.cs │ │ │ ├── AltitudeHoldConfigView.resx │ │ │ ├── FlightControlPidsView.Designer.cs │ │ │ ├── FlightControlPidsView.cs │ │ │ ├── FlightControlPidsView.resx │ │ │ ├── FlightDataView.Designer.cs │ │ │ ├── FlightDataView.cs │ │ │ ├── FlightDataView.resx │ │ │ ├── GpsView.Designer.cs │ │ │ ├── GpsView.cs │ │ │ ├── GpsView.resx │ │ │ ├── MotorCommandsView.Designer.cs │ │ │ ├── MotorCommandsView.cs │ │ │ ├── MotorCommandsView.resx │ │ │ ├── PositionAltitudePidsView.Designer.cs │ │ │ ├── PositionAltitudePidsView.cs │ │ │ ├── PositionAltitudePidsView.resx │ │ │ ├── PositionHoldConfigView.Designer.cs │ │ │ ├── PositionHoldConfigView.cs │ │ │ ├── PositionHoldConfigView.resx │ │ │ ├── SerialMonitorView.Designer.cs │ │ │ ├── SerialMonitorView.cs │ │ │ ├── SerialMonitorView.resx │ │ │ ├── StableConfigView.Designer.cs │ │ │ ├── StableConfigView.cs │ │ │ ├── StableConfigView.resx │ │ │ ├── TransmitterChannelsView.Designer.cs │ │ │ ├── TransmitterChannelsView.cs │ │ │ ├── TransmitterChannelsView.resx │ │ │ ├── ViewCommon.cs │ │ │ ├── controls │ │ │ │ ├── CircularIndicatorControl.Designer.cs │ │ │ │ ├── CircularIndicatorControl.cs │ │ │ │ ├── CircularIndicatorControl.resx │ │ │ │ ├── CompassControl.Designer.cs │ │ │ │ ├── CompassControl.cs │ │ │ │ ├── CompassControl.resx │ │ │ │ ├── LinearIndicatorControl.Designer.cs │ │ │ │ ├── LinearIndicatorControl.cs │ │ │ │ ├── PropControl.Designer.cs │ │ │ │ ├── PropControl.cs │ │ │ │ ├── PropControl.resx │ │ │ │ ├── QuadPlanControl.Designer.cs │ │ │ │ ├── QuadPlanControl.cs │ │ │ │ └── QuadPlanControl.resx │ │ │ ├── icons │ │ │ │ ├── Misc-Tools.ico │ │ │ │ ├── arrow_up.png │ │ │ │ ├── chip.gif │ │ │ │ ├── connect.ico │ │ │ │ ├── disconnect.ico │ │ │ │ ├── install.png │ │ │ │ ├── refresh.ico │ │ │ │ └── saveIcon.png │ │ │ ├── mainForm.Designer.cs │ │ │ ├── mainForm.cs │ │ │ └── mainForm.resx │ │ └── configuratorCert.pfx │ └── Source │ │ ├── ArduCopterConfigurator.ini │ │ ├── ArduCopterConfigurator.lvproj │ │ ├── ArduCopterConfigurator.vi │ │ ├── Dialog │ │ ├── ErrorDialog.vi │ │ └── ReconnectDialog.vi │ │ ├── Icon │ │ ├── Config-Tools.ico │ │ └── IM.icns │ │ └── Utilities │ │ ├── DecodeSensorBytes.vi │ │ ├── FindUserAppFolder.vi │ │ ├── TDMS - AeroQuad File Viewer.vi │ │ ├── TDMS │ │ ├── G TDMS 8x.mnu │ │ └── _G TDMS 8x.llb │ │ └── WriteEEPROM.vi ├── PPMEncoder │ ├── ap_ppm_encoder.aps │ ├── ap_ppm_encoder.aws │ ├── ap_ppm_encoder.c │ ├── default │ │ ├── Makefile │ │ ├── ap_ppm_encoder.eep │ │ ├── ap_ppm_encoder.elf │ │ ├── ap_ppm_encoder.hex │ │ ├── ap_ppm_encoder.lss │ │ ├── ap_ppm_encoder.map │ │ ├── dep │ │ │ └── ap_ppm_encoder.o.d │ │ └── ppm_enconder_at328.bat │ └── servo2ppm_settings.h ├── WaypointWriterCopterMega │ ├── EEPROM.pde │ ├── WaypointWriterCopterMega.pde │ ├── defines.h │ ├── event_example.h │ ├── mission_example.h │ ├── sparkfun.h │ └── takeoff.h └── WaypointWriterMega │ ├── EEPROM.pde │ ├── WaypointWriterCopterMega.pde │ ├── defines.h │ ├── event_example.h │ ├── mission_example.h │ ├── sparkfun.h │ └── takeoff.h ├── cmake ├── ArduinoToolchain.cmake ├── Platform │ └── Arduino.cmake ├── modules │ ├── APMCPackConfig.cmake │ ├── APMOption.cmake │ ├── MacroEnsureOutOfSourceBuild.cmake │ └── UseDoxygen.cmake └── updated-arduino-cmake.sh ├── libraries ├── AC_PID │ ├── AC_PID.cpp │ ├── AC_PID.h │ ├── examples │ │ └── AC_PID_test │ │ │ ├── AC_PID_test.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ └── keywords.txt ├── APM_Control │ ├── APM_Control.h │ ├── AP_PitchController.cpp │ ├── AP_PitchController.h │ ├── AP_RollController.cpp │ ├── AP_RollController.h │ ├── AP_YawController.cpp │ └── AP_YawController.h ├── APM_OBC │ ├── APM_OBC.cpp │ ├── APM_OBC.h │ ├── Failsafe_Board │ │ ├── Failsafe_Board.pde │ │ ├── Makefile │ │ └── nobuild.txt │ └── examples │ │ └── trivial_APM_OBC │ │ ├── Makefile │ │ ├── nocore.inoflag │ │ └── trivial_APM_OBC.pde ├── APM_PI │ ├── APM_PI.cpp │ └── APM_PI.h ├── AP_ADC │ ├── AP_ADC.cpp │ ├── AP_ADC.h │ ├── AP_ADC_ADS7844.cpp │ ├── AP_ADC_ADS7844.h │ ├── AP_ADC_HIL.cpp │ ├── AP_ADC_HIL.h │ ├── examples │ │ └── AP_ADC_test │ │ │ ├── AP_ADC_test.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ └── keywords.txt ├── AP_ADC_AnalogSource │ ├── AP_ADC_AnalogSource.cpp │ └── AP_ADC_AnalogSource.h ├── AP_AHRS │ ├── AP_AHRS.cpp │ ├── AP_AHRS.h │ ├── AP_AHRS_DCM.cpp │ ├── AP_AHRS_DCM.h │ ├── AP_AHRS_HIL.cpp │ ├── AP_AHRS_HIL.h │ ├── AP_AHRS_MPU6000.cpp │ ├── AP_AHRS_MPU6000.h │ └── examples │ │ └── AHRS_Test │ │ ├── AHRS_Test.pde │ │ ├── Makefile │ │ ├── nocore.inoflag │ │ └── norelax.inoflag ├── AP_Airspeed │ ├── AP_Airspeed.cpp │ ├── AP_Airspeed.h │ └── examples │ │ └── Airspeed │ │ ├── Airspeed.pde │ │ ├── Makefile │ │ └── nocore.inoflag ├── AP_Baro │ ├── AP_Baro.cpp │ ├── AP_Baro.h │ ├── AP_Baro_BMP085.cpp │ ├── AP_Baro_BMP085.h │ ├── AP_Baro_BMP085_hil.cpp │ ├── AP_Baro_BMP085_hil.h │ ├── AP_Baro_MS5611.cpp │ ├── AP_Baro_MS5611.h │ ├── AP_Baro_PX4.cpp │ ├── AP_Baro_PX4.h │ └── examples │ │ ├── AP_Baro_BMP085_test │ │ ├── AP_Baro_BMP085_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag │ │ ├── AP_Baro_MS5611_test │ │ ├── AP_Baro_MS5611_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag │ │ └── AP_Baro_PX4_test │ │ ├── AP_Baro_PX4_test.pde │ │ └── Makefile ├── AP_Buffer │ └── AP_Buffer.h ├── AP_Camera │ ├── AP_Camera.cpp │ └── AP_Camera.h ├── AP_Common │ ├── AP_Common.h │ ├── AP_Test.h │ ├── Arduino.h │ ├── c++.cpp │ └── keywords.txt ├── AP_Compass │ ├── AP_Compass.h │ ├── AP_Compass_HIL.cpp │ ├── AP_Compass_HIL.h │ ├── AP_Compass_HMC5843.cpp │ ├── AP_Compass_HMC5843.h │ ├── AP_Compass_PX4.cpp │ ├── AP_Compass_PX4.h │ ├── Compass.cpp │ ├── Compass.h │ ├── examples │ │ └── AP_Compass_test │ │ │ ├── AP_Compass_test.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ └── keywords.txt ├── AP_Curve │ ├── AP_Curve.cpp │ └── AP_Curve.h ├── AP_Declination │ ├── AP_Declination.cpp │ ├── AP_Declination.h │ └── examples │ │ └── AP_Declination_test │ │ ├── AP_Declination_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag ├── AP_GPS │ ├── AP_GPS.h │ ├── AP_GPS_406.cpp │ ├── AP_GPS_406.h │ ├── AP_GPS_Auto.cpp │ ├── AP_GPS_Auto.h │ ├── AP_GPS_HIL.cpp │ ├── AP_GPS_HIL.h │ ├── AP_GPS_MTK.cpp │ ├── AP_GPS_MTK.h │ ├── AP_GPS_MTK16.cpp │ ├── AP_GPS_MTK16.h │ ├── AP_GPS_MTK19.cpp │ ├── AP_GPS_MTK19.h │ ├── AP_GPS_MTK_Common.h │ ├── AP_GPS_NMEA.cpp │ ├── AP_GPS_NMEA.h │ ├── AP_GPS_None.h │ ├── AP_GPS_SIRF.cpp │ ├── AP_GPS_SIRF.h │ ├── AP_GPS_Shim.h │ ├── AP_GPS_UBLOX.cpp │ ├── AP_GPS_UBLOX.h │ ├── GPS.cpp │ ├── GPS.h │ ├── config │ │ └── 3DR-Ublox.txt │ └── examples │ │ ├── GPS_406_test │ │ ├── GPS_406_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag │ │ ├── GPS_AUTO_test │ │ ├── GPS_AUTO_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag │ │ ├── GPS_MTK_test │ │ ├── GPS_MTK_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag │ │ ├── GPS_NMEA_test │ │ ├── GPS_NMEA_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag │ │ └── GPS_UBLOX_test │ │ ├── GPS_UBLOX_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag ├── AP_HAL │ ├── AP_HAL.h │ ├── AP_HAL_Boards.h │ ├── AP_HAL_Namespace.h │ ├── AnalogIn.h │ ├── Console.h │ ├── GPIO.h │ ├── HAL.h │ ├── I2CDriver.h │ ├── RCInput.h │ ├── RCOutput.h │ ├── SPIDriver.h │ ├── Scheduler.h │ ├── Semaphores.h │ ├── Storage.h │ ├── UARTDriver.h │ ├── Util.h │ └── utility │ │ ├── BetterStream.h │ │ ├── Print.cpp │ │ ├── Print.h │ │ └── Stream.h ├── AP_HAL_AVR │ ├── AP_HAL_AVR.h │ ├── AP_HAL_AVR_Main.h │ ├── AP_HAL_AVR_Namespace.h │ ├── AP_HAL_AVR_private.h │ ├── AnalogIn.h │ ├── AnalogIn_ADC.cpp │ ├── AnalogIn_Common.cpp │ ├── Console.cpp │ ├── Console.h │ ├── GPIO.cpp │ ├── GPIO.h │ ├── HAL_AVR_APM1_Class.cpp │ ├── HAL_AVR_APM1_Class.h │ ├── HAL_AVR_APM2_Class.cpp │ ├── HAL_AVR_APM2_Class.h │ ├── I2CDriver.cpp │ ├── I2CDriver.h │ ├── RCInput.h │ ├── RCInput_APM1.cpp │ ├── RCInput_APM2.cpp │ ├── RCOutput.h │ ├── RCOutput_APM1.cpp │ ├── RCOutput_APM2.cpp │ ├── SPIDeviceManager_APM1.cpp │ ├── SPIDeviceManager_APM2.cpp │ ├── SPIDevice_SPI0.cpp │ ├── SPIDevice_SPI2.cpp │ ├── SPIDevice_SPI3.cpp │ ├── SPIDevices.h │ ├── SPIDriver.h │ ├── Scheduler.cpp │ ├── Scheduler.h │ ├── Scheduler_Timer.cpp │ ├── Semaphores.cpp │ ├── Semaphores.h │ ├── Storage.cpp │ ├── Storage.h │ ├── UARTDriver.cpp │ ├── UARTDriver.h │ ├── Util.cpp │ ├── Util.h │ ├── build_all.sh │ ├── examples │ │ ├── AnalogIn │ │ │ ├── AnalogIn.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ ├── ArduCopterLibs │ │ │ ├── ArduCopterLibs.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ ├── ArduPlaneLibs │ │ │ ├── ArduPlaneLibs.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ ├── Blink │ │ │ ├── Blink.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ ├── Console │ │ │ ├── Console.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ ├── I2CDriver_HMC5883L │ │ │ ├── I2CDriver_HMC5883L.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ ├── LCDTest │ │ │ ├── LCDTest.pde │ │ │ ├── LCrystal.cpp │ │ │ ├── LCrystal.h │ │ │ ├── Makefile │ │ │ ├── README │ │ │ └── nocore.inoflag │ │ ├── RCInputTest │ │ │ ├── Makefile │ │ │ ├── RCInputTest.pde │ │ │ └── nocore.inoflag │ │ ├── RCPassthroughTest │ │ │ ├── Makefile │ │ │ ├── RCPassthroughTest.pde │ │ │ └── nocore.inoflag │ │ ├── SPIDriver_MPU6000 │ │ │ ├── MPU6000.h │ │ │ ├── Makefile │ │ │ ├── SPIDriver_MPU6000.pde │ │ │ └── nocore.inoflag │ │ ├── Scheduler │ │ │ ├── Makefile │ │ │ ├── Scheduler.pde │ │ │ └── nocore.inoflag │ │ ├── Semaphore │ │ │ ├── Makefile │ │ │ ├── Semaphore.pde │ │ │ └── nocore.inoflag │ │ ├── Storage │ │ │ ├── Makefile │ │ │ ├── Storage.pde │ │ │ └── nocore.inoflag │ │ ├── UARTDriver │ │ │ ├── Makefile │ │ │ ├── UARTDriver.pde │ │ │ └── nocore.inoflag │ │ └── UtilityStringTest │ │ │ ├── Makefile │ │ │ ├── UtilityStringTest.pde │ │ │ └── nocore.inoflag │ └── utility │ │ ├── ISRRegistry.cpp │ │ ├── ISRRegistry.h │ │ ├── ftoa_engine.S │ │ ├── ftoa_engine.h │ │ ├── macros.inc │ │ ├── ntz.h │ │ ├── pins_arduino_mega.c │ │ ├── pins_arduino_mega.h │ │ ├── print_vprintf.cpp │ │ ├── print_vprintf.h │ │ ├── ultoa_invert.S │ │ └── xtoa_fast.h ├── AP_HAL_AVR_SITL │ ├── AP_HAL_AVR_SITL.h │ ├── AP_HAL_AVR_SITL_Main.h │ ├── AP_HAL_AVR_SITL_Namespace.h │ ├── AP_HAL_AVR_SITL_Private.h │ ├── AnalogIn.cpp │ ├── AnalogIn.h │ ├── Console.cpp │ ├── Console.h │ ├── HAL_AVR_SITL_Class.cpp │ ├── HAL_AVR_SITL_Class.h │ ├── RCInput.cpp │ ├── RCInput.h │ ├── RCOutput.cpp │ ├── RCOutput.h │ ├── SITL_State.cpp │ ├── SITL_State.h │ ├── Scheduler.cpp │ ├── Scheduler.h │ ├── Storage.cpp │ ├── Storage.h │ ├── UARTDriver.cpp │ ├── UARTDriver.h │ ├── Util.cpp │ ├── Util.h │ ├── sitl_barometer.cpp │ ├── sitl_compass.cpp │ ├── sitl_gps.cpp │ ├── sitl_ins.cpp │ └── utility │ │ ├── print_vprintf.cpp │ │ └── print_vprintf.h ├── AP_HAL_Empty │ ├── AP_HAL_Empty.h │ ├── AP_HAL_Empty_Main.h │ ├── AP_HAL_Empty_Namespace.h │ ├── AP_HAL_Empty_Private.h │ ├── AnalogIn.cpp │ ├── AnalogIn.h │ ├── Console.cpp │ ├── Console.h │ ├── GPIO.cpp │ ├── GPIO.h │ ├── HAL_Empty_Class.cpp │ ├── HAL_Empty_Class.h │ ├── I2CDriver.cpp │ ├── I2CDriver.h │ ├── PrivateMember.cpp │ ├── PrivateMember.h │ ├── RCInput.cpp │ ├── RCInput.h │ ├── RCOutput.cpp │ ├── RCOutput.h │ ├── SPIDriver.cpp │ ├── SPIDriver.h │ ├── Scheduler.cpp │ ├── Scheduler.h │ ├── Semaphores.cpp │ ├── Semaphores.h │ ├── Storage.cpp │ ├── Storage.h │ ├── UARTDriver.cpp │ ├── UARTDriver.h │ ├── Util.cpp │ ├── Util.h │ └── examples │ │ └── empty_example │ │ ├── Makefile │ │ ├── empty_example.pde │ │ └── nocore.inoflag ├── AP_HAL_PX4 │ ├── AP_HAL_PX4.h │ ├── AP_HAL_PX4_Main.h │ ├── AP_HAL_PX4_Namespace.h │ ├── Console.cpp │ ├── Console.h │ ├── HAL_PX4_Class.cpp │ ├── HAL_PX4_Class.h │ ├── RCInput.cpp │ ├── RCInput.h │ ├── RCOutput.cpp │ ├── RCOutput.h │ ├── Scheduler.cpp │ ├── Scheduler.h │ ├── Storage.cpp │ ├── Storage.h │ ├── UARTDriver.cpp │ ├── UARTDriver.h │ └── examples │ │ └── simple │ │ ├── Makefile │ │ ├── nocore.inoflag │ │ └── simple.pde ├── AP_HAL_SMACCM │ ├── AP_HAL_SMACCM.h │ ├── AP_HAL_SMACCM_Main.cpp │ ├── AP_HAL_SMACCM_Main.h │ ├── AP_HAL_SMACCM_Namespace.h │ ├── AP_HAL_SMACCM_Private.h │ ├── AnalogIn.cpp │ ├── AnalogIn.h │ ├── Console.cpp │ ├── Console.h │ ├── GPIO.cpp │ ├── GPIO.h │ ├── HAL_SMACCM_Class.cpp │ ├── HAL_SMACCM_Class.h │ ├── I2CDriver.cpp │ ├── I2CDriver.h │ ├── PrivateMember.cpp │ ├── PrivateMember.h │ ├── RCInput.cpp │ ├── RCInput.h │ ├── RCOutput.cpp │ ├── RCOutput.h │ ├── SPIDriver.cpp │ ├── SPIDriver.h │ ├── Scheduler.cpp │ ├── Scheduler.h │ ├── Semaphores.cpp │ ├── Semaphores.h │ ├── Storage.cpp │ ├── Storage.h │ ├── UARTDriver.cpp │ ├── UARTDriver.h │ ├── Util.cpp │ ├── Util.h │ └── examples │ │ └── empty_example │ │ ├── Makefile │ │ ├── empty_example.pde │ │ └── nocore.inoflag ├── AP_InertialNav │ ├── AP_InertialNav.cpp │ ├── AP_InertialNav.h │ └── examples │ │ └── AP_InertialNav_test │ │ ├── AP_InertialNav_test.pde │ │ ├── Makefile │ │ ├── nocore.infoflag │ │ └── norelax.inoflag ├── AP_InertialSensor │ ├── AP_InertialSensor.cpp │ ├── AP_InertialSensor.h │ ├── AP_InertialSensor_MPU6000.cpp │ ├── AP_InertialSensor_MPU6000.h │ ├── AP_InertialSensor_Oilpan.cpp │ ├── AP_InertialSensor_Oilpan.h │ ├── AP_InertialSensor_PX4.cpp │ ├── AP_InertialSensor_PX4.h │ ├── AP_InertialSensor_Stub.cpp │ ├── AP_InertialSensor_Stub.h │ ├── AP_InertialSensor_UserInteract.h │ ├── AP_InertialSensor_UserInteract_Stream.cpp │ ├── AP_InertialSensor_UserInteract_Stream.h │ └── examples │ │ ├── MPU6000 │ │ ├── MPU6000.pde │ │ ├── Makefile │ │ ├── nocore.inoflag │ │ └── norelax.inoflag │ │ └── PX4 │ │ ├── Makefile │ │ └── PX4.pde ├── AP_LeadFilter │ ├── AP_LeadFilter.cpp │ ├── AP_LeadFilter.h │ └── examples │ │ └── AP_LeadFilter │ │ ├── AP_LeadFilter.pde │ │ ├── Makefile │ │ └── nocore.inoflag ├── AP_Limits │ ├── AP_Limit_Altitude.cpp │ ├── AP_Limit_Altitude.h │ ├── AP_Limit_GPSLock.cpp │ ├── AP_Limit_GPSLock.h │ ├── AP_Limit_Geofence.cpp │ ├── AP_Limit_Geofence.h │ ├── AP_Limit_Module.cpp │ ├── AP_Limit_Module.h │ ├── AP_Limits.cpp │ └── AP_Limits.h ├── AP_Math │ ├── AP_Math.cpp │ ├── AP_Math.h │ ├── examples │ │ ├── eulers │ │ │ ├── Makefile │ │ │ ├── eulers.pde │ │ │ └── nocore.inoflag │ │ ├── location │ │ │ ├── Makefile │ │ │ ├── location.pde │ │ │ └── nocore.inoflag │ │ ├── polygon │ │ │ ├── Makefile │ │ │ ├── nocore.inoflag │ │ │ └── polygon.pde │ │ └── rotations │ │ │ ├── Makefile │ │ │ ├── nocore.inoflag │ │ │ └── rotations.pde │ ├── keywords.txt │ ├── location.cpp │ ├── matrix3.cpp │ ├── matrix3.h │ ├── polygon.cpp │ ├── polygon.h │ ├── quaternion.cpp │ ├── quaternion.h │ ├── rotations.h │ ├── vector2.cpp │ ├── vector2.h │ ├── vector3.cpp │ └── vector3.h ├── AP_Menu │ ├── AP_Menu.cpp │ ├── AP_Menu.h │ └── examples │ │ └── menu │ │ ├── Makefile │ │ ├── menu.pde │ │ └── nocore.inoflag ├── AP_Motors │ ├── AP_Motors.h │ ├── AP_MotorsHeli.cpp │ ├── AP_MotorsHeli.h │ ├── AP_MotorsHexa.cpp │ ├── AP_MotorsHexa.h │ ├── AP_MotorsMatrix.cpp │ ├── AP_MotorsMatrix.h │ ├── AP_MotorsOcta.cpp │ ├── AP_MotorsOcta.h │ ├── AP_MotorsOctaQuad.cpp │ ├── AP_MotorsOctaQuad.h │ ├── AP_MotorsQuad.cpp │ ├── AP_MotorsQuad.h │ ├── AP_MotorsTri.cpp │ ├── AP_MotorsTri.h │ ├── AP_MotorsY6.cpp │ ├── AP_MotorsY6.h │ ├── AP_Motors_Class.cpp │ ├── AP_Motors_Class.h │ └── examples │ │ └── AP_Motors_test │ │ ├── AP_Motors_test.pde │ │ ├── Makefile │ │ └── nocore.inoflag ├── AP_Mount │ ├── AP_Mount.cpp │ ├── AP_Mount.h │ └── examples │ │ └── trivial_AP_Mount │ │ ├── Makefile │ │ ├── nocore.inoflag │ │ └── trivial_AP_Mount.pde ├── AP_OpticalFlow │ ├── AP_OpticalFlow.cpp │ ├── AP_OpticalFlow.h │ ├── AP_OpticalFlow_ADNS3080.cpp │ ├── AP_OpticalFlow_ADNS3080.h │ ├── examples │ │ ├── ADNS3080ImageGrabber │ │ │ ├── ADNS3080ImageGrabber.py │ │ │ └── README.txt │ │ └── AP_OpticalFlow_test │ │ │ ├── AP_OpticalFlow_test.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ └── keywords.txt ├── AP_Param │ ├── AP_Param.cpp │ ├── AP_Param.h │ └── tools │ │ ├── eedump.c │ │ ├── eedump.pl │ │ ├── eedump_apparam.c │ │ └── eedump_apparam.pl ├── AP_PerfMon │ ├── AP_PerfMon.cpp │ ├── AP_PerfMon.h │ └── AP_PerfMon_test │ │ └── AP_PerfMon_test.pde ├── AP_Progmem │ ├── AP_Progmem.h │ ├── AP_Progmem_AVR.cpp │ ├── AP_Progmem_AVR.h │ └── AP_Progmem_Identity.h ├── AP_RangeFinder │ ├── AP_RangeFinder.h │ ├── AP_RangeFinder_MaxsonarI2CXL.cpp │ ├── AP_RangeFinder_MaxsonarI2CXL.h │ ├── AP_RangeFinder_MaxsonarXL.cpp │ ├── AP_RangeFinder_MaxsonarXL.h │ ├── AP_RangeFinder_SharpGP2Y.cpp │ ├── AP_RangeFinder_SharpGP2Y.h │ ├── RangeFinder.cpp │ ├── RangeFinder.h │ ├── examples │ │ └── MaxsonarXL_test │ │ │ ├── Makefile │ │ │ ├── MaxsonarXL_test.pde │ │ │ └── nocore.inoflag │ └── keywords.txt ├── AP_Relay │ ├── AP_Relay.cpp │ └── AP_Relay.h ├── DataFlash │ ├── DataFlash.cpp │ ├── DataFlash.h │ ├── DataFlash_APM1.cpp │ ├── DataFlash_APM1.h │ ├── DataFlash_APM2.cpp │ ├── DataFlash_APM2.h │ ├── DataFlash_Empty.cpp │ ├── DataFlash_Empty.h │ ├── DataFlash_SITL.cpp │ ├── DataFlash_SITL.h │ ├── examples │ │ └── DataFlash_test │ │ │ ├── DataFlash_test.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ └── keywords.txt ├── Filter │ ├── AverageFilter.h │ ├── DerivativeFilter.cpp │ ├── DerivativeFilter.h │ ├── Filter.h │ ├── FilterClass.h │ ├── FilterWithBuffer.h │ ├── LowPassFilter.h │ ├── ModeFilter.h │ ├── examples │ │ ├── Derivative │ │ │ ├── Derivative.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ ├── Filter │ │ │ ├── Filter.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ │ └── LowPassFilter │ │ │ ├── LowPassFilter.pde │ │ │ ├── Makefile │ │ │ └── nocore.inoflag │ └── keywords.txt ├── GCS_Console │ ├── GCS_Console.cpp │ ├── GCS_Console.h │ └── examples │ │ └── Console │ │ ├── Console.pde │ │ ├── Makefile │ │ ├── nocore.inoflag │ │ ├── simplegcs.cpp │ │ └── simplegcs.h ├── GCS_MAVLink │ ├── .gitignore │ ├── GCS_MAVLink.cpp │ ├── GCS_MAVLink.h │ ├── generate.sh │ ├── include │ │ └── mavlink │ │ │ ├── v0.9 │ │ │ ├── ardupilotmega │ │ │ │ ├── ardupilotmega.h │ │ │ │ ├── mavlink.h │ │ │ │ ├── mavlink_msg_ahrs.h │ │ │ │ ├── mavlink_msg_ap_adc.h │ │ │ │ ├── mavlink_msg_digicam_configure.h │ │ │ │ ├── mavlink_msg_digicam_control.h │ │ │ │ ├── mavlink_msg_fence_fetch_point.h │ │ │ │ ├── mavlink_msg_fence_point.h │ │ │ │ ├── mavlink_msg_fence_status.h │ │ │ │ ├── mavlink_msg_hwstatus.h │ │ │ │ ├── mavlink_msg_limits_status.h │ │ │ │ ├── mavlink_msg_meminfo.h │ │ │ │ ├── mavlink_msg_mount_configure.h │ │ │ │ ├── mavlink_msg_mount_control.h │ │ │ │ ├── mavlink_msg_mount_status.h │ │ │ │ ├── mavlink_msg_radio.h │ │ │ │ ├── mavlink_msg_sensor_offsets.h │ │ │ │ ├── mavlink_msg_set_mag_offsets.h │ │ │ │ ├── mavlink_msg_simstate.h │ │ │ │ ├── testsuite.h │ │ │ │ └── version.h │ │ │ ├── checksum.h │ │ │ ├── common │ │ │ │ ├── common.h │ │ │ │ ├── mavlink.h │ │ │ │ ├── mavlink_msg_action.h │ │ │ │ ├── mavlink_msg_action_ack.h │ │ │ │ ├── mavlink_msg_attitude.h │ │ │ │ ├── mavlink_msg_auth_key.h │ │ │ │ ├── mavlink_msg_boot.h │ │ │ │ ├── mavlink_msg_change_operator_control.h │ │ │ │ ├── mavlink_msg_change_operator_control_ack.h │ │ │ │ ├── mavlink_msg_command.h │ │ │ │ ├── mavlink_msg_command_ack.h │ │ │ │ ├── mavlink_msg_control_status.h │ │ │ │ ├── mavlink_msg_debug.h │ │ │ │ ├── mavlink_msg_debug_vect.h │ │ │ │ ├── mavlink_msg_global_position.h │ │ │ │ ├── mavlink_msg_global_position_int.h │ │ │ │ ├── mavlink_msg_gps_local_origin_set.h │ │ │ │ ├── mavlink_msg_gps_raw.h │ │ │ │ ├── mavlink_msg_gps_raw_int.h │ │ │ │ ├── mavlink_msg_gps_set_global_origin.h │ │ │ │ ├── mavlink_msg_gps_status.h │ │ │ │ ├── mavlink_msg_heartbeat.h │ │ │ │ ├── mavlink_msg_hil_controls.h │ │ │ │ ├── mavlink_msg_hil_state.h │ │ │ │ ├── mavlink_msg_local_position.h │ │ │ │ ├── mavlink_msg_local_position_setpoint.h │ │ │ │ ├── mavlink_msg_local_position_setpoint_set.h │ │ │ │ ├── mavlink_msg_manual_control.h │ │ │ │ ├── mavlink_msg_named_value_float.h │ │ │ │ ├── mavlink_msg_named_value_int.h │ │ │ │ ├── mavlink_msg_nav_controller_output.h │ │ │ │ ├── mavlink_msg_object_detection_event.h │ │ │ │ ├── mavlink_msg_optical_flow.h │ │ │ │ ├── mavlink_msg_param_request_list.h │ │ │ │ ├── mavlink_msg_param_request_read.h │ │ │ │ ├── mavlink_msg_param_set.h │ │ │ │ ├── mavlink_msg_param_value.h │ │ │ │ ├── mavlink_msg_ping.h │ │ │ │ ├── mavlink_msg_position_target.h │ │ │ │ ├── mavlink_msg_raw_imu.h │ │ │ │ ├── mavlink_msg_raw_pressure.h │ │ │ │ ├── mavlink_msg_rc_channels_override.h │ │ │ │ ├── mavlink_msg_rc_channels_raw.h │ │ │ │ ├── mavlink_msg_rc_channels_scaled.h │ │ │ │ ├── mavlink_msg_request_data_stream.h │ │ │ │ ├── mavlink_msg_roll_pitch_yaw_speed_thrust_setpoint.h │ │ │ │ ├── mavlink_msg_roll_pitch_yaw_thrust_setpoint.h │ │ │ │ ├── mavlink_msg_safety_allowed_area.h │ │ │ │ ├── mavlink_msg_safety_set_allowed_area.h │ │ │ │ ├── mavlink_msg_scaled_imu.h │ │ │ │ ├── mavlink_msg_scaled_pressure.h │ │ │ │ ├── mavlink_msg_servo_output_raw.h │ │ │ │ ├── mavlink_msg_set_altitude.h │ │ │ │ ├── mavlink_msg_set_mode.h │ │ │ │ ├── mavlink_msg_set_nav_mode.h │ │ │ │ ├── mavlink_msg_set_roll_pitch_yaw_speed_thrust.h │ │ │ │ ├── mavlink_msg_set_roll_pitch_yaw_thrust.h │ │ │ │ ├── mavlink_msg_state_correction.h │ │ │ │ ├── mavlink_msg_statustext.h │ │ │ │ ├── mavlink_msg_sys_status.h │ │ │ │ ├── mavlink_msg_system_time.h │ │ │ │ ├── mavlink_msg_system_time_utc.h │ │ │ │ ├── mavlink_msg_vfr_hud.h │ │ │ │ ├── mavlink_msg_waypoint.h │ │ │ │ ├── mavlink_msg_waypoint_ack.h │ │ │ │ ├── mavlink_msg_waypoint_clear_all.h │ │ │ │ ├── mavlink_msg_waypoint_count.h │ │ │ │ ├── mavlink_msg_waypoint_current.h │ │ │ │ ├── mavlink_msg_waypoint_reached.h │ │ │ │ ├── mavlink_msg_waypoint_request.h │ │ │ │ ├── mavlink_msg_waypoint_request_list.h │ │ │ │ ├── mavlink_msg_waypoint_set_current.h │ │ │ │ ├── testsuite.h │ │ │ │ └── version.h │ │ │ ├── mavlink_helpers.h │ │ │ ├── mavlink_types.h │ │ │ └── protocol.h │ │ │ └── v1.0 │ │ │ ├── ardupilotmega │ │ │ ├── ardupilotmega.h │ │ │ ├── mavlink.h │ │ │ ├── mavlink_msg_ahrs.h │ │ │ ├── mavlink_msg_ap_adc.h │ │ │ ├── mavlink_msg_data100.h │ │ │ ├── mavlink_msg_data16.h │ │ │ ├── mavlink_msg_data32.h │ │ │ ├── mavlink_msg_data64.h │ │ │ ├── mavlink_msg_data96.h │ │ │ ├── mavlink_msg_digicam_configure.h │ │ │ ├── mavlink_msg_digicam_control.h │ │ │ ├── mavlink_msg_fence_fetch_point.h │ │ │ ├── mavlink_msg_fence_point.h │ │ │ ├── mavlink_msg_fence_status.h │ │ │ ├── mavlink_msg_hwstatus.h │ │ │ ├── mavlink_msg_limits_status.h │ │ │ ├── mavlink_msg_meminfo.h │ │ │ ├── mavlink_msg_mount_configure.h │ │ │ ├── mavlink_msg_mount_control.h │ │ │ ├── mavlink_msg_mount_status.h │ │ │ ├── mavlink_msg_radio.h │ │ │ ├── mavlink_msg_sensor_offsets.h │ │ │ ├── mavlink_msg_set_mag_offsets.h │ │ │ ├── mavlink_msg_simstate.h │ │ │ ├── mavlink_msg_wind.h │ │ │ ├── testsuite.h │ │ │ └── version.h │ │ │ ├── checksum.h │ │ │ ├── common │ │ │ ├── common.h │ │ │ ├── mavlink.h │ │ │ ├── mavlink_msg_attitude.h │ │ │ ├── mavlink_msg_attitude_quaternion.h │ │ │ ├── mavlink_msg_auth_key.h │ │ │ ├── mavlink_msg_battery_status.h │ │ │ ├── mavlink_msg_change_operator_control.h │ │ │ ├── mavlink_msg_change_operator_control_ack.h │ │ │ ├── mavlink_msg_command_ack.h │ │ │ ├── mavlink_msg_command_long.h │ │ │ ├── mavlink_msg_data_stream.h │ │ │ ├── mavlink_msg_debug.h │ │ │ ├── mavlink_msg_debug_vect.h │ │ │ ├── mavlink_msg_file_transfer_dir_list.h │ │ │ ├── mavlink_msg_file_transfer_res.h │ │ │ ├── mavlink_msg_file_transfer_start.h │ │ │ ├── mavlink_msg_global_position_int.h │ │ │ ├── mavlink_msg_global_position_setpoint_int.h │ │ │ ├── mavlink_msg_global_vision_position_estimate.h │ │ │ ├── mavlink_msg_gps_global_origin.h │ │ │ ├── mavlink_msg_gps_raw_int.h │ │ │ ├── mavlink_msg_gps_status.h │ │ │ ├── mavlink_msg_heartbeat.h │ │ │ ├── mavlink_msg_highres_imu.h │ │ │ ├── mavlink_msg_hil_controls.h │ │ │ ├── mavlink_msg_hil_rc_inputs_raw.h │ │ │ ├── mavlink_msg_hil_state.h │ │ │ ├── mavlink_msg_local_position_ned.h │ │ │ ├── mavlink_msg_local_position_ned_system_global_offset.h │ │ │ ├── mavlink_msg_local_position_setpoint.h │ │ │ ├── mavlink_msg_manual_control.h │ │ │ ├── mavlink_msg_manual_setpoint.h │ │ │ ├── mavlink_msg_memory_vect.h │ │ │ ├── mavlink_msg_mission_ack.h │ │ │ ├── mavlink_msg_mission_clear_all.h │ │ │ ├── mavlink_msg_mission_count.h │ │ │ ├── mavlink_msg_mission_current.h │ │ │ ├── mavlink_msg_mission_item.h │ │ │ ├── mavlink_msg_mission_item_reached.h │ │ │ ├── mavlink_msg_mission_request.h │ │ │ ├── mavlink_msg_mission_request_list.h │ │ │ ├── mavlink_msg_mission_request_partial_list.h │ │ │ ├── mavlink_msg_mission_set_current.h │ │ │ ├── mavlink_msg_mission_write_partial_list.h │ │ │ ├── mavlink_msg_named_value_float.h │ │ │ ├── mavlink_msg_named_value_int.h │ │ │ ├── mavlink_msg_nav_controller_output.h │ │ │ ├── mavlink_msg_optical_flow.h │ │ │ ├── mavlink_msg_param_request_list.h │ │ │ ├── mavlink_msg_param_request_read.h │ │ │ ├── mavlink_msg_param_set.h │ │ │ ├── mavlink_msg_param_value.h │ │ │ ├── mavlink_msg_ping.h │ │ │ ├── mavlink_msg_raw_imu.h │ │ │ ├── mavlink_msg_raw_pressure.h │ │ │ ├── mavlink_msg_rc_channels_override.h │ │ │ ├── mavlink_msg_rc_channels_raw.h │ │ │ ├── mavlink_msg_rc_channels_scaled.h │ │ │ ├── mavlink_msg_request_data_stream.h │ │ │ ├── mavlink_msg_roll_pitch_yaw_rates_thrust_setpoint.h │ │ │ ├── mavlink_msg_roll_pitch_yaw_speed_thrust_setpoint.h │ │ │ ├── mavlink_msg_roll_pitch_yaw_thrust_setpoint.h │ │ │ ├── mavlink_msg_safety_allowed_area.h │ │ │ ├── mavlink_msg_safety_set_allowed_area.h │ │ │ ├── mavlink_msg_scaled_imu.h │ │ │ ├── mavlink_msg_scaled_pressure.h │ │ │ ├── mavlink_msg_servo_output_raw.h │ │ │ ├── mavlink_msg_set_global_position_setpoint_int.h │ │ │ ├── mavlink_msg_set_gps_global_origin.h │ │ │ ├── mavlink_msg_set_local_position_setpoint.h │ │ │ ├── mavlink_msg_set_mode.h │ │ │ ├── mavlink_msg_set_quad_motors_setpoint.h │ │ │ ├── mavlink_msg_set_quad_swarm_led_roll_pitch_yaw_thrust.h │ │ │ ├── mavlink_msg_set_quad_swarm_roll_pitch_yaw_thrust.h │ │ │ ├── mavlink_msg_set_roll_pitch_yaw_speed_thrust.h │ │ │ ├── mavlink_msg_set_roll_pitch_yaw_thrust.h │ │ │ ├── mavlink_msg_setpoint_6dof.h │ │ │ ├── mavlink_msg_setpoint_8dof.h │ │ │ ├── mavlink_msg_state_correction.h │ │ │ ├── mavlink_msg_statustext.h │ │ │ ├── mavlink_msg_sys_status.h │ │ │ ├── mavlink_msg_system_time.h │ │ │ ├── mavlink_msg_vfr_hud.h │ │ │ ├── mavlink_msg_vicon_position_estimate.h │ │ │ ├── mavlink_msg_vision_position_estimate.h │ │ │ ├── mavlink_msg_vision_speed_estimate.h │ │ │ ├── testsuite.h │ │ │ └── version.h │ │ │ ├── mavlink_helpers.h │ │ │ ├── mavlink_protobuf_manager.hpp │ │ │ ├── mavlink_types.h │ │ │ └── protocol.h │ └── message_definitions │ │ ├── ardupilotmega.xml │ │ ├── common.xml │ │ ├── matrixpilot.xml │ │ ├── minimal.xml │ │ ├── pixhawk.xml │ │ ├── sensesoar.xml │ │ ├── slugs.xml │ │ ├── test.xml │ │ └── ualberta.xml ├── PID │ ├── PID.cpp │ ├── PID.h │ ├── examples │ │ └── pid │ │ │ ├── Makefile │ │ │ ├── nocore.inoflag │ │ │ └── pid.pde │ └── keywords.txt ├── RC_Channel │ ├── RC_Channel.cpp │ ├── RC_Channel.h │ ├── RC_Channel_aux.cpp │ ├── RC_Channel_aux.h │ └── examples │ │ └── RC_Channel │ │ ├── Makefile │ │ ├── RC_Channel.pde │ │ └── nocore.inoflag ├── SITL │ ├── SITL.cpp │ └── SITL.h ├── doc │ ├── Doxyfile │ └── updateDocs └── memcheck │ ├── memcheck.cpp │ └── memcheck.h ├── mk ├── Arduino.mk ├── apm.mk ├── px4_core.mk ├── px4_targets.mk └── targets.mk ├── reformat.sh ├── uncrustify_cpp.cfg └── uncrustify_headers.cfg /.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/.gitignore -------------------------------------------------------------------------------- /.project: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/.project -------------------------------------------------------------------------------- /APMrover2/APM_Config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/APM_Config.h -------------------------------------------------------------------------------- /APMrover2/APM_Config.h.reference: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/APM_Config.h.reference -------------------------------------------------------------------------------- /APMrover2/APM_Config_HILmode.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/APM_Config_HILmode.h -------------------------------------------------------------------------------- /APMrover2/APM_Config_Rover.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/APM_Config_Rover.h -------------------------------------------------------------------------------- /APMrover2/APM_Config_mavlink_hil.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/APM_Config_mavlink_hil.h -------------------------------------------------------------------------------- /APMrover2/APMrover2.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/APMrover2.pde -------------------------------------------------------------------------------- /APMrover2/Attitude.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/Attitude.pde -------------------------------------------------------------------------------- /APMrover2/GCS.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/GCS.h -------------------------------------------------------------------------------- /APMrover2/GCS_Mavlink.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/GCS_Mavlink.pde -------------------------------------------------------------------------------- /APMrover2/Log.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/Log.pde -------------------------------------------------------------------------------- /APMrover2/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/Makefile -------------------------------------------------------------------------------- /APMrover2/Parameters.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/Parameters.h -------------------------------------------------------------------------------- /APMrover2/Parameters.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/Parameters.pde -------------------------------------------------------------------------------- /APMrover2/command_description.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/command_description.txt -------------------------------------------------------------------------------- /APMrover2/commands.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/commands.pde -------------------------------------------------------------------------------- /APMrover2/commands_logic.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/commands_logic.pde -------------------------------------------------------------------------------- /APMrover2/commands_process.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/commands_process.pde -------------------------------------------------------------------------------- /APMrover2/compat.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/compat.h -------------------------------------------------------------------------------- /APMrover2/compat.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/compat.pde -------------------------------------------------------------------------------- /APMrover2/config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/config.h -------------------------------------------------------------------------------- /APMrover2/control_modes.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/control_modes.pde -------------------------------------------------------------------------------- /APMrover2/createTags: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/createTags -------------------------------------------------------------------------------- /APMrover2/defines.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/defines.h -------------------------------------------------------------------------------- /APMrover2/events.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/events.pde -------------------------------------------------------------------------------- /APMrover2/failsafe.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/failsafe.pde -------------------------------------------------------------------------------- /APMrover2/navigation.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/navigation.pde -------------------------------------------------------------------------------- /APMrover2/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /APMrover2/radio.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/radio.pde -------------------------------------------------------------------------------- /APMrover2/sensors.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/sensors.pde -------------------------------------------------------------------------------- /APMrover2/setup.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/setup.pde -------------------------------------------------------------------------------- /APMrover2/system.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/system.pde -------------------------------------------------------------------------------- /APMrover2/test.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/APMrover2/test.pde -------------------------------------------------------------------------------- /ArduCopter/.gitignore: -------------------------------------------------------------------------------- 1 | arducopter.cpp 2 | -------------------------------------------------------------------------------- /ArduCopter/APM_Config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/APM_Config.h -------------------------------------------------------------------------------- /ArduCopter/APM_Config_mavlink_hil.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/APM_Config_mavlink_hil.h -------------------------------------------------------------------------------- /ArduCopter/AP_State.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/AP_State.pde -------------------------------------------------------------------------------- /ArduCopter/ArduCopter.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/ArduCopter.pde -------------------------------------------------------------------------------- /ArduCopter/Attitude.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/Attitude.pde -------------------------------------------------------------------------------- /ArduCopter/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/CMakeLists.txt -------------------------------------------------------------------------------- /ArduCopter/GCS.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/GCS.h -------------------------------------------------------------------------------- /ArduCopter/GCS_Mavlink.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/GCS_Mavlink.pde -------------------------------------------------------------------------------- /ArduCopter/Log.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/Log.pde -------------------------------------------------------------------------------- /ArduCopter/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/Makefile -------------------------------------------------------------------------------- /ArduCopter/Parameters.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/Parameters.h -------------------------------------------------------------------------------- /ArduCopter/Parameters.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/Parameters.pde -------------------------------------------------------------------------------- /ArduCopter/ReleaseNotes.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/ReleaseNotes.txt -------------------------------------------------------------------------------- /ArduCopter/UserCode.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/UserCode.pde -------------------------------------------------------------------------------- /ArduCopter/UserVariables.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/UserVariables.h -------------------------------------------------------------------------------- /ArduCopter/command_description.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/command_description.txt -------------------------------------------------------------------------------- /ArduCopter/commands.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/commands.pde -------------------------------------------------------------------------------- /ArduCopter/commands_logic.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/commands_logic.pde -------------------------------------------------------------------------------- /ArduCopter/commands_process.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/commands_process.pde -------------------------------------------------------------------------------- /ArduCopter/compat.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/compat.h -------------------------------------------------------------------------------- /ArduCopter/compat.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/compat.pde -------------------------------------------------------------------------------- /ArduCopter/config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/config.h -------------------------------------------------------------------------------- /ArduCopter/config_channels.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/config_channels.h -------------------------------------------------------------------------------- /ArduCopter/control_modes.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/control_modes.pde -------------------------------------------------------------------------------- /ArduCopter/defines.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/defines.h -------------------------------------------------------------------------------- /ArduCopter/events.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/events.pde -------------------------------------------------------------------------------- /ArduCopter/failsafe.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/failsafe.pde -------------------------------------------------------------------------------- /ArduCopter/flip.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/flip.pde -------------------------------------------------------------------------------- /ArduCopter/inertia.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/inertia.pde -------------------------------------------------------------------------------- /ArduCopter/leds.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/leds.pde -------------------------------------------------------------------------------- /ArduCopter/limits.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/limits.pde -------------------------------------------------------------------------------- /ArduCopter/motors.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/motors.pde -------------------------------------------------------------------------------- /ArduCopter/navigation.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/navigation.pde -------------------------------------------------------------------------------- /ArduCopter/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /ArduCopter/options.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/options.cmake -------------------------------------------------------------------------------- /ArduCopter/perf_info.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/perf_info.pde -------------------------------------------------------------------------------- /ArduCopter/radio.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/radio.pde -------------------------------------------------------------------------------- /ArduCopter/read_me.text: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/read_me.text -------------------------------------------------------------------------------- /ArduCopter/sensors.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/sensors.pde -------------------------------------------------------------------------------- /ArduCopter/setup.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/setup.pde -------------------------------------------------------------------------------- /ArduCopter/system.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/system.pde -------------------------------------------------------------------------------- /ArduCopter/test.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/test.pde -------------------------------------------------------------------------------- /ArduCopter/toy.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduCopter/toy.pde -------------------------------------------------------------------------------- /ArduPlane/APM_Config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/APM_Config.h -------------------------------------------------------------------------------- /ArduPlane/APM_Config.h.reference: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/APM_Config.h.reference -------------------------------------------------------------------------------- /ArduPlane/ArduPlane.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/ArduPlane.pde -------------------------------------------------------------------------------- /ArduPlane/Attitude.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/Attitude.pde -------------------------------------------------------------------------------- /ArduPlane/CMakeLists.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/CMakeLists.txt -------------------------------------------------------------------------------- /ArduPlane/GCS.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/GCS.h -------------------------------------------------------------------------------- /ArduPlane/GCS_Mavlink.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/GCS_Mavlink.pde -------------------------------------------------------------------------------- /ArduPlane/Log.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/Log.pde -------------------------------------------------------------------------------- /ArduPlane/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/Makefile -------------------------------------------------------------------------------- /ArduPlane/Parameters.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/Parameters.h -------------------------------------------------------------------------------- /ArduPlane/Parameters.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/Parameters.pde -------------------------------------------------------------------------------- /ArduPlane/climb_rate.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/climb_rate.pde -------------------------------------------------------------------------------- /ArduPlane/command_description.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/command_description.txt -------------------------------------------------------------------------------- /ArduPlane/commands.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/commands.pde -------------------------------------------------------------------------------- /ArduPlane/commands_logic.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/commands_logic.pde -------------------------------------------------------------------------------- /ArduPlane/commands_process.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/commands_process.pde -------------------------------------------------------------------------------- /ArduPlane/compat.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/compat.h -------------------------------------------------------------------------------- /ArduPlane/compat.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/compat.pde -------------------------------------------------------------------------------- /ArduPlane/config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/config.h -------------------------------------------------------------------------------- /ArduPlane/control_modes.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/control_modes.pde -------------------------------------------------------------------------------- /ArduPlane/createTags: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/createTags -------------------------------------------------------------------------------- /ArduPlane/defines.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/defines.h -------------------------------------------------------------------------------- /ArduPlane/events.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/events.pde -------------------------------------------------------------------------------- /ArduPlane/failsafe.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/failsafe.pde -------------------------------------------------------------------------------- /ArduPlane/geofence.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/geofence.pde -------------------------------------------------------------------------------- /ArduPlane/navigation.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/navigation.pde -------------------------------------------------------------------------------- /ArduPlane/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /ArduPlane/options.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/options.cmake -------------------------------------------------------------------------------- /ArduPlane/radio.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/radio.pde -------------------------------------------------------------------------------- /ArduPlane/sensors.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/sensors.pde -------------------------------------------------------------------------------- /ArduPlane/setup.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/setup.pde -------------------------------------------------------------------------------- /ArduPlane/system.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/system.pde -------------------------------------------------------------------------------- /ArduPlane/test.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/ArduPlane/test.pde -------------------------------------------------------------------------------- /COPYING.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/COPYING.txt -------------------------------------------------------------------------------- /Doxyfile.in: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Doxyfile.in -------------------------------------------------------------------------------- /README.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/README.txt -------------------------------------------------------------------------------- /README_AP_HAL.md: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/README_AP_HAL.md -------------------------------------------------------------------------------- /Tools/APM2_2560_bootloader/FLASH.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/APM2_2560_bootloader/FLASH.txt -------------------------------------------------------------------------------- /Tools/APM2_2560_bootloader/License.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/APM2_2560_bootloader/License.txt -------------------------------------------------------------------------------- /Tools/APM2_2560_bootloader/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/APM2_2560_bootloader/Makefile -------------------------------------------------------------------------------- /Tools/APM2_2560_bootloader/README.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/APM2_2560_bootloader/README.txt -------------------------------------------------------------------------------- /Tools/APM2_2560_bootloader/command.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/APM2_2560_bootloader/command.h -------------------------------------------------------------------------------- /Tools/APM2_2560_bootloader/stk500boot.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/APM2_2560_bootloader/stk500boot.c -------------------------------------------------------------------------------- /Tools/APM_radio_test/APM_radio_test.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/APM_radio_test/APM_radio_test.pde -------------------------------------------------------------------------------- /Tools/APM_radio_test/Makefile: -------------------------------------------------------------------------------- 1 | include ../../mk/apm.mk 2 | -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega328p/Encoder-PPM -v3.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega328p/Encoder-PPM -v3.c -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega328p/Encoder-PPM.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega328p/Encoder-PPM.c -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega328p/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega328p/Makefile -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega328p/manual.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega328p/manual.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega328p/readme.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega328p/readme.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/Arduino-usbdfu.hex: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/Arduino-usbdfu.hex -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/LUFA.pnproj: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/LUFA.pnproj -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/LUFA/Doxygen.conf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/LUFA/Doxygen.conf -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/LUFA/License.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/LUFA/License.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/LUFA/Version.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/LUFA/Version.h -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/LUFA/makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/LUFA/makefile -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/ppm_encoder.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/ppm_encoder.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/ATMega32U2/readme.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/ATMega32U2/readme.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/Binaries/Hash.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/Binaries/Hash.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/Libraries/PPM_Encoder.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/Libraries/PPM_Encoder.h -------------------------------------------------------------------------------- /Tools/ArduPPM/Libraries/PPM_Encoder_v3.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/Libraries/PPM_Encoder_v3.h -------------------------------------------------------------------------------- /Tools/ArduPPM/Libraries/changelog_v3.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/Libraries/changelog_v3.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/Libraries/manual_v3.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/Libraries/manual_v3.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/Libraries/readme.txt: -------------------------------------------------------------------------------- 1 | 2 | libraries used by all ArduPPM code bases -------------------------------------------------------------------------------- /Tools/ArduPPM/WorkBasket/readme.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/WorkBasket/readme.txt -------------------------------------------------------------------------------- /Tools/ArduPPM/readme.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPPM/readme.txt -------------------------------------------------------------------------------- /Tools/ArduPilotMega_demo/Timers.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduPilotMega_demo/Timers.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/.ArduTracker.pde.swo: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/.ArduTracker.pde.swo -------------------------------------------------------------------------------- /Tools/ArduTracker/APM_Config.h.reference: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/APM_Config.h.reference -------------------------------------------------------------------------------- /Tools/ArduTracker/APM_Config_mavlink_hil.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/APM_Config_mavlink_hil.h -------------------------------------------------------------------------------- /Tools/ArduTracker/APM_Config_xplane.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/APM_Config_xplane.h -------------------------------------------------------------------------------- /Tools/ArduTracker/ArduTracker.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/ArduTracker.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/Attitude.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/Attitude.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/GCS.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/GCS.h -------------------------------------------------------------------------------- /Tools/ArduTracker/GCS_Ardupilot.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/GCS_Ardupilot.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/GCS_DebugTerminal.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/GCS_DebugTerminal.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/GCS_Mavlink.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/GCS_Mavlink.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/GCS_Standard.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/GCS_Standard.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/GCS_Xplane.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/GCS_Xplane.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/HIL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/HIL.h -------------------------------------------------------------------------------- /Tools/ArduTracker/HIL_Mavlink.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/HIL_Mavlink.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/HIL_Xplane.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/HIL_Xplane.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/Log.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/Log.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/Mavlink_Common.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/Mavlink_Common.h -------------------------------------------------------------------------------- /Tools/ArduTracker/Terminal_commands.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/Terminal_commands.txt -------------------------------------------------------------------------------- /Tools/ArduTracker/climb_rate.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/climb_rate.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/command_description.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/command_description.txt -------------------------------------------------------------------------------- /Tools/ArduTracker/commands.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/commands.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/commands_process.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/commands_process.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/config.h -------------------------------------------------------------------------------- /Tools/ArduTracker/control_modes.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/control_modes.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/createTags: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/createTags -------------------------------------------------------------------------------- /Tools/ArduTracker/debug.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/debug.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/defines.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/defines.h -------------------------------------------------------------------------------- /Tools/ArduTracker/events.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/events.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/global_data.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/global_data.h -------------------------------------------------------------------------------- /Tools/ArduTracker/global_data.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/global_data.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/navigation.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/navigation.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/param_init.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/param_init.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/param_table.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/param_table.c -------------------------------------------------------------------------------- /Tools/ArduTracker/param_table.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/param_table.h -------------------------------------------------------------------------------- /Tools/ArduTracker/paramgen.awk: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/paramgen.awk -------------------------------------------------------------------------------- /Tools/ArduTracker/paramgen.in: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/paramgen.in -------------------------------------------------------------------------------- /Tools/ArduTracker/radio.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/radio.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/sensors.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/sensors.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/setup.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/setup.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/system.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/system.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/test.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/test.pde -------------------------------------------------------------------------------- /Tools/ArduTracker/updateParams: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArduTracker/updateParams -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/.gitignore: -------------------------------------------------------------------------------- 1 | 2 | *.pfx 3 | *.suo 4 | *.user -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/3DRRadio/3dr.ico: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/3DRRadio/3dr.ico -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/3DRRadio/Rssi.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/3DRRadio/Rssi.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/APMPlannerXplanes/.gitignore: -------------------------------------------------------------------------------- 1 | 2 | *.sdf -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/APMPlannerXplanes/Debug/APMPlannerXplanes.ilk: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/ArdupilotMega.sln: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/ArdupilotMega.sln -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Camera.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Camera.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Camera.de-DE.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Camera.de-DE.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Camera.fr.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Camera.fr.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Camera.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Camera.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/ChangeLog.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/ChangeLog.txt -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/CodeGen.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/CodeGen.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Common.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Common.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/CommsSerial.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/CommsSerial.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Controls/HSI.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Controls/HSI.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Controls/HSI.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Controls/HSI.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Controls/HUD.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Controls/HUD.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/CurrentState.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/CurrentState.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Delta.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Delta.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Driver/dpinst.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Driver/dpinst.xml -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Driver/px4fmu.cat: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Driver/px4fmu.cat -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Driver/px4fmu.inf: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Driver/px4fmu.inf -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Driver/signed.cer: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Driver/signed.cer -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/FollowMe.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/FollowMe.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/FollowMe.fr.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/FollowMe.fr.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/FollowMe.pl.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/FollowMe.pl.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/FollowMe.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/FollowMe.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/GCSViews/Help.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/GCSViews/Help.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Gentemp.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Gentemp.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/AeroSimRC.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/AeroSimRC.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Aircraft.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Aircraft.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/FlightGear.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/FlightGear.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Hil.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Hil.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/JSBSim.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/JSBSim.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Matrix3.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Matrix3.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Point3d.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Point3d.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/QuadCopter.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/QuadCopter.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Quaternion.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Quaternion.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Utils.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Utils.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Vector3.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Vector3.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Vector3d.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Vector3d.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/Wind.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/Wind.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HIL/XPlane.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HIL/XPlane.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Half.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Half.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/HalfHelper.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/HalfHelper.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/JSBSim.exe: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/JSBSim.exe -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Joystick.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Joystick.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/JoystickSetup.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/JoystickSetup.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/AStar.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/AStar.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/Core.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/Core.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/KMLib.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/KMLib.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/OpenTK.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/OpenTK.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/SharpKml.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/SharpKml.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/ZedGraph.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/ZedGraph.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/log4net.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/log4net.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Lib/netDxf.dll: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Lib/netDxf.dll -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.Designer.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.Designer.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.de-DE.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.de-DE.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.es-ES.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.es-ES.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.fr.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.fr.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.it-IT.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.it-IT.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.pl.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.pl.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.zh-Hans.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.zh-Hans.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Log.zh-TW.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Log.zh-TW.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/LogBrowse.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/LogBrowse.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/LogBrowse.fr.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/LogBrowse.fr.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/LogBrowse.pl.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/LogBrowse.pl.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/LogBrowse.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/LogBrowse.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MAC/Info.plist: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MAC/Info.plist -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MAC/run.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MAC/run.sh -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MAVLink.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MAVLink.xml -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MagCalib.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MagCalib.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MainV2.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MainV2.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MainV2.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MainV2.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MavlinkLog.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MavlinkLog.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/MavlinkLog.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/MavlinkLog.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Msi/.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Msi/.gitignore -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Msi/installer.bat: -------------------------------------------------------------------------------- 1 | @echo off 2 | 3 | wix.exe ..\bin\release\ 4 | 5 | pause 6 | 7 | -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Msi/installer.wxs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Msi/installer.wxs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/NetSerial.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/NetSerial.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/OpenGLtest.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/OpenGLtest.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/OpenGLtest.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/OpenGLtest.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/PIDTunning.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/PIDTunning.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Program.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Program.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Protocol.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Protocol.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/RAW_Sensor.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/RAW_Sensor.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/RAW_Sensor.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/RAW_Sensor.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Radio/3DRradio.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Radio/3DRradio.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Radio/IHex.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Radio/IHex.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Radio/Uploader.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Radio/Uploader.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/ResEdit.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/ResEdit.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/ResEdit.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/ResEdit.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Resources/bg.jpg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Resources/bg.jpg -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Resources/car.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Resources/car.png -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Resources/up.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Resources/up.png -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Resources/x8.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Resources/x8.png -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Resources/y6.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Resources/y6.png -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Script.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Script.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/SerialOutput.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/SerialOutput.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/SerialOutput.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/SerialOutput.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/SerialOutput2.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/SerialOutput2.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Splash.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Splash.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/Splash.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/Splash.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/apm2.ico: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/apm2.ico -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/app.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/app.config -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/block_plane_0.dae: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/block_plane_0.dae -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/build.bat: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/build.bat -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/convert.pl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/convert.pl -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/dataflashlog.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/dataflashlog.xml -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/georefimage.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/georefimage.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/georefimage.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/georefimage.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/hud.html: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/hud.html -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/hudold.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/hudold.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/m3u/both.m3u: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/m3u/both.m3u -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/m3u/hud.m3u: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/m3u/hud.m3u -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/m3u/map.m3u: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/m3u/map.m3u -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/mavcmd.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/mavcmd.xml -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/mavlinklist.pl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/mavlinklist.pl -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/mykey.snk: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/mykey.snk -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/paramcompare.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/paramcompare.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/paramcompare.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/paramcompare.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/quadhil.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/quadhil.xml -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/resedit/Form1.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/resedit/Form1.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/srtm.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/srtm.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/temp.Designer.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/temp.Designer.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/temp.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/temp.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/temp.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/temp.resx -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/wix/Program.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/wix/Program.cs -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/wix/app.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/wix/app.config -------------------------------------------------------------------------------- /Tools/ArdupilotMegaPlanner/wix/wix.csproj: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/ArdupilotMegaPlanner/wix/wix.csproj -------------------------------------------------------------------------------- /Tools/CPUInfo/CPUInfo.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/CPUInfo/CPUInfo.pde -------------------------------------------------------------------------------- /Tools/CPUInfo/Makefile: -------------------------------------------------------------------------------- 1 | # 2 | # Trivial makefile for building APM 3 | # 4 | include ../../mk/apm.mk 5 | -------------------------------------------------------------------------------- /Tools/CPUInfo/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /Tools/CPUInfo/output-px4.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/CPUInfo/output-px4.txt -------------------------------------------------------------------------------- /Tools/CPUInfo/output.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/CPUInfo/output.txt -------------------------------------------------------------------------------- /Tools/Failsafe/Failsafe.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/Failsafe/Failsafe.pde -------------------------------------------------------------------------------- /Tools/Failsafe/Makefile: -------------------------------------------------------------------------------- 1 | # 2 | # Trivial makefile for building APM 3 | # 4 | include ../../mk/apm.mk 5 | 6 | -------------------------------------------------------------------------------- /Tools/FlightGear/FGShim.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/FlightGear/FGShim.c -------------------------------------------------------------------------------- /Tools/FlightGear/MAVLink.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/FlightGear/MAVLink.xml -------------------------------------------------------------------------------- /Tools/FlightGear/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/FlightGear/Makefile -------------------------------------------------------------------------------- /Tools/FlightGear/fgfs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/FlightGear/fgfs -------------------------------------------------------------------------------- /Tools/GIT_Test/GIT_Success.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/GIT_Test/GIT_Success.txt -------------------------------------------------------------------------------- /Tools/Hello/Hello.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/Hello/Hello.pde -------------------------------------------------------------------------------- /Tools/Hello/Makefile: -------------------------------------------------------------------------------- 1 | # 2 | # Trivial makefile for building APM 3 | # 4 | include ../../mk/apm.mk 5 | -------------------------------------------------------------------------------- /Tools/Hello/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /Tools/PPM_decoding/PPM_decoding.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/PPM_decoding/PPM_decoding.pde -------------------------------------------------------------------------------- /Tools/PPM_decoding/Timers.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/PPM_decoding/Timers.pde -------------------------------------------------------------------------------- /Tools/SerialProxy/SerialProxy.sln: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/SerialProxy/SerialProxy.sln -------------------------------------------------------------------------------- /Tools/SerialProxy/SerialProxy.suo: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/SerialProxy/SerialProxy.suo -------------------------------------------------------------------------------- /Tools/SerialProxy/SerialProxy/Form1.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/SerialProxy/SerialProxy/Form1.cs -------------------------------------------------------------------------------- /Tools/SerialProxy/SerialProxy/Form1.resx: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/SerialProxy/SerialProxy/Form1.resx -------------------------------------------------------------------------------- /Tools/SerialProxy/SerialProxy/Program.cs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/SerialProxy/SerialProxy/Program.cs -------------------------------------------------------------------------------- /Tools/SerialProxy/SerialProxy/app.config: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/SerialProxy/SerialProxy/app.config -------------------------------------------------------------------------------- /Tools/VARTest/APM_Config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/VARTest/APM_Config.h -------------------------------------------------------------------------------- /Tools/VARTest/Makefile: -------------------------------------------------------------------------------- 1 | # 2 | # Trivial makefile for building APM 3 | # 4 | include ../../mk/apm.mk 5 | -------------------------------------------------------------------------------- /Tools/VARTest/Parameters.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/VARTest/Parameters.h -------------------------------------------------------------------------------- /Tools/VARTest/Parameters.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/VARTest/Parameters.pde -------------------------------------------------------------------------------- /Tools/VARTest/VARTest.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/VARTest/VARTest.pde -------------------------------------------------------------------------------- /Tools/VARTest/config.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/VARTest/config.h -------------------------------------------------------------------------------- /Tools/VARTest/defines.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/VARTest/defines.h -------------------------------------------------------------------------------- /Tools/VARTest/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /Tools/Xplane/X-Plane.pl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/Xplane/X-Plane.pl -------------------------------------------------------------------------------- /Tools/Xplane/X-Plane_Inet_settings.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/Xplane/X-Plane_Inet_settings.png -------------------------------------------------------------------------------- /Tools/Xplane/serproxy-0.1.3-3/serproxy: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/Xplane/serproxy-0.1.3-3/serproxy -------------------------------------------------------------------------------- /Tools/autotest/ArduCopter.parm: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/ArduCopter.parm -------------------------------------------------------------------------------- /Tools/autotest/ArduPlane.parm: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/ArduPlane.parm -------------------------------------------------------------------------------- /Tools/autotest/CMAC-circuit.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/CMAC-circuit.txt -------------------------------------------------------------------------------- /Tools/autotest/README: -------------------------------------------------------------------------------- 1 | This is an automated test suite for APM 2 | -------------------------------------------------------------------------------- /Tools/autotest/Rover.parm: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/Rover.parm -------------------------------------------------------------------------------- /Tools/autotest/aircraft/Rascal/Rascal.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/aircraft/Rascal/Rascal.xml -------------------------------------------------------------------------------- /Tools/autotest/aircraft/arducopter/README: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/aircraft/arducopter/README -------------------------------------------------------------------------------- /Tools/autotest/ap1.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/ap1.txt -------------------------------------------------------------------------------- /Tools/autotest/apmrover2.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/apmrover2.py -------------------------------------------------------------------------------- /Tools/autotest/arducopter.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/arducopter.py -------------------------------------------------------------------------------- /Tools/autotest/arduplane.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/arduplane.py -------------------------------------------------------------------------------- /Tools/autotest/autotest.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/autotest.py -------------------------------------------------------------------------------- /Tools/autotest/autotest_jenkins.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/autotest_jenkins.py -------------------------------------------------------------------------------- /Tools/autotest/common.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/common.py -------------------------------------------------------------------------------- /Tools/autotest/fakepos.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/fakepos.py -------------------------------------------------------------------------------- /Tools/autotest/fg_plane_view.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/fg_plane_view.sh -------------------------------------------------------------------------------- /Tools/autotest/fg_quad_view.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/fg_quad_view.sh -------------------------------------------------------------------------------- /Tools/autotest/jsbsim/fgout.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/jsbsim/fgout.xml -------------------------------------------------------------------------------- /Tools/autotest/jsbsim/rascal_test.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/jsbsim/rascal_test.xml -------------------------------------------------------------------------------- /Tools/autotest/jsbsim/runsim.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/jsbsim/runsim.py -------------------------------------------------------------------------------- /Tools/autotest/junit.xml: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/junit.xml -------------------------------------------------------------------------------- /Tools/autotest/mission1.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/mission1.txt -------------------------------------------------------------------------------- /Tools/autotest/mission2.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/mission2.txt -------------------------------------------------------------------------------- /Tools/autotest/mission3.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/mission3.txt -------------------------------------------------------------------------------- /Tools/autotest/mission_ttt.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/mission_ttt.txt -------------------------------------------------------------------------------- /Tools/autotest/param_metadata/param.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/param_metadata/param.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/aircraft.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/aircraft.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/fdpexpect.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/fdpexpect.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/fg_display.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/fg_display.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/multicopter.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/multicopter.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/rotmat.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/rotmat.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/rover.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/rover.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/sim_multicopter.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/sim_multicopter.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/sim_rover.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/sim_rover.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/testwind.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/testwind.py -------------------------------------------------------------------------------- /Tools/autotest/pysim/util.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/pysim/util.py -------------------------------------------------------------------------------- /Tools/autotest/rover1.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/rover1.txt -------------------------------------------------------------------------------- /Tools/autotest/sim_arducopter.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/sim_arducopter.sh -------------------------------------------------------------------------------- /Tools/autotest/sim_arducopter10.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/sim_arducopter10.sh -------------------------------------------------------------------------------- /Tools/autotest/sim_arduplane.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/sim_arduplane.sh -------------------------------------------------------------------------------- /Tools/autotest/sim_arduplane10.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/sim_arduplane10.sh -------------------------------------------------------------------------------- /Tools/autotest/sim_arduplane_kingaroy.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/sim_arduplane_kingaroy.sh -------------------------------------------------------------------------------- /Tools/autotest/sim_rover.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/sim_rover.sh -------------------------------------------------------------------------------- /Tools/autotest/web/css/images/bg.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/web/css/images/bg.png -------------------------------------------------------------------------------- /Tools/autotest/web/css/images/logo.png: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/web/css/images/logo.png -------------------------------------------------------------------------------- /Tools/autotest/web/css/main.css: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/web/css/main.css -------------------------------------------------------------------------------- /Tools/autotest/web/index.html: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/autotest/web/index.html -------------------------------------------------------------------------------- /Tools/run_sim_mission.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/run_sim_mission.py -------------------------------------------------------------------------------- /Tools/scripts/arduino_version.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/scripts/arduino_version.sh -------------------------------------------------------------------------------- /Tools/scripts/build_all.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/scripts/build_all.sh -------------------------------------------------------------------------------- /Tools/scripts/build_examples.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/scripts/build_examples.sh -------------------------------------------------------------------------------- /Tools/scripts/format.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/scripts/format.sh -------------------------------------------------------------------------------- /Tools/scripts/frame_sizes.py: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/Tools/scripts/frame_sizes.py -------------------------------------------------------------------------------- /archive/ArducopterNG/ArduUser.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/ArduUser.h -------------------------------------------------------------------------------- /archive/ArducopterNG/Arducopter.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Arducopter.h -------------------------------------------------------------------------------- /archive/ArducopterNG/ArducopterNG.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/ArducopterNG.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Attitude.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Attitude.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/CLI.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/CLI.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/DCM.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/DCM.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Debug.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Debug.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/EEPROM.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/EEPROM.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Events.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Events.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Functions.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Functions.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/GCS.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/GCS.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Heli.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Heli.h -------------------------------------------------------------------------------- /archive/ArducopterNG/Heli.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Heli.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Log.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Log.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Mixer.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Mixer.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Motors.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Motors.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Navigation.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Navigation.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/README: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/README -------------------------------------------------------------------------------- /archive/ArducopterNG/Radio.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Radio.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/Sensors.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/Sensors.pde -------------------------------------------------------------------------------- /archive/ArducopterNG/System.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/ArducopterNG/System.pde -------------------------------------------------------------------------------- /archive/Configurator/Source/Icon/IM.icns: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/Configurator/Source/Icon/IM.icns -------------------------------------------------------------------------------- /archive/PPMEncoder/ap_ppm_encoder.aps: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/PPMEncoder/ap_ppm_encoder.aps -------------------------------------------------------------------------------- /archive/PPMEncoder/ap_ppm_encoder.aws: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/PPMEncoder/ap_ppm_encoder.aws -------------------------------------------------------------------------------- /archive/PPMEncoder/ap_ppm_encoder.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/PPMEncoder/ap_ppm_encoder.c -------------------------------------------------------------------------------- /archive/PPMEncoder/default/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/PPMEncoder/default/Makefile -------------------------------------------------------------------------------- /archive/PPMEncoder/servo2ppm_settings.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/PPMEncoder/servo2ppm_settings.h -------------------------------------------------------------------------------- /archive/WaypointWriterMega/EEPROM.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/WaypointWriterMega/EEPROM.pde -------------------------------------------------------------------------------- /archive/WaypointWriterMega/defines.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/WaypointWriterMega/defines.h -------------------------------------------------------------------------------- /archive/WaypointWriterMega/sparkfun.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/WaypointWriterMega/sparkfun.h -------------------------------------------------------------------------------- /archive/WaypointWriterMega/takeoff.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/archive/WaypointWriterMega/takeoff.h -------------------------------------------------------------------------------- /cmake/ArduinoToolchain.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/cmake/ArduinoToolchain.cmake -------------------------------------------------------------------------------- /cmake/Platform/Arduino.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/cmake/Platform/Arduino.cmake -------------------------------------------------------------------------------- /cmake/modules/APMCPackConfig.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/cmake/modules/APMCPackConfig.cmake -------------------------------------------------------------------------------- /cmake/modules/APMOption.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/cmake/modules/APMOption.cmake -------------------------------------------------------------------------------- /cmake/modules/UseDoxygen.cmake: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/cmake/modules/UseDoxygen.cmake -------------------------------------------------------------------------------- /cmake/updated-arduino-cmake.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/cmake/updated-arduino-cmake.sh -------------------------------------------------------------------------------- /libraries/AC_PID/AC_PID.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AC_PID/AC_PID.cpp -------------------------------------------------------------------------------- /libraries/AC_PID/AC_PID.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AC_PID/AC_PID.h -------------------------------------------------------------------------------- /libraries/AC_PID/examples/AC_PID_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AC_PID/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AC_PID/keywords.txt -------------------------------------------------------------------------------- /libraries/APM_Control/APM_Control.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_Control/APM_Control.h -------------------------------------------------------------------------------- /libraries/APM_Control/AP_RollController.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_Control/AP_RollController.h -------------------------------------------------------------------------------- /libraries/APM_Control/AP_YawController.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_Control/AP_YawController.h -------------------------------------------------------------------------------- /libraries/APM_OBC/APM_OBC.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_OBC/APM_OBC.cpp -------------------------------------------------------------------------------- /libraries/APM_OBC/APM_OBC.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_OBC/APM_OBC.h -------------------------------------------------------------------------------- /libraries/APM_OBC/Failsafe_Board/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_OBC/Failsafe_Board/Makefile -------------------------------------------------------------------------------- /libraries/APM_OBC/Failsafe_Board/nobuild.txt: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/APM_OBC/examples/trivial_APM_OBC/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/APM_PI/APM_PI.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_PI/APM_PI.cpp -------------------------------------------------------------------------------- /libraries/APM_PI/APM_PI.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/APM_PI/APM_PI.h -------------------------------------------------------------------------------- /libraries/AP_ADC/AP_ADC.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_ADC/AP_ADC.cpp -------------------------------------------------------------------------------- /libraries/AP_ADC/AP_ADC.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_ADC/AP_ADC.h -------------------------------------------------------------------------------- /libraries/AP_ADC/AP_ADC_ADS7844.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_ADC/AP_ADC_ADS7844.cpp -------------------------------------------------------------------------------- /libraries/AP_ADC/AP_ADC_ADS7844.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_ADC/AP_ADC_ADS7844.h -------------------------------------------------------------------------------- /libraries/AP_ADC/AP_ADC_HIL.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_ADC/AP_ADC_HIL.cpp -------------------------------------------------------------------------------- /libraries/AP_ADC/AP_ADC_HIL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_ADC/AP_ADC_HIL.h -------------------------------------------------------------------------------- /libraries/AP_ADC/examples/AP_ADC_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_ADC/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_ADC/keywords.txt -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS.cpp -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS.h -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS_DCM.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS_DCM.cpp -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS_DCM.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS_DCM.h -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS_HIL.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS_HIL.cpp -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS_HIL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS_HIL.h -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS_MPU6000.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS_MPU6000.cpp -------------------------------------------------------------------------------- /libraries/AP_AHRS/AP_AHRS_MPU6000.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_AHRS/AP_AHRS_MPU6000.h -------------------------------------------------------------------------------- /libraries/AP_AHRS/examples/AHRS_Test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_AHRS/examples/AHRS_Test/norelax.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Airspeed/AP_Airspeed.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Airspeed/AP_Airspeed.cpp -------------------------------------------------------------------------------- /libraries/AP_Airspeed/AP_Airspeed.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Airspeed/AP_Airspeed.h -------------------------------------------------------------------------------- /libraries/AP_Airspeed/examples/Airspeed/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro.cpp -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro.h -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_BMP085.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_BMP085.cpp -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_BMP085.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_BMP085.h -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_BMP085_hil.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_BMP085_hil.cpp -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_BMP085_hil.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_BMP085_hil.h -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_MS5611.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_MS5611.cpp -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_MS5611.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_MS5611.h -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_PX4.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_PX4.cpp -------------------------------------------------------------------------------- /libraries/AP_Baro/AP_Baro_PX4.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Baro/AP_Baro_PX4.h -------------------------------------------------------------------------------- /libraries/AP_Baro/examples/AP_Baro_BMP085_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Baro/examples/AP_Baro_MS5611_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Buffer/AP_Buffer.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Buffer/AP_Buffer.h -------------------------------------------------------------------------------- /libraries/AP_Camera/AP_Camera.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Camera/AP_Camera.cpp -------------------------------------------------------------------------------- /libraries/AP_Camera/AP_Camera.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Camera/AP_Camera.h -------------------------------------------------------------------------------- /libraries/AP_Common/AP_Common.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Common/AP_Common.h -------------------------------------------------------------------------------- /libraries/AP_Common/AP_Test.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Common/AP_Test.h -------------------------------------------------------------------------------- /libraries/AP_Common/Arduino.h: -------------------------------------------------------------------------------- 1 | // empty include to keep Arduino build system happy 2 | -------------------------------------------------------------------------------- /libraries/AP_Common/c++.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Common/c++.cpp -------------------------------------------------------------------------------- /libraries/AP_Common/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Common/keywords.txt -------------------------------------------------------------------------------- /libraries/AP_Compass/AP_Compass.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/AP_Compass.h -------------------------------------------------------------------------------- /libraries/AP_Compass/AP_Compass_HIL.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/AP_Compass_HIL.cpp -------------------------------------------------------------------------------- /libraries/AP_Compass/AP_Compass_HIL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/AP_Compass_HIL.h -------------------------------------------------------------------------------- /libraries/AP_Compass/AP_Compass_HMC5843.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/AP_Compass_HMC5843.h -------------------------------------------------------------------------------- /libraries/AP_Compass/AP_Compass_PX4.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/AP_Compass_PX4.cpp -------------------------------------------------------------------------------- /libraries/AP_Compass/AP_Compass_PX4.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/AP_Compass_PX4.h -------------------------------------------------------------------------------- /libraries/AP_Compass/Compass.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/Compass.cpp -------------------------------------------------------------------------------- /libraries/AP_Compass/Compass.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/Compass.h -------------------------------------------------------------------------------- /libraries/AP_Compass/examples/AP_Compass_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Compass/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Compass/keywords.txt -------------------------------------------------------------------------------- /libraries/AP_Curve/AP_Curve.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Curve/AP_Curve.cpp -------------------------------------------------------------------------------- /libraries/AP_Curve/AP_Curve.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Curve/AP_Curve.h -------------------------------------------------------------------------------- /libraries/AP_Declination/AP_Declination.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Declination/AP_Declination.h -------------------------------------------------------------------------------- /libraries/AP_Declination/examples/AP_Declination_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_406.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_406.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_406.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_406.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_Auto.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_Auto.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_Auto.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_Auto.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_HIL.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_HIL.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_HIL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_HIL.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_MTK.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_MTK.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_MTK.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_MTK.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_MTK16.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_MTK16.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_MTK16.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_MTK16.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_MTK19.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_MTK19.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_MTK19.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_MTK19.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_MTK_Common.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_MTK_Common.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_NMEA.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_NMEA.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_NMEA.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_NMEA.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_None.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_None.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_SIRF.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_SIRF.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_SIRF.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_SIRF.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_Shim.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_Shim.h -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_UBLOX.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_UBLOX.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/AP_GPS_UBLOX.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/AP_GPS_UBLOX.h -------------------------------------------------------------------------------- /libraries/AP_GPS/GPS.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/GPS.cpp -------------------------------------------------------------------------------- /libraries/AP_GPS/GPS.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/GPS.h -------------------------------------------------------------------------------- /libraries/AP_GPS/config/3DR-Ublox.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_GPS/config/3DR-Ublox.txt -------------------------------------------------------------------------------- /libraries/AP_GPS/examples/GPS_406_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_GPS/examples/GPS_AUTO_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_GPS/examples/GPS_MTK_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_GPS/examples/GPS_NMEA_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_GPS/examples/GPS_UBLOX_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL/AP_HAL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/AP_HAL.h -------------------------------------------------------------------------------- /libraries/AP_HAL/AP_HAL_Boards.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/AP_HAL_Boards.h -------------------------------------------------------------------------------- /libraries/AP_HAL/AP_HAL_Namespace.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/AP_HAL_Namespace.h -------------------------------------------------------------------------------- /libraries/AP_HAL/AnalogIn.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/AnalogIn.h -------------------------------------------------------------------------------- /libraries/AP_HAL/Console.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/Console.h -------------------------------------------------------------------------------- /libraries/AP_HAL/GPIO.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/GPIO.h -------------------------------------------------------------------------------- /libraries/AP_HAL/HAL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/HAL.h -------------------------------------------------------------------------------- /libraries/AP_HAL/I2CDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/I2CDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL/RCInput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/RCInput.h -------------------------------------------------------------------------------- /libraries/AP_HAL/RCOutput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/RCOutput.h -------------------------------------------------------------------------------- /libraries/AP_HAL/SPIDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/SPIDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL/Scheduler.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/Scheduler.h -------------------------------------------------------------------------------- /libraries/AP_HAL/Semaphores.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/Semaphores.h -------------------------------------------------------------------------------- /libraries/AP_HAL/Storage.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/Storage.h -------------------------------------------------------------------------------- /libraries/AP_HAL/UARTDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/UARTDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL/Util.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/Util.h -------------------------------------------------------------------------------- /libraries/AP_HAL/utility/BetterStream.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/utility/BetterStream.h -------------------------------------------------------------------------------- /libraries/AP_HAL/utility/Print.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/utility/Print.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL/utility/Print.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/utility/Print.h -------------------------------------------------------------------------------- /libraries/AP_HAL/utility/Stream.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL/utility/Stream.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/AP_HAL_AVR.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/AP_HAL_AVR.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/AP_HAL_AVR_Main.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/AP_HAL_AVR_Main.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/AP_HAL_AVR_private.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/AP_HAL_AVR_private.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/AnalogIn.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/AnalogIn.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/AnalogIn_ADC.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/AnalogIn_ADC.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/AnalogIn_Common.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/AnalogIn_Common.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Console.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Console.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Console.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Console.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/GPIO.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/GPIO.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/GPIO.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/GPIO.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/HAL_AVR_APM1_Class.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/HAL_AVR_APM1_Class.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/HAL_AVR_APM2_Class.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/HAL_AVR_APM2_Class.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/I2CDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/I2CDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/I2CDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/I2CDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/RCInput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/RCInput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/RCInput_APM1.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/RCInput_APM1.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/RCInput_APM2.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/RCInput_APM2.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/RCOutput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/RCOutput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/RCOutput_APM1.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/RCOutput_APM1.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/RCOutput_APM2.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/RCOutput_APM2.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/SPIDevice_SPI0.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/SPIDevice_SPI0.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/SPIDevice_SPI2.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/SPIDevice_SPI2.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/SPIDevice_SPI3.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/SPIDevice_SPI3.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/SPIDevices.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/SPIDevices.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/SPIDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/SPIDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Scheduler.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Scheduler.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Scheduler.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Scheduler.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Scheduler_Timer.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Scheduler_Timer.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Semaphores.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Semaphores.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Semaphores.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Semaphores.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Storage.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Storage.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Storage.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Storage.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/UARTDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/UARTDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/UARTDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/UARTDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Util.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Util.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/Util.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/Util.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/build_all.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/build_all.sh -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/AnalogIn/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/ArduCopterLibs/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/ArduPlaneLibs/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/Blink/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/Console/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/I2CDriver_HMC5883L/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/LCDTest/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/RCInputTest/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/RCPassthroughTest/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/SPIDriver_MPU6000/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/Scheduler/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/Semaphore/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/Storage/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/UARTDriver/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/examples/UtilityStringTest/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/utility/macros.inc: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/utility/macros.inc -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/utility/ntz.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/utility/ntz.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR/utility/xtoa_fast.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR/utility/xtoa_fast.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/AnalogIn.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/AnalogIn.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/AnalogIn.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/AnalogIn.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Console.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Console.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Console.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Console.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/RCInput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/RCInput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/RCInput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/RCInput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/RCOutput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/RCOutput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/RCOutput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/RCOutput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/SITL_State.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/SITL_State.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/SITL_State.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/SITL_State.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Scheduler.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Scheduler.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Scheduler.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Scheduler.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Storage.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Storage.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Storage.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Storage.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/UARTDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/UARTDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/UARTDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/UARTDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Util.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Util.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/Util.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/Util.h -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/sitl_gps.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/sitl_gps.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_AVR_SITL/sitl_ins.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_AVR_SITL/sitl_ins.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/AP_HAL_Empty.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/AP_HAL_Empty.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/AnalogIn.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/AnalogIn.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/AnalogIn.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/AnalogIn.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Console.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Console.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Console.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Console.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/GPIO.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/GPIO.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/GPIO.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/GPIO.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/HAL_Empty_Class.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/HAL_Empty_Class.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/I2CDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/I2CDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/I2CDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/I2CDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/PrivateMember.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/PrivateMember.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/PrivateMember.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/PrivateMember.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/RCInput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/RCInput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/RCInput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/RCInput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/RCOutput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/RCOutput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/RCOutput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/RCOutput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/SPIDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/SPIDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/SPIDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/SPIDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Scheduler.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Scheduler.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Scheduler.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Scheduler.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Semaphores.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Semaphores.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Semaphores.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Semaphores.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Storage.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Storage.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Storage.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Storage.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/UARTDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/UARTDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/UARTDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/UARTDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Util.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Util.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/Util.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_Empty/Util.h -------------------------------------------------------------------------------- /libraries/AP_HAL_Empty/examples/empty_example/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/AP_HAL_PX4.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/AP_HAL_PX4.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/AP_HAL_PX4_Main.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/AP_HAL_PX4_Main.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/Console.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/Console.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/Console.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/Console.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/HAL_PX4_Class.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/HAL_PX4_Class.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/HAL_PX4_Class.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/HAL_PX4_Class.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/RCInput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/RCInput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/RCInput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/RCInput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/RCOutput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/RCOutput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/RCOutput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/RCOutput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/Scheduler.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/Scheduler.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/Scheduler.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/Scheduler.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/Storage.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/Storage.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/Storage.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/Storage.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/UARTDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/UARTDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/UARTDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_PX4/UARTDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_PX4/examples/simple/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/AP_HAL_SMACCM.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/AP_HAL_SMACCM.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/AnalogIn.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/AnalogIn.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/AnalogIn.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/AnalogIn.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Console.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Console.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Console.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Console.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/GPIO.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/GPIO.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/GPIO.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/GPIO.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/I2CDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/I2CDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/I2CDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/I2CDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/PrivateMember.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/PrivateMember.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/PrivateMember.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/PrivateMember.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/RCInput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/RCInput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/RCInput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/RCInput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/RCOutput.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/RCOutput.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/RCOutput.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/RCOutput.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/SPIDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/SPIDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/SPIDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/SPIDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Scheduler.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Scheduler.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Scheduler.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Scheduler.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Semaphores.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Semaphores.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Semaphores.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Semaphores.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Storage.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Storage.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Storage.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Storage.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/UARTDriver.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/UARTDriver.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/UARTDriver.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/UARTDriver.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Util.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Util.cpp -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/Util.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_HAL_SMACCM/Util.h -------------------------------------------------------------------------------- /libraries/AP_HAL_SMACCM/examples/empty_example/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_InertialNav/AP_InertialNav.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_InertialNav/AP_InertialNav.h -------------------------------------------------------------------------------- /libraries/AP_InertialNav/examples/AP_InertialNav_test/nocore.infoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_InertialNav/examples/AP_InertialNav_test/norelax.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_InertialSensor/examples/MPU6000/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_InertialSensor/examples/MPU6000/norelax.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_LeadFilter/AP_LeadFilter.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_LeadFilter/AP_LeadFilter.cpp -------------------------------------------------------------------------------- /libraries/AP_LeadFilter/AP_LeadFilter.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_LeadFilter/AP_LeadFilter.h -------------------------------------------------------------------------------- /libraries/AP_LeadFilter/examples/AP_LeadFilter/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_Altitude.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_Altitude.cpp -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_Altitude.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_Altitude.h -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_GPSLock.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_GPSLock.cpp -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_GPSLock.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_GPSLock.h -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_Geofence.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_Geofence.cpp -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_Geofence.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_Geofence.h -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_Module.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_Module.cpp -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limit_Module.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limit_Module.h -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limits.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limits.cpp -------------------------------------------------------------------------------- /libraries/AP_Limits/AP_Limits.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Limits/AP_Limits.h -------------------------------------------------------------------------------- /libraries/AP_Math/AP_Math.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/AP_Math.cpp -------------------------------------------------------------------------------- /libraries/AP_Math/AP_Math.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/AP_Math.h -------------------------------------------------------------------------------- /libraries/AP_Math/examples/eulers/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Math/examples/location/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Math/examples/polygon/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Math/examples/rotations/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Math/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/keywords.txt -------------------------------------------------------------------------------- /libraries/AP_Math/location.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/location.cpp -------------------------------------------------------------------------------- /libraries/AP_Math/matrix3.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/matrix3.cpp -------------------------------------------------------------------------------- /libraries/AP_Math/matrix3.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/matrix3.h -------------------------------------------------------------------------------- /libraries/AP_Math/polygon.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/polygon.cpp -------------------------------------------------------------------------------- /libraries/AP_Math/polygon.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/polygon.h -------------------------------------------------------------------------------- /libraries/AP_Math/quaternion.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/quaternion.cpp -------------------------------------------------------------------------------- /libraries/AP_Math/quaternion.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/quaternion.h -------------------------------------------------------------------------------- /libraries/AP_Math/rotations.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/rotations.h -------------------------------------------------------------------------------- /libraries/AP_Math/vector2.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/vector2.cpp -------------------------------------------------------------------------------- /libraries/AP_Math/vector2.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/vector2.h -------------------------------------------------------------------------------- /libraries/AP_Math/vector3.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/vector3.cpp -------------------------------------------------------------------------------- /libraries/AP_Math/vector3.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Math/vector3.h -------------------------------------------------------------------------------- /libraries/AP_Menu/AP_Menu.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Menu/AP_Menu.cpp -------------------------------------------------------------------------------- /libraries/AP_Menu/AP_Menu.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Menu/AP_Menu.h -------------------------------------------------------------------------------- /libraries/AP_Menu/examples/menu/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Menu/examples/menu/Makefile -------------------------------------------------------------------------------- /libraries/AP_Menu/examples/menu/menu.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Menu/examples/menu/menu.pde -------------------------------------------------------------------------------- /libraries/AP_Menu/examples/menu/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_Motors.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_Motors.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsHeli.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsHeli.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsHeli.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsHeli.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsHexa.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsHexa.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsHexa.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsHexa.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsMatrix.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsMatrix.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsMatrix.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsMatrix.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsOcta.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsOcta.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsOcta.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsOcta.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsOctaQuad.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsOctaQuad.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsOctaQuad.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsOctaQuad.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsQuad.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsQuad.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsQuad.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsQuad.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsTri.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsTri.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsTri.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsTri.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsY6.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsY6.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_MotorsY6.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_MotorsY6.h -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_Motors_Class.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_Motors_Class.cpp -------------------------------------------------------------------------------- /libraries/AP_Motors/AP_Motors_Class.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Motors/AP_Motors_Class.h -------------------------------------------------------------------------------- /libraries/AP_Motors/examples/AP_Motors_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_Mount/AP_Mount.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Mount/AP_Mount.cpp -------------------------------------------------------------------------------- /libraries/AP_Mount/AP_Mount.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Mount/AP_Mount.h -------------------------------------------------------------------------------- /libraries/AP_Mount/examples/trivial_AP_Mount/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_OpticalFlow/AP_OpticalFlow.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_OpticalFlow/AP_OpticalFlow.h -------------------------------------------------------------------------------- /libraries/AP_OpticalFlow/examples/AP_OpticalFlow_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_OpticalFlow/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_OpticalFlow/keywords.txt -------------------------------------------------------------------------------- /libraries/AP_Param/AP_Param.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Param/AP_Param.cpp -------------------------------------------------------------------------------- /libraries/AP_Param/AP_Param.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Param/AP_Param.h -------------------------------------------------------------------------------- /libraries/AP_Param/tools/eedump.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Param/tools/eedump.c -------------------------------------------------------------------------------- /libraries/AP_Param/tools/eedump.pl: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Param/tools/eedump.pl -------------------------------------------------------------------------------- /libraries/AP_Param/tools/eedump_apparam.c: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Param/tools/eedump_apparam.c -------------------------------------------------------------------------------- /libraries/AP_PerfMon/AP_PerfMon.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_PerfMon/AP_PerfMon.cpp -------------------------------------------------------------------------------- /libraries/AP_PerfMon/AP_PerfMon.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_PerfMon/AP_PerfMon.h -------------------------------------------------------------------------------- /libraries/AP_Progmem/AP_Progmem.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Progmem/AP_Progmem.h -------------------------------------------------------------------------------- /libraries/AP_Progmem/AP_Progmem_AVR.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Progmem/AP_Progmem_AVR.cpp -------------------------------------------------------------------------------- /libraries/AP_Progmem/AP_Progmem_AVR.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Progmem/AP_Progmem_AVR.h -------------------------------------------------------------------------------- /libraries/AP_RangeFinder/AP_RangeFinder.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_RangeFinder/AP_RangeFinder.h -------------------------------------------------------------------------------- /libraries/AP_RangeFinder/RangeFinder.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_RangeFinder/RangeFinder.cpp -------------------------------------------------------------------------------- /libraries/AP_RangeFinder/RangeFinder.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_RangeFinder/RangeFinder.h -------------------------------------------------------------------------------- /libraries/AP_RangeFinder/examples/MaxsonarXL_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/AP_RangeFinder/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_RangeFinder/keywords.txt -------------------------------------------------------------------------------- /libraries/AP_Relay/AP_Relay.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Relay/AP_Relay.cpp -------------------------------------------------------------------------------- /libraries/AP_Relay/AP_Relay.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/AP_Relay/AP_Relay.h -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash.cpp -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash.h -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_APM1.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_APM1.cpp -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_APM1.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_APM1.h -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_APM2.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_APM2.cpp -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_APM2.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_APM2.h -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_Empty.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_Empty.cpp -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_Empty.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_Empty.h -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_SITL.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_SITL.cpp -------------------------------------------------------------------------------- /libraries/DataFlash/DataFlash_SITL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/DataFlash_SITL.h -------------------------------------------------------------------------------- /libraries/DataFlash/examples/DataFlash_test/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/DataFlash/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/DataFlash/keywords.txt -------------------------------------------------------------------------------- /libraries/Filter/AverageFilter.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/AverageFilter.h -------------------------------------------------------------------------------- /libraries/Filter/DerivativeFilter.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/DerivativeFilter.cpp -------------------------------------------------------------------------------- /libraries/Filter/DerivativeFilter.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/DerivativeFilter.h -------------------------------------------------------------------------------- /libraries/Filter/Filter.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/Filter.h -------------------------------------------------------------------------------- /libraries/Filter/FilterClass.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/FilterClass.h -------------------------------------------------------------------------------- /libraries/Filter/FilterWithBuffer.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/FilterWithBuffer.h -------------------------------------------------------------------------------- /libraries/Filter/LowPassFilter.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/LowPassFilter.h -------------------------------------------------------------------------------- /libraries/Filter/ModeFilter.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/ModeFilter.h -------------------------------------------------------------------------------- /libraries/Filter/examples/Derivative/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/Filter/examples/Filter/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/examples/Filter/Makefile -------------------------------------------------------------------------------- /libraries/Filter/examples/Filter/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/Filter/examples/LowPassFilter/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/Filter/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/Filter/keywords.txt -------------------------------------------------------------------------------- /libraries/GCS_Console/GCS_Console.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/GCS_Console/GCS_Console.cpp -------------------------------------------------------------------------------- /libraries/GCS_Console/GCS_Console.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/GCS_Console/GCS_Console.h -------------------------------------------------------------------------------- /libraries/GCS_Console/examples/Console/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/GCS_MAVLink/.gitignore: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/GCS_MAVLink/.gitignore -------------------------------------------------------------------------------- /libraries/GCS_MAVLink/GCS_MAVLink.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/GCS_MAVLink/GCS_MAVLink.cpp -------------------------------------------------------------------------------- /libraries/GCS_MAVLink/GCS_MAVLink.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/GCS_MAVLink/GCS_MAVLink.h -------------------------------------------------------------------------------- /libraries/GCS_MAVLink/generate.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/GCS_MAVLink/generate.sh -------------------------------------------------------------------------------- /libraries/PID/PID.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/PID/PID.cpp -------------------------------------------------------------------------------- /libraries/PID/PID.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/PID/PID.h -------------------------------------------------------------------------------- /libraries/PID/examples/pid/Makefile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/PID/examples/pid/Makefile -------------------------------------------------------------------------------- /libraries/PID/examples/pid/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/PID/examples/pid/pid.pde: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/PID/examples/pid/pid.pde -------------------------------------------------------------------------------- /libraries/PID/keywords.txt: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/PID/keywords.txt -------------------------------------------------------------------------------- /libraries/RC_Channel/RC_Channel.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/RC_Channel/RC_Channel.cpp -------------------------------------------------------------------------------- /libraries/RC_Channel/RC_Channel.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/RC_Channel/RC_Channel.h -------------------------------------------------------------------------------- /libraries/RC_Channel/RC_Channel_aux.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/RC_Channel/RC_Channel_aux.cpp -------------------------------------------------------------------------------- /libraries/RC_Channel/RC_Channel_aux.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/RC_Channel/RC_Channel_aux.h -------------------------------------------------------------------------------- /libraries/RC_Channel/examples/RC_Channel/nocore.inoflag: -------------------------------------------------------------------------------- 1 | -------------------------------------------------------------------------------- /libraries/SITL/SITL.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/SITL/SITL.cpp -------------------------------------------------------------------------------- /libraries/SITL/SITL.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/SITL/SITL.h -------------------------------------------------------------------------------- /libraries/doc/Doxyfile: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/doc/Doxyfile -------------------------------------------------------------------------------- /libraries/doc/updateDocs: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/doc/updateDocs -------------------------------------------------------------------------------- /libraries/memcheck/memcheck.cpp: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/memcheck/memcheck.cpp -------------------------------------------------------------------------------- /libraries/memcheck/memcheck.h: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/libraries/memcheck/memcheck.h -------------------------------------------------------------------------------- /mk/Arduino.mk: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/mk/Arduino.mk -------------------------------------------------------------------------------- /mk/apm.mk: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/mk/apm.mk -------------------------------------------------------------------------------- /mk/px4_core.mk: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/mk/px4_core.mk -------------------------------------------------------------------------------- /mk/px4_targets.mk: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/mk/px4_targets.mk -------------------------------------------------------------------------------- /mk/targets.mk: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/mk/targets.mk -------------------------------------------------------------------------------- /reformat.sh: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/reformat.sh -------------------------------------------------------------------------------- /uncrustify_cpp.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/uncrustify_cpp.cfg -------------------------------------------------------------------------------- /uncrustify_headers.cfg: -------------------------------------------------------------------------------- https://raw.githubusercontent.com/GaloisInc/ardupilot-mega/HEAD/uncrustify_headers.cfg --------------------------------------------------------------------------------