|
Paparazzi UAS v7.0_unstable
Paparazzi is a free software Unmanned Aircraft System.
|
| ▼ doc | |
| ▼ manual | |
| generated | |
| ▼ sw | |
| ▼ airborne | |
| ► arch | |
| ► chibios | |
| ► mcu_periph | |
| adc_arch.c | ADC driver |
| adc_arch.h | ADC driver |
| can_arch.c | |
| can_arch.h | |
| gpio_arch.c | Gpio functions implemented for ChibiOS arch |
| gpio_arch.h | Gpio functions implemented for ChibiOS arch |
| gpio_def.h | ChibiOS doesn't define pin numbers with format GPIOX let's do it here |
| hal_stm32_dma.c | STM32 DMA subsystem driver header |
| hal_stm32_dma.h | STM32 DMA subsystem driver header |
| i2c_arch.c | Interface from Paparazzi I2C to ChibiOS I2C driver |
| i2c_arch.h | Interface from Paparazzi I2C to ChibiOS I2C driver |
| input_capture_arch.c | |
| input_capture_arch.h | |
| pwm_input_arch.c | Handling of stm32 PWM input using a timer with capture |
| pwm_input_arch.h | Handling of smt32 PWM input using a timer with capture |
| ram_arch.h | Specific RAM section for DMA usage on F7 |
| rng_arch.c | Arch specific Random Number Generator API |
| sdio_arch.c | SDIO interface using ChibiOS API for Paparazzi |
| spi_arch.c | Implementation of SPI interface for ChibiOS arch |
| spi_arch.h | Implementation of SPI interface for ChibiOS arch |
| sys_time_arch.c | Implementation of system time functions for ChibiOS arch |
| sys_time_arch.h | Implementation of system time functions for ChibiOS arch |
| timerDmaCache.c | |
| timerDmaCache.h | |
| uart_arch.c | UART/Serial driver implementation for ChibiOS arch |
| uart_arch.h | UART/Serial driver implementation for ChibiOS arch |
| ► modules | |
| ► actuators | |
| actuators_dshot_arch.c | |
| actuators_pwm_arch.c | Interface from actuators to ChibiOS PWM driver |
| actuators_pwm_arch.h | Interface from actuators to ChibiOS PWM driver |
| actuators_t4_arch.c | Actuator interface for T4 driver |
| actuators_t4_arch.h | Actuator interface for T4 driver |
| dshot_erps.c | |
| dshot_erps.h | |
| dshot_rpmCapture.c | |
| dshot_rpmCapture.h | |
| esc_dshot.c | DSHOT driver based on ChibiOS |
| esc_dshot.h | DSHOT driver based on ChibiOS |
| esc_dshot_config.h | |
| ► core | |
| ► microrl | |
| microrl.c | |
| microrl.h | |
| microrlConfig.h | |
| microrlShell.c | |
| microrlShell.h | Simple CLI shell header |
| rtos_mon_arch.c | |
| settings_arch.c | Persistent settings low level flash routines stm32 |
| shell_arch.c | |
| shell_arch.h | |
| threads_arch.c | |
| threads_arch.h | |
| ► lidar | |
| lidar_vl53l5cx.c | |
| lidar_vl53l5cx.h | |
| vl53l5cx_platform.c | |
| ► light | |
| light_ws2812_arch.c | |
| light_ws2812_arch.h | Ws2812 driver based on ChibiOS |
| ► radio_control | |
| ppm_arch.c | PPM interface between ChibiOS and Paparazzi |
| ppm_arch.h | PPM interface between ChibiOS and Paparazzi |
| ► tlsf | |
| tlsf_malloc_arch.c | Dynamic memory allocation based on TLSF library |
| tlsf_malloc_arch.h | Dynamic memory allocation based on TLSF library |
| ► uavcan | |
| uavcan.c | Interface from actuators to ChibiOS CAN driver using UAVCan |
| uavcan.h | Interface with uavcan using the Chibios can interfaces |
| board.c | |
| chconf.h | |
| common_board.h | Generic board file |
| ffconf.h | |
| halconf.h | |
| led_hw.h | Led macro implementation for ChibiOS arch |
| mcu_arch.c | Microcontroller initialization function for ChibiOS |
| mcu_arch.h | Microcontroller initialization function for ChibiOS |
| mcuconf.h | |
| mcuconf_h7.h | |
| usb_ser_hw.c | |
| ► linux | |
| ► mcu_periph | |
| adc_arch.c | Driver for the analog to digital converters in Linux based systems |
| adc_arch.h | Driver for the analog to digital converters in Linux based systems |
| gpio_arch.c | GPIO helper functions for linux/omap |
| gpio_arch.h | GPIO helper functions for linux/omap |
| i2c_arch.c | I2C functionality |
| i2c_arch.h | I2C functionality |
| i2c_smbus.h | I2C-bus driver |
| pipe_arch.c | Linux named pipe handling |
| pipe_arch.h | Linux named pipe handling |
| pwm_sysfs.c | PWM servos handling using Linux sysfs |
| pwm_sysfs.h | PWM servos handling using Linux sysfs |
| spi_arch.c | Handling of SPI hardware for Linux |
| spi_arch.h | Handling of SPI hardware for Linux |
| sys_time_arch.c | |
| sys_time_arch.h | Linux timing functions |
| uart_arch.c | Linux uart handling |
| uart_arch.h | Linux uart handling |
| udp_arch.c | Linux UDP handling |
| udp_arch.h | Linux UDP handling |
| ► modules | |
| ► actuators | |
| actuators_pwm_arch.c | |
| actuators_pwm_arch.h | |
| ► core | |
| settings_arch.c | Linux arch Persistent settings |
| threads_arch.c | |
| threads_arch.h | |
| led_hw.h | Linux arch dependant LED macros |
| mcu_arch.c | Linux arch dependant microcontroller initialisation functions |
| mcu_arch.h | Linux arch dependant microcontroller initialisation functions |
| rt_priority.h | Functions to obtain rt priority or set the nice level |
| serial_port.c | |
| serial_port.h | |
| udp_socket.c | Easily create and use UDP sockets |
| udp_socket.h | Easily create and use UDP sockets |
| ► sim | |
| ► mcu_periph | |
| adc_arch.c | Dummy functions for handling of ADC hardware in sim |
| adc_arch.h | Dummy header for handling of ADC hardware in sim |
| gpio_arch.c | Dummy file for GPIO |
| gpio_arch.h | GPIO dummy function/macros to compile in simulation |
| i2c_arch.c | Dummy functions for handling of I2C hardware in sim |
| i2c_arch.h | Dummy header for handling of I2C hardware in sim |
| pipe_arch.c | |
| pipe_arch.h | |
| rng_arch.c | Arch specific Random Number Generator API |
| spi_arch.c | Dummy functions for handling of SPI hardware in sim |
| spi_arch.h | Dummy header for handling of SPI hardware in sim |
| sys_time_arch.c | Handling of sys_time in sim |
| sys_time_arch.h | Simulator timing functions |
| uart_arch.c | |
| uart_arch.h | |
| udp_arch.c | |
| udp_arch.h | |
| ► modules | |
| ► actuators | |
| actuators_dshot_arch.c | |
| actuators_dualpwm_arch.c | Dummy servos handling for sim |
| actuators_dualpwm_arch.h | Dummy servos handling for sim |
| actuators_pwm_arch.c | Dummy servos handling for linux |
| actuators_pwm_arch.h | Dummy servos handling for linux |
| actuators_t4_arch.c | Actuator interface for T4 driver |
| actuators_t4_arch.h | Actuator interface for T4 driver |
| actuators_uavcan_arch.c | Dummy servos handling for sim |
| actuators_uavcan_arch.h | Dummy servos handling for sim |
| ► core | |
| booz_pwm_arch.c | |
| booz_pwm_arch.h | |
| rtos_mon_arch.c | |
| settings_arch.c | Sim arch Persistent settings |
| threads_arch.c | |
| threads_arch.h | |
| trigger_ext_hw.c | |
| trigger_ext_hw.h | |
| ► datalink | |
| superbitrf.c | DSM2 and DSMX datalink implementation for the cyrf6936 2.4GHz radio chip trough SPI |
| superbitrf.h | DSM2 and DSMX datalink implementation for the cyrf6936 2.4GHz radio chip trough SPI |
| ► ins | |
| ins_arduimu.c | |
| ins_arduimu_basic.c | |
| ► radio_control | |
| ppm_arch.c | PPM radio control, simulator specific |
| ppm_arch.h | PPM radio control, simulator specific |
| spektrum_arch.c | Simulator implementation for spektrum radio control |
| ► uavcan | |
| uavcan.h | |
| ► peripherals | |
| hmc5843_arch.c | |
| hmc5843_arch.h | |
| max1168_arch.c | |
| max1168_arch.h | |
| baro_MS5534A.h | Dummy Handling of the MS5534a pressure sensor for the sim |
| max1167_hw.c | |
| max1167_hw.h | |
| mcu_arch.c | |
| mcu_arch.h | |
| servos_nil.h | |
| ► stm32 | |
| ► mcu_periph | |
| adc_arch.c | Driver for the analog to digital converters on STM32 |
| adc_arch.h | Driver for the analog to digital converters on STM32 |
| can_arch.c | Handling of CAN hardware for STM32 |
| can_arch.h | Handling of CAN hardware for STM32 |
| gpio_arch.c | GPIO helper functions for STM32F1 and STM32F4 |
| gpio_arch.h | GPIO helper functions for STM32F1 and STM32F4 |
| i2c_arch.c | Handling of I2C hardware for STM32 |
| i2c_arch.h | Hardware level I2C handling for the STM32 |
| pwm_input_arch.c | Handling of smt32 PWM input using a timer with capture |
| pwm_input_arch.h | Handling of smt32 PWM input using a timer with capture |
| rng_arch.c | Arch specific Random Number Generator API |
| spi_arch.c | Handling of SPI hardware for STM32 |
| spi_arch.h | Handling of SPI hardware for STM32 |
| sys_time_arch.c | STM32 timing functions |
| sys_time_arch.h | STM32 timing functions |
| uart_arch.c | Handling of UART hardware for STM32 |
| uart_arch.h | Handling of UART hardware for STM32 |
| ► modules | |
| ► actuators | |
| actuators_dualpwm_arch.c | STM32 dual PWM servos handling |
| actuators_dualpwm_arch.h | STM32 PWM servos handling |
| actuators_pwm_arch.c | STM32 PWM servos handling |
| actuators_pwm_arch.h | STM32 PWM servos handling |
| actuators_shared_arch.c | STM32 PWM and dualPWM servos shared functions |
| actuators_shared_arch.h | STM32 PWM and dualPWM servos shared functions |
| ► core | |
| settings_arch.c | Persistent settings low level flash routines stm32 |
| threads_arch.c | |
| threads_arch.h | |
| ► imu | |
| imu_aspirin_arch.c | |
| imu_aspirin_arch.h | |
| ► intermcu | |
| link_mcu_hw.h | |
| ► radio_control | |
| ppm_arch.c | STM32 ppm decoder |
| ppm_arch.h | STM32 ppm decoder |
| ► peripherals | |
| hmc5843_arch.c | |
| hmc5843_arch.h | |
| max1168_arch.c | |
| max1168_arch.h | |
| ms2100_arch.c | STM32 specific functions for the ms2100 magnetic sensor from PNI |
| ms2100_arch.h | STM32 specific functions for the ms2100 magnetic sensor from PNI |
| sc18is600_arch.c | |
| sc18is600_arch.h | |
| led_hw.c | |
| led_hw.h | |
| mcu_arch.c | Stm32 arch dependant microcontroller initialisation functions |
| mcu_arch.h | Stm32 arch dependant microcontroller initialisation functions |
| my_debug_servo.h | |
| test_bswap.c | |
| uart_tunnel.c | |
| usb_ser_hw.c | CDC USB device driver for STM32 architecture (STM32F1, STM32F4) |
| ► boards | |
| ► apogee | |
| ► chibios | |
| ► v1.0 | |
| board.h | |
| mcuconf_board.h | |
| baro_board.c | Integrated barometer for Apogee boards (mpl3115) |
| baro_board.h | Integrated barometer for Apogee boards (mpl3115) |
| imu_apogee.c | Driver for the IMU on the Apogee board |
| imu_apogee.h | Driver for the IMU on the Apogee board |
| ► ardrone | |
| actuators.c | Actuator driver for ardrone2 version |
| actuators.h | Actuator driver for ardrone2-raw version |
| baro_board.c | Paparazzi AR Drone 2 Baro Sensor implementation: |
| baro_board.h | Paparazzi AR Drone 2 Baro Sensor implementation: |
| board.c | ARDrone2 specific board initialization function |
| gpio_ardrone.c | Ardrone GPIO driver |
| navdata.c | ARDrone2 navdata aquisition driver |
| navdata.h | Ardrone2 navdata aquisition driver |
| ► bebop | |
| ► isp | |
| ► regmap | |
| avi_isp_bayer.h | |
| avi_isp_chain_bayer_inter.h | |
| avi_isp_chain_yuv_inter.h | |
| avi_isp_chroma.h | |
| avi_isp_chromatic_aberration.h | |
| avi_isp_color_correction.h | |
| avi_isp_dead_pixel_correction.h | |
| avi_isp_denoising.h | |
| avi_isp_drop.h | |
| avi_isp_edge_enhancement_color_reduction_filter.h | |
| avi_isp_gamma_corrector.h | |
| avi_isp_green_imbalance.h | |
| avi_isp_i3d_lut.h | |
| avi_isp_lens_shading_correction.h | |
| avi_isp_pedestal.h | |
| avi_isp_statistics_bayer.h | |
| avi_isp_statistics_yuv.h | |
| avi_isp_vlformat_32to40.h | |
| avi_isp_vlformat_40to32.h | |
| libisp.c | |
| libisp.h | |
| libisp_config.h | |
| reg_avi.h | |
| actuators.c | Actuator driver for the bebop and bebop 2 |
| actuators.h | Actuator driver for the bebop |
| board.c | Bebop specific board initialization function |
| mt9f002.c | Initialization of MT9F002 chip and options to change settings |
| mt9f002.h | Initialization and configuration of the MT9F002 CMOS Chip |
| mt9f002_nps.c | |
| mt9f002_regs.h | |
| mt9v117.c | Initialization of MT9V117 chip and options to change settings |
| mt9v117.h | Initialization and configuration of the MT9V117 CMOS Chip |
| mt9v117_nps.c | |
| mt9v117_regs.h | |
| ► betafpv | |
| ► aiof7 | |
| ► v2 | |
| board.h | |
| mcuconf_board.h | |
| ► chimera | |
| ► chibios | |
| ► v1.0 | |
| board.h | |
| chimera.h | |
| mcuconf_board.h | |
| baro_board.h | |
| ► crazyflie | |
| ► chibios | |
| ► v2.1 | |
| board.h | |
| crazyflie.h | |
| mcuconf_board.h | |
| ► cube | |
| ► orange | |
| board.h | |
| ► disco | |
| actuators.c | Actuator driver for the Parrot Disco |
| actuators.h | Actuator driver for the disco |
| board.c | Disco specific board initialization function |
| ► elle0 | |
| baro_board.h | |
| ► holybro | |
| ► kakute_f7 | |
| board.h | |
| holybro_kakute_f7.h | |
| mcuconf_board.h | |
| ► lia | |
| ► chibios | |
| ► v1.1 | |
| board.h | |
| mcuconf_board.h | |
| baro_board.c | |
| baro_board.h | |
| ► lisa_l | |
| baro_board.c | |
| baro_board.h | |
| ► lisa_m | |
| baro_board.c | Baro board interface for Bosch BMP085 on LisaM I2C2 with EOC check |
| baro_board.h | |
| ► lisa_mx | |
| ► chibios | |
| ► v2.1 | |
| board.h | |
| mcuconf_board.h | |
| baro_board.c | |
| baro_board.h | |
| ► lisa_mxs | |
| ► chibios | |
| ► v1.0 | |
| board.h | |
| mcuconf_board.h | |
| baro_board.c | |
| baro_board.h | |
| ► lisa_s | |
| baro_board.h | |
| ► mateksys | |
| ► F765-WING | |
| board.h | |
| matekF765-WING.h | |
| mcuconf_board.h | |
| ► FC-H743-SLIM | |
| board.h | |
| mcuconf_board.h | |
| ► H743-WING | |
| board.h | |
| mcuconf_board.h | |
| ► naze32 | |
| baro_board.h | |
| ► nucleo | |
| ► 144_f767zi | |
| board.h | |
| mcuconf_board.h | |
| nucleo144_f767zi.h | |
| ► opa_ap | |
| baro_board.h | |
| ► openpilot_revo | |
| baro_board.h | |
| ► px4fmu | |
| ► chibios | |
| ► v2.4 | |
| board.h | |
| mcuconf_board.h | |
| ► v4.0 | |
| board.h | |
| mcuconf_board.h | |
| px4fmu.h | |
| ► v5.0 | |
| board.h | |
| mcuconf_board.h | |
| ► v6x | |
| board.h | |
| baro_board.h | |
| ► tawaki | |
| ► chibios | |
| ► common | |
| mcuconf_board.h | |
| tawaki.h | |
| ► v1.0 | |
| board.h | |
| ► v1.1 | |
| board.h | |
| ► v2.0 | |
| board.h | |
| mcuconf_board.h | |
| tawaki_v2.0.h | |
| baro_board.h | |
| ► tmotor | |
| ► aiof7 | |
| ► v1 | |
| board.h | |
| mcuconf_board.h | |
| apogee_1.0.h | |
| ardrone2.h | |
| baro_board_ms5611_i2c.c | Driver for onboard MS5611 baro via I2C |
| baro_board_ms5611_spi.c | Driver for onboard MS5611 baro via SPI |
| beagle_bone_black.h | |
| bebop.h | |
| cc3d.h | |
| cjmcu.h | |
| crazybee_f4_1.0.h | |
| disco.h | |
| elle0_1.0.h | |
| elle0_1.2.h | |
| elle0_common.h | |
| krooz_sd.h | |
| lia_1.1.h | |
| lisa_l_1.0.h | |
| lisa_m_1.0.h | |
| lisa_m_2.0.h | |
| lisa_m_2.1.h | |
| lisa_m_common.h | |
| lisa_mx_2.0.h | |
| lisa_mx_2.1.h | |
| lisa_mx_common.h | |
| lisa_mxs_1.0.h | |
| lisa_s_1.0.h | |
| matek_f405_wing_v1.h | |
| navstik_1.0.h | |
| naze32_common.h | |
| naze32_rev4.h | |
| naze32_rev5.h | |
| olimex_stm32-h103.h | |
| opa_ap_1.0.h | |
| opa_ftd_1.0.h | |
| openpilot_revo_1.0.h | |
| openpilot_revo_nano.h | |
| pc_sim.h | |
| px4fmu_1.7.h | |
| px4fmu_2.4.h | |
| px4fmu_4.0.h | |
| px4io_2.4.h | |
| ► filters | |
| 1e_filter.h | Implementation of the 1 euro filter |
| adaptive_notch_filter.h | Adaptive notch filter |
| delayed_first_order_lowpass_filter.h | First order low-pass filter with delay |
| high_pass_filter.h | Simple high pass filter with double precision |
| linear_kalman_filter.c | Generic discrete Linear Kalman Filter |
| linear_kalman_filter.h | |
| low_pass_filter.h | Simple first order low pass filter with bilinear transform |
| median_filter.h | |
| notch_filter.h | Second order notch filter |
| notch_filter_float.h | |
| pid.h | Several forms of PID controllers |
| simple_kinematic_kalman.c | |
| simple_kinematic_kalman.h | |
| ► firmwares | |
| ► demo | |
| demo_ahrs_actuators.c | Demo prog with ahrs and simple roll/pitch commands to actuators |
| ► fixedwing | |
| ► guidance | |
| energy_ctrl.c | Total Energy (speed + height) control for fixed wing vehicles |
| energy_ctrl.h | Vertical control using total energy control for fixed wing vehicles |
| guidance_common.h | Vertical control for fixed wing vehicles |
| guidance_h.c | Horizontal guidance logic for fixed wing vehicles |
| guidance_h.h | Horizontal guidance logic for fixed wing vehicles |
| guidance_v.c | Vertical control for fixed wing vehicles |
| guidance_v.h | Vertical control for fixed wing vehicles |
| guidance_v_n.c | "New" vertical control for fixed wing vehicles |
| guidance_v_n.h | "New" vertical control for fixed wing vehicles |
| ► stabilization | |
| stabilization_adaptive.c | Fixed wing adaptive control |
| stabilization_adaptive.h | Fixed wing horizontal adaptive control |
| stabilization_attitude.c | Fixed wing horizontal control |
| stabilization_attitude.h | Fixed wing horizontal control |
| ap_downlink.c | |
| autopilot_firmware.c | Fixedwing specific autopilot interface and initialization |
| autopilot_firmware.h | Fixedwing specific autopilot interface and initialization |
| autopilot_generated.c | Generated autopilot implementation |
| autopilot_generated.h | Autopilot generated implementation Calls the code generated from autopilot XML file |
| autopilot_rc_helpers.h | Some helper functions to check RC sticks |
| autopilot_static.c | |
| autopilot_static.h | Fixedwing autopilot modes (static implementation) |
| autopilot_utils.c | Utility functions and includes for autopilots |
| autopilot_utils.h | Utility functions and includes for autopilots |
| fbw_datalink.c | Datalink through FBW (FlyByWire) process/mcu |
| fbw_datalink.h | Handling of messages coming from ground in FTD |
| fbw_downlink.c | |
| main_recovery.c | Recovery mode: run manual mode in case of hardfault Based on legacy FBW |
| main_recovery.h | Recovery mode: run manual mode in case of hardfault Based on legacy FBW |
| nav.c | Fixedwing functions to compute navigation |
| nav.h | Fixedwing Navigation library |
| ► rotorcraft | |
| ► guidance | |
| guidance_flip.c | Open Loop guidance for making a flip |
| guidance_flip.h | Open Loop guidance for making a flip |
| guidance_h.c | Horizontal guidance for rotorcrafts |
| guidance_h.h | Horizontal guidance for rotorcrafts |
| guidance_h_ref.c | Reference generation for horizontal guidance |
| guidance_h_ref.h | Reference generation for horizontal guidance |
| guidance_hybrid.c | Guidance controllers (horizontal and vertical) for Hybrid UAV configurations |
| guidance_hybrid.h | Guidance controllers (horizontal and vertical) for Hybrid UAV configurations |
| guidance_indi.c | A guidance mode based on Incremental Nonlinear Dynamic Inversion |
| guidance_indi.h | A guidance mode based on Incremental Nonlinear Dynamic Inversion |
| guidance_indi_hybrid.c | A guidance mode based on Incremental Nonlinear Dynamic Inversion Come to IROS2016 to learn more! |
| guidance_indi_hybrid.h | A guidance mode based on Incremental Nonlinear Dynamic Inversion Come to ICRA2016 to learn more! |
| guidance_indi_hybrid_quadplane.c | |
| guidance_indi_hybrid_quadplane.h | |
| guidance_indi_hybrid_tailsitter.c | |
| guidance_indi_hybrid_tailsitter.h | |
| guidance_module.h | Guidance in a module file |
| guidance_oneloop.c | A dummy guidance module to run the oneloop_andi controller |
| guidance_oneloop.h | A dummy guidance mode to run the oneloop_andi controller |
| guidance_pid.c | Guidance controller with PID for rotorcrafts |
| guidance_pid.h | Guidance controller with PID for rotorcrafts |
| guidance_plane.c | Guidance controller for planes with PID compatible with the rotorcraft firmware no airspeed control |
| guidance_plane.h | Guidance controller for planes in rotorcraft firmware using basic PID controller no airspeed control |
| guidance_v.c | Vertical guidance for rotorcrafts |
| guidance_v.h | Vertical guidance for rotorcrafts |
| guidance_v_adapt.c | Adaptation block of the vertical guidance |
| guidance_v_adapt.h | Adaptation block of the vertical guidance |
| guidance_v_ref.c | Reference generation for vertical guidance |
| guidance_v_ref.h | Reference generation for vertical guidance |
| ► oneloop | |
| oneloop_andi.c | |
| oneloop_andi.h | |
| ► stabilization | |
| attitude_ref_saturate_naive.h | Naive attitude reference saturation |
| stabilization_attitude.h | General attitude stabilization interface for rotorcrafts |
| stabilization_attitude_common_float.h | Common data structures shared by euler and quaternion float implementations |
| stabilization_attitude_common_int.h | Common data structures shared by euler and quaternion int implementations |
| stabilization_attitude_euler_float.c | Rotorcraft attitude stabilization in euler float version |
| stabilization_attitude_euler_float.h | Rotorcraft attitude stabilization in euler float version |
| stabilization_attitude_euler_int.c | Rotorcraft attitude stabilization in euler int version |
| stabilization_attitude_euler_int.h | |
| stabilization_attitude_heli_indi.c | Helicopter quaternion INDI attitude stabilization |
| stabilization_attitude_heli_indi.h | |
| stabilization_attitude_passthrough.c | Passthrough attitude stabilization |
| stabilization_attitude_passthrough.h | |
| stabilization_attitude_plane_pid.c | Basic fixed-wing attitude stabilization in euler float version |
| stabilization_attitude_plane_pid.h | Basic fixed-wing attitude stabilization in euler float version |
| stabilization_attitude_quat_float.c | Quaternion attitude stabilization (floating point) |
| stabilization_attitude_quat_float.h | Rotorcraft attitude stabilization in quaternion float version |
| stabilization_attitude_quat_indi.c | MAVLab Delft University of Technology This control algorithm is Incremental Nonlinear Dynamic Inversion (INDI) |
| stabilization_attitude_quat_indi.h | This is the header file of the corresponding c file |
| stabilization_attitude_quat_int.c | Rotorcraft quaternion attitude stabilization |
| stabilization_attitude_quat_int.h | |
| stabilization_attitude_quat_transformations.c | Quaternion transformation functions |
| stabilization_attitude_quat_transformations.h | Quaternion transformation functions |
| stabilization_attitude_rc_setpoint.c | Read an attitude setpoint from the RC |
| stabilization_attitude_rc_setpoint.h | Read an attitude setpoint from the RC |
| stabilization_attitude_ref_defaults.h | Default values for attitude reference saturation |
| stabilization_attitude_ref_euler_float.c | Rotorcraft attitude reference generation in euler float version |
| stabilization_attitude_ref_euler_float.h | |
| stabilization_attitude_ref_euler_int.c | Rotorcraft attitude reference generation (euler int version) |
| stabilization_attitude_ref_euler_int.h | Rotorcraft attitude reference generation (euler int version) |
| stabilization_attitude_ref_int.h | Rotorcraft attitude reference generation API |
| stabilization_attitude_ref_quat_float.c | Rotorcraft attitude reference generation |
| stabilization_attitude_ref_quat_float.h | Rotorcraft attitude reference generation |
| stabilization_attitude_ref_quat_int.c | Rotorcraft attitude reference generation |
| stabilization_attitude_ref_quat_int.h | Rotorcraft attitude reference generation |
| stabilization_direct.c | Dummy stabilization for rotorcrafts |
| stabilization_direct.h | Dummy stabilization for rotorcrafts |
| stabilization_indi.c | |
| stabilization_indi.h | |
| stabilization_indi_simple.c | |
| stabilization_indi_simple.h | |
| stabilization_oneloop.c | |
| stabilization_oneloop.h | |
| stabilization_rate.c | Rate stabilization for rotorcrafts |
| stabilization_rate.h | Rate stabilization for rotorcrafts |
| stabilization_rate_indi.c | Rate stabilization for rotorcrafts based on INDI by Ewoud Smeur |
| stabilization_rate_indi.h | Rate stabilization for rotorcrafts based on INDI |
| autopilot_arming.h | Arming procedure for rotorcraft Several options can be selected: |
| autopilot_arming_common.h | Arming procedure for rotorcraft, common definitions |
| autopilot_arming_switch.h | Arm the motors using a switch |
| autopilot_arming_throttle.h | Automatically arm the motors when applying throttle |
| autopilot_arming_yaw.h | Arm the motors by with max yaw stick |
| autopilot_firmware.c | |
| autopilot_firmware.h | Rotorcraft specific autopilot interface and initialization |
| autopilot_generated.c | Generated autopilot implementation |
| autopilot_generated.h | Autopilot generated implementation Calls the code generated from autopilot XML file |
| autopilot_guided.c | Autopilot guided mode interface |
| autopilot_guided.h | Autopilot guided mode interface |
| autopilot_rc_helpers.h | Some helper functions to check RC sticks |
| autopilot_static.c | Static autopilot implementation |
| autopilot_static.h | Autopilot static implementation |
| autopilot_utils.c | Utility functions and includes for autopilots |
| autopilot_utils.h | Utility functions and includes for autopilots |
| guidance.h | |
| navigation.c | Rotorcraft navigation functions |
| navigation.h | Rotorcraft navigation functions |
| rotorcraft_telemetry.c | |
| stabilization.c | General stabilization interface for rotorcrafts |
| stabilization.h | General stabilization interface for rotorcrafts |
| ► rover | |
| ► guidance | |
| rover_guidance.c | Basic guidance for rover |
| rover_guidance.h | Basic guidance for rover |
| rover_guidance_holonomic.c | Basic guidance for rover |
| rover_guidance_holonomic.h | Basic guidance for rover |
| rover_guidance_steering.c | |
| rover_guidance_steering.h | |
| ► obstacles | |
| rover_obstacles.c | Functions to create a grid map |
| rover_obstacles.h | |
| autopilot_firmware.c | |
| autopilot_firmware.h | Rover specific autopilot interface and initialization |
| autopilot_generated.c | Generated autopilot implementation |
| autopilot_generated.h | Autopilot generated implementation Calls the code generated from autopilot XML file |
| autopilot_rc_helpers.h | |
| autopilot_utils.c | Utility functions and includes for autopilots |
| autopilot_utils.h | Utility functions and includes for autopilots |
| navigation.c | Rover navigation functions |
| navigation.h | Rover navigation functions |
| rover_telemetry.c | |
| ► setup | |
| setup_actuators.c | |
| usb_tunnel.c | USB tunnel application |
| ► tutorial | |
| main_demo1.c | |
| main_demo2.c | |
| main_demo3.c | |
| main_demo4.c | |
| main_demo5.c | |
| main_demo6.c | |
| ► math | |
| ► qr_solve | |
| qr_solve.c | |
| qr_solve.h | |
| r8lib_min.c | |
| r8lib_min.h | |
| ► wls | |
| wls_alloc.c | This is an active set algorithm for WLS control allocation |
| wls_alloc.h | |
| pprz_algebra.h | Paparazzi generic algebra macros |
| pprz_algebra_double.c | Paparazzi double precision floating point algebra |
| pprz_algebra_double.h | Paparazzi double precision floating point algebra |
| pprz_algebra_float.c | Paparazzi floating point algebra |
| pprz_algebra_float.h | Paparazzi floating point algebra |
| pprz_algebra_int.c | Paparazzi fixed point algebra |
| pprz_algebra_int.h | Paparazzi fixed point algebra |
| pprz_circfit_float.c | |
| pprz_circfit_float.h | |
| pprz_geodetic.h | Paparazzi generic macros for geodetic calculations |
| pprz_geodetic_double.c | Paparazzi double-precision floating point math for geodetic calculations |
| pprz_geodetic_double.h | Paparazzi double-precision floating point math for geodetic calculations |
| pprz_geodetic_float.c | Paparazzi floating point math for geodetic calculations |
| pprz_geodetic_float.h | Paparazzi floating point math for geodetic calculations |
| pprz_geodetic_int.c | Paparazzi fixed point math for geodetic calculations |
| pprz_geodetic_int.h | Paparazzi fixed point math for geodetic calculations |
| pprz_geodetic_utm.h | Constants UTM (Mercator) projections |
| pprz_geodetic_wgs84.h | WGS-84 Geoid Heights |
| pprz_geodetic_wmm2025.c | WMM2025 Geomagnetic field model |
| pprz_geodetic_wmm2025.h | |
| pprz_isa.h | Paparazzi atmospheric pressure conversion utilities |
| pprz_matrix_decomp_float.c | Matrix decompositions in floating point |
| pprz_matrix_decomp_float.h | Matrix decompositions in floating point |
| pprz_orientation_conversion.c | Generic orientation representation and conversion |
| pprz_orientation_conversion.h | Generic orientation representation and conversions |
| pprz_polyfit_float.c | Polynomial regression |
| pprz_polyfit_float.h | Polynomial regression |
| pprz_random.c | |
| pprz_random.h | |
| pprz_rk_float.h | Runge-Kutta library (float version) |
| pprz_simple_matrix.h | Simple matrix helper macros |
| pprz_stat.c | Statistics functions |
| pprz_stat.h | Statistics functions |
| pprz_trig_int.c | Paparazzi fixed point trig functions |
| pprz_trig_int.h | Paparazzi fixed point trig functions |
| RANSAC.c | |
| RANSAC.h | Perform Random Sample Consensus (RANSAC), a robust fitting method |
| ► mcu_periph | |
| adc.h | Arch independent ADC (Analog to Digital Converter) API |
| can.c | |
| can.h | |
| dac.h | |
| gpio.h | Some architecture independent helper functions for GPIOs |
| i2c.c | Architecture independent I2C (Inter-Integrated Circuit Bus) API |
| i2c.h | Architecture independent I2C (Inter-Integrated Circuit Bus) API |
| pipe.c | Arch independent PIPE API |
| pipe.h | Arch independent PIPE API |
| pwm_input.c | Arch independent PWM input capture API |
| pwm_input.h | Arch independent PWM input capture API |
| rng.h | Arch independent Random Number Generator API |
| sdio.h | Arch independent SDIO API |
| softi2c.c | Platform-independent software I2C implementation |
| softi2c.h | Platform-independent software I2C implementation |
| spi.c | Architecture independent SPI (Serial Peripheral Interface) API |
| spi.h | Architecture independent SPI (Serial Peripheral Interface) API |
| sys_time.c | Architecture independent timing functions |
| sys_time.h | Architecture independent timing functions |
| uart.c | |
| uart.h | Arch independent UART (Universal Asynchronous Receiver/Transmitter) API |
| udp.c | Arch independent UDP API |
| udp.h | Arch independent UDP API |
| usb_serial.h | Arch independent USB API |
| ► modules | |
| ► actuators | |
| actuators.c | Hardware independent actuators code |
| actuators.h | Hardware independent API for actuators (servos, motor controllers) |
| actuators_asctec_v2.c | Actuators driver for Asctec v2 motor controllers |
| actuators_asctec_v2.h | Actuators driver for Asctec v2 motor controllers |
| actuators_default.h | |
| actuators_dshot.c | |
| actuators_dshot.h | |
| actuators_dualpwm.h | |
| actuators_dummy.h | |
| actuators_esc32.c | Actuators driver for AutoQuad ESC32 motor controllers |
| actuators_esc32.h | Actuators driver for AutoQuad ESC32 motor controllers |
| actuators_faulhaber.c | |
| actuators_faulhaber.h | |
| actuators_hitl.c | |
| actuators_hitl.h | |
| actuators_md25.c | |
| actuators_md25.h | |
| actuators_ostrich.c | |
| actuators_ostrich.h | |
| actuators_pwm.c | |
| actuators_pwm.h | |
| actuators_sbus.c | Sbus actuator driver, which can output as 7 sbus channels at ~11ms |
| actuators_sbus.h | Sbus actuator driver, which can output as 7 sbus channels at ~11ms |
| actuators_spektrum.c | Spektrum actuator driver, which can output as 7 spektrum channels at ~11ms |
| actuators_spektrum.h | Spektrum actuator driver, which can output as 7 spektrum channels at ~11ms |
| actuators_sts3032.c | |
| actuators_sts3032.h | |
| actuators_t4.h | Uses a T4 Actuators Board as fly by wire system. This Board can control serial bus servos, ESC's and PWM servos, with as big benefir providing real time telemetry in return into the autopilot state. Read more on how to create your own T4 Board here: https://github.com/tudelft/t4_actuators_board/ |
| actuators_t4_uart.c | Uses a T4 Actuators Board as fly by wire system. This Board can control serial bus servos, ESC's and PWM servos, with as big benefir providing real time telemetry in return into the autopilot state. Read more on how to create your own T4 Board here: https://github.com/tudelft/t4_actuators_board/ |
| actuators_t4_uart.h | Uses a T4 Actuators Board as fly by wire system. This Board can control serial bus servos, ESC's and PWM servos, with as big benefir providing real time telemetry in return into the autopilot state. Read more on how to create your own T4 Board here: https://github.com/tudelft/t4_actuators_board/ |
| actuators_uavcan.c | UAVCan actuators using RAWCOMMAND message and ESC_STATUS telemetry |
| actuators_uavcan.h | |
| actuators_uavcan1.h | |
| actuators_uavcan1cmd.h | |
| actuators_uavcan2.h | |
| actuators_uavcan2cmd.h | |
| motor_mixing.c | Motor Mixing |
| motor_mixing.h | Motor Mixing |
| motor_mixing_types.h | Common Motor Mixing configuration types |
| ► adcs | |
| adc_generic.c | This module can be used to read one or two values from the ADC channels in a generic way |
| adc_generic.h | This module can be used to read one or two values from the ADC channels in a generic way |
| battery_monitor.c | Driver for ADC AD7997 on a custom made power board version 4.0 and 5.0 |
| battery_monitor.h | Driver for ADC AD7997 on a custom made power board version 4.0 and 5.0 |
| max11040.c | Maxim MAX11040 ADC interface |
| max11040.h | |
| mcp355x.h | |
| ► ahrs | |
| ahrs.c | |
| ahrs.h | |
| ahrs_aligner.c | Low-pass IMU measurements at startup to align the AHRS |
| ahrs_aligner.h | Interface to align the AHRS via low-passed measurements at startup |
| ahrs_float_cmpl.c | Complementary filter in float to estimate the attitude, heading and gyro bias |
| ahrs_float_cmpl.h | Complementary filter in float to estimate the attitude, heading and gyro bias |
| ahrs_float_cmpl_wrapper.c | Paparazzi specific wrapper to run floating point complementary filter |
| ahrs_float_cmpl_wrapper.h | Paparazzi specific wrapper to run floating point complementary filter |
| ahrs_float_dcm.c | Attitude estimation for fixedwings based on the DCM |
| ahrs_float_dcm.h | Attitude estimation for fixedwings based on the DCM |
| ahrs_float_dcm_algebra.h | Algebra helper functions for DCM |
| ahrs_float_dcm_wrapper.c | Paparazzi specific wrapper to run floating point complementary filter |
| ahrs_float_dcm_wrapper.h | Paparazzi specific wrapper to run floating point DCM filter |
| ahrs_float_invariant.c | |
| ahrs_float_invariant.h | AHRS using invariant filter |
| ahrs_float_invariant_wrapper.c | Paparazzi specific wrapper to run INVARIANT ahrs filter |
| ahrs_float_invariant_wrapper.h | Paparazzi specific wrapper to run INVARIANT ahrs filter |
| ahrs_float_mlkf.c | Multiplicative linearized Kalman Filter in quaternion formulation |
| ahrs_float_mlkf.h | Multiplicative linearized Kalman Filter in quaternion formulation |
| ahrs_float_mlkf_wrapper.c | Paparazzi specific wrapper to run MLKF filter |
| ahrs_float_mlkf_wrapper.h | Paparazzi specific wrapper to run MLKF filter |
| ahrs_float_utils.h | Utility functions for floating point AHRS implementations |
| ahrs_int_cmpl_quat.c | Quaternion complementary filter (fixed-point) |
| ahrs_int_cmpl_quat.h | Quaternion complementary filter (fixed-point) |
| ahrs_int_cmpl_quat_wrapper.c | Paparazzi specific wrapper to run floating point complementary filter |
| ahrs_int_cmpl_quat_wrapper.h | Paparazzi specific wrapper to run floating point complementary filter |
| ahrs_int_utils.h | Utility functions for fixed point AHRS implementations |
| ahrs_madgwick.c | |
| ahrs_madgwick.h | AHRS using Madgwick implementation |
| ahrs_madgwick_wrapper.c | Paparazzi specific wrapper to run Madgwick ahrs filter |
| ahrs_madgwick_wrapper.h | Paparazzi specific wrapper to run Madgwick ahrs filter |
| ahrs_magnetic_field_model.h | |
| ahrs_sim.c | Dummy plug to set the AHRS from the simple OCaml simulator |
| ahrs_sim.h | Interface to set the AHRS from the simple OCaml simulator |
| ahrs_vectornav.c | |
| ahrs_vectornav.h | Vectornav VN-200 as AHRS |
| ahrs_vectornav_wrapper.c | Vectornav VN-200 as AHRS |
| ahrs_vectornav_wrapper.h | Vectornav VN-200 as AHRS |
| ► air_data | |
| air_data.c | Air Data interface |
| air_data.h | Air Data interface |
| ► airborne_ant_track | |
| airborne_ant_track.c | |
| airborne_ant_track.h | |
| ► benchmark | |
| flight_benchmark.c | |
| flight_benchmark.h | |
| i2c_abuse_test.c | Total I2C Abuse: |
| i2c_abuse_test.h | Total I2C Abuse: |
| imu_quality_assessment.c | |
| imu_quality_assessment.h | |
| ► boards | |
| opa_controller_ap.c | |
| opa_controller_ap.h | |
| opa_controller_fbw.c | |
| opa_controller_fbw.h | |
| power_switch.c | |
| power_switch.h | |
| ► calibration | |
| mag_calib_ukf.c | |
| mag_calib_ukf.h | |
| ► cam_control | |
| cam_gimbal.c | Pan/Tilt camera gimbal control |
| cam_gimbal.h | Pan/Tilt camera gimbal control |
| gimbal_caddx_gm3.c | |
| gimbal_caddx_gm3.h | |
| rotorcraft_cam.c | Camera control module for rotorcraft |
| rotorcraft_cam.h | Camera control module for rotorcraft |
| ► cartography | |
| photogrammetry_calculator.c | |
| photogrammetry_calculator.h | Add to airframe file: |
| ► checks | |
| airspeed_consistency.c | |
| airspeed_consistency.h | |
| pfc_actuators.c | |
| pfc_actuators.h | |
| preflight_checks.c | |
| preflight_checks.h | |
| ► com | |
| generic_com.c | |
| generic_com.h | |
| usb_serial_stm32.h | Header for serial over USB modules |
| usb_serial_stm32_example1.c | USB_SERIAL_STM32 example 1 - a template for a console to autopilot |
| usb_serial_stm32_example2.c | USB_SERIAL_STM32 example 2 - sends lot of data through serial port |
| ► computer_vision | |
| ► blob | |
| blob_finder.c | Parse UYVY images and make a list of blobs of connected pixels |
| blob_finder.h | Parse UYVY images and make a list of blobs of connected pixels |
| imavmarker.c | Find a IMAV pattern |
| imavmarker.h | Find a IMAV pattern |
| ► lib | |
| ► encoding | |
| jpeg.c | Encode images with the use of the JPEG encoding |
| jpeg.h | Encode images with the use of the JPEG encoding |
| rtp.c | Encodes a vide stream with RTP (JPEG) |
| rtp.h | Encodes a video stream with RTP Format 26 (Motion JPEG) |
| ► exif | |
| exif_module.c | |
| exif_module.h | Write JPEG images containing EXIF headers with GPS coordinates |
| ► v4l | |
| v4l2.c | Capture images from a V4L2 device (Video for Linux 2) |
| v4l2.h | Capture images from a V4L2 device (Video for Linux 2) |
| virt2phys.c | Mapping of virtual to physical memory |
| virt2phys.h | |
| ► vision | |
| act_fast.c | Finds corners in an image by actively scanning the image |
| act_fast.h | Finds corners in an image by actively scanning the image |
| bayer.h | |
| edge_flow.c | Calculate optical flow with EdgeFlow |
| edge_flow.h | Calculate optical flow with EdgeFlow |
| fast_rosten.c | |
| fast_rosten.h | |
| image.c | Image helper functions, like resizing, color filter, converters.. |
| image.h | Image helper functions like resizing, color filter, converters.. |
| lucas_kanade.c | Efficient fixed-point optical-flow calculation |
| lucas_kanade.h | Efficient fixed-point optical-flow calculation |
| PnP_AHRS.c | Functions for solving a perspective-n-point problem, using the AHRS to get the relevant angles |
| PnP_AHRS.h | Functions for solving a perspective-n-point problem, using the AHRS to get the relevant angles |
| undistortion.c | Functions for undistorting camera images |
| undistortion.h | Functions for undistorting camera images |
| ► opticflow | |
| inter_thread_data.h | Inter-thread data structures |
| linear_flow_fit.c | |
| linear_flow_fit.h | |
| opticflow_calculator.c | Estimate velocity from optic flow |
| opticflow_calculator.h | Calculate velocity from optic flow |
| size_divergence.c | Calculate divergence from flow vectors by looking at line sizes between the points |
| size_divergence.h | Calculate divergence from flow vectors by looking at line sizes beteween the points |
| ► qrcode | |
| qr_code.c | |
| qr_code.h | Parse video stream to detect and decode QR-codes using the ZBAR library |
| bebop_ae_awb.c | |
| bebop_ae_awb.h | |
| colorfilter.c | |
| colorfilter.h | |
| cv.c | Computer vision framework for onboard processing |
| cv.h | Computer vision framework for onboard processing |
| cv_blob_locator.c | |
| cv_blob_locator.h | |
| cv_detect_color_object.c | |
| cv_detect_color_object.h | Assumes the color_object consists of a continuous color and checks if you are over the defined color_object or not |
| cv_georeference.c | |
| cv_georeference.h | |
| cv_opencvdemo.c | |
| cv_opencvdemo.h | |
| cv_target_localization.c | |
| cv_target_localization.h | |
| detect_contour.c | |
| detect_contour.h | |
| detect_gate.c | |
| detect_gate.h | |
| detect_window.c | |
| detect_window.h | Detect a bright region surrounded by dark or viceversa - sometimes this corresponds to a window |
| opencv_contour.cpp | |
| opencv_contour.h | Detects contours of an obstacle used in the autonomous drone racing |
| opencv_example.cpp | |
| opencv_example.h | |
| opencv_image_functions.cpp | A small library with functions to convert between the Paparazzi used YUV422 arrays and the opencv image functions |
| opencv_image_functions.h | A small library with functions to convert between the Paparazzi used YUV422 arrays and the opencv image functions |
| opticflow_module.c | Optical-flow estimation module |
| opticflow_module.h | Optical-flow calculation for Parrot Drones |
| snake_gate_detection.c | Detects gates as used in the IROS drone races, i.e., square colored gates |
| snake_gate_detection.h | Detects gates as used in the IROS drone races, i.e., square colored gates |
| tag_tracking.c | |
| tag_tracking.h | |
| textons.c | Takes an image and represents the texture and colors in the image with a texton histogram |
| textons.h | Takes an image and represents the texture and colors in the image with a texton histogram |
| undistort_image.c | |
| undistort_image.h | |
| video_capture.c | |
| video_capture.h | |
| video_thread.c | |
| video_thread.h | Start a Video thread and grab images |
| video_thread_nps.c | |
| video_thread_nps.h | This header gives NPS access to the list of added cameras |
| video_usb_logger.c | |
| video_usb_logger.h | Camera image logger for Linux based autopilots |
| viewvideo.c | Get live images from a RTP/UDP stream and save pictures on internal memory |
| viewvideo.h | Get live images from a RTP/UDP stream and save pictures on internal memory |
| ► core | |
| abi.h | Main include for ABI (AirBorneInterface) |
| abi_common.h | Common tools for ABI middleware |
| abi_sender_ids.h | Convenience defines for ABI sender IDs |
| commands.c | Hardware independent data structures for commands handling |
| commands.h | Hardware independent code for commands handling |
| pwm_meas.c | Wrapper to access pwm_input mcu peripheral from other modules |
| pwm_meas.h | Wrapper to access pwm_input mcu peripheral from other modules |
| rc_settings.c | |
| rc_settings.h | Variable setting though the radio control |
| rtos_mon.c | |
| settings.c | Persistent settings interface |
| settings.h | Persistent settings interface |
| shell.c | Enhanced CLI shell code |
| shell.h | |
| slcan.c | |
| slcan.h | |
| sys_mon.c | System monitoring for bare metal targets return cpu load, average exec time, .. |
| sys_mon.h | System monitoring common header return cpu load, average exec time, .. |
| sys_mon_bare_metal.h | |
| sys_mon_rtos.h | System monitoring for RTOS targets return cpu load, average exec time, .. |
| threads.h | |
| trigger_ext.c | Measure external trigger pulse at PPM input (default) |
| trigger_ext.h | Measure external trigger pulse at PPM input (default) |
| ► ctrl | |
| approach_moving_target.c | |
| approach_moving_target.h | |
| control_mixing_heewing.c | |
| control_mixing_heewing.h | |
| ctrl_module_innerloop_demo.c | Example empty controller |
| ctrl_module_innerloop_demo.h | Example empty controller |
| ctrl_module_outerloop_demo.c | Example empty controller |
| ctrl_module_outerloop_demo.h | Example empty controller |
| ctrl_windtunnel.c | Windtunnel automatic step controller |
| ctrl_windtunnel.h | Windtunnel controller |
| eff_scheduling_cyfoam.c | |
| eff_scheduling_cyfoam.h | |
| eff_scheduling_falcon.c | Interpolation of control effectivenss matrix of the Falcon hybrid plane |
| eff_scheduling_falcon.h | Interpolation of control effectivenss matrix of the Falcon hybrid plane |
| eff_scheduling_generic.c | Module that interpolates gainsets in flight based on the transition percentage |
| eff_scheduling_generic.h | |
| eff_scheduling_nederdrone.c | |
| eff_scheduling_nederdrone.h | |
| eff_scheduling_rotwing.c | |
| eff_scheduling_rotwing.h | |
| eff_scheduling_rotwing_V2.c | |
| eff_scheduling_rotwing_V2.h | |
| follow_me.c | |
| follow_me.h | |
| gain_scheduling.c | Module that interpolates gainsets in flight based on a scheduling variable |
| gain_scheduling.h | Module that interpolates between gain sets, depending on the scheduling variable |
| object_tracking.c | |
| object_tracking.h | |
| optical_flow_functions.c | |
| optical_flow_functions.h | |
| optical_flow_hover.c | |
| optical_flow_hover.h | |
| optical_flow_landing.c | This module implements optical flow landings in which the divergence is kept constant |
| optical_flow_landing.h | This module implements optical flow landings in which the divergence is kept constant |
| scheduling_indi_simple.c | |
| scheduling_indi_simple.h | |
| shift_tracking.c | |
| shift_tracking.h | |
| target_pos.c | |
| target_pos.h | |
| vertical_ctrl_module_demo.c | Example vertical controller |
| vertical_ctrl_module_demo.h | Example vertical |
| ► datalink | |
| ► bitcraze | |
| crtp.h | CRTP protocol for communication with bitcraze/crazyflie modems |
| syslink.c | Syslink protocol for communication with bitcraze/crazyflie NRF mcu |
| syslink.h | Syslink protocol for communication with bitcraze/crazyflie NRF mcu |
| syslink_dl.c | Syslink protocol handling and functionalities |
| syslink_dl.h | Syslink protocol handling and functionalities |
| ► gec | |
| gec.c | Galois embedded crypto iplementation |
| gec.h | Galois embedded crypto implementation |
| ► missionlib | |
| blocks.c | PPRZ specific mission block implementation |
| blocks.h | PPRZ specific mission block implementation |
| mission_manager.c | Common functions used within the mission library |
| mission_manager.h | Common functions used within the mission library, blocks and waypoints cannot be send simultaneously (which should not matter) |
| waypoints.c | Improvement of the missionlib implementation of the waypoint protocol, truly global waypoints are used such that they will not be relocated after you run GeoInit |
| waypoints.h | |
| bluegiga.c | Datalink implementation for the BlueGiga Bluetooth radio chip trough SPI |
| bluegiga.h | Bluegiga Bluetooth chip I/O |
| bluegiga_dl.c | |
| bluegiga_dl.h | |
| datalink.c | Handling of messages coming from ground and other A/Cs |
| datalink.h | Handling of messages coming from ground and other A/Cs |
| downlink.c | Common code for AP and FBW telemetry |
| downlink.h | Common code for AP and FBW telemetry |
| extra_pprz_dl.c | Extra datalink and telemetry using PPRZ protocol |
| extra_pprz_dl.h | Extra datalink and telemetry using PPRZ protocol |
| frsky_x.c | |
| frsky_x.h | |
| gec_dl.c | |
| gec_dl.h | Datalink using Galois Embedded Crypto |
| intermcu_dl.c | Datalink forwarder for InterMCU |
| intermcu_dl.h | Datalink forwarder for InterMCU |
| ivy_dl.c | |
| ivy_dl.h | Datalink using IVY protocol |
| mavlink.c | Basic MAVLink datalink implementation |
| mavlink.h | Basic MAVLink datalink implementation |
| mavlink_decoder.c | Simple decoder of mavlink message |
| mavlink_decoder.h | Simple decoder of mavlink message |
| pprz_dl.c | |
| pprz_dl.h | Datalink using PPRZ protocol |
| superbitrf.c | |
| superbitrf.h | |
| telemetry.c | Periodic telemetry system utility function |
| telemetry.h | Periodic telemetry system header (includes downlink utility and generated code) |
| telemetry_common.h | Common tools for periodic telemetry interface Allows subsystem to register callback functions |
| uart_print.h | |
| w5100.c | W5100 ethernet chip I/O |
| w5100.h | W5100 ethernet chip I/O |
| xbee_dl.c | |
| xbee_dl.h | Datalink using XBEE protocol |
| xtend_rssi.c | This measures the rssi pwm signal from a Digi XTend radio modem and sends a message with the info |
| xtend_rssi.h | This measures the rssi pwm signal from a Digi XTend radio modem and sends a message with the info |
| ► decawave | |
| decawave_anchorless_communication.c | |
| decawave_anchorless_communication.h | |
| dw1000_arduino.c | |
| dw1000_arduino.h | |
| ekf_range.c | |
| ekf_range.h | |
| trilateration.c | |
| trilateration.h | |
| ► demo_module | |
| demo_module.c | |
| demo_module.h | Demo module with blinking LEDs |
| ► dfu_command | |
| dfu_command.c | |
| dfu_command.h | |
| ► digital_cam | |
| ► catia | |
| catia.c | |
| chdk_pipe.c | |
| chdk_pipe.h | |
| protocol.c | |
| protocol.h | |STX|length|... payload=(length-4) bytes ...|Checksum A|Checksum B| |
| serial.c | |
| serial.h | |
| socket.c | |
| socket.h | |
| std.h | |
| atmega_i2c_cam_ctrl.c | Interface with digital camera though AVR AtMega chip |
| atmega_i2c_cam_ctrl.h | |
| dc.c | Standard Digital Camera Control Interface |
| dc.h | Standard Digital Camera Control Interface |
| dc_ctrl_parrot_mykonos.c | |
| dc_ctrl_parrot_mykonos.h | Digital video/photo recorder control for Parrot Mykonos Platform, For others that is: control the camera of the Disco and if one manages to add pimpctl onto a Bebop or Bebop2, should work also on those |
| dc_shoot_rc.c | Digital Camera remote shoot using radio channel |
| dc_shoot_rc.h | Digital Camera remote shoot using radio channel |
| gpio_cam_ctrl.c | Control the camera via GPIO pins |
| gpio_cam_ctrl.h | Digital Camera Control |
| hackhd.c | Digital video/photo recorder HackHD control |
| hackhd.h | Digital video/photo recorder HackHD control |
| pprzlink_cam_ctrl.c | |
| pprzlink_cam_ctrl.h | Digital Camera Control with PPRZLINK messages |
| servo_cam_ctrl.c | Digital Camera Control |
| servo_cam_ctrl.h | Digital Camera Control |
| sim_i2c_cam_ctrl.c | Simulated Interface with digital camera |
| uart_cam_ctrl.c | Control the camera via uart to chdk-ptp |
| uart_cam_ctrl.h | Digital Camera Control Over UART with download of thumbnails over the PAYLOAD message |
| video_cam_ctrl.c | |
| video_cam_ctrl.h | Digital Camera Control: controls triggering of an embedded digital camera on a linux based autopilot |
| ► display | |
| max7456.c | Maxim MAX7456 single-channel monochrome on-screen display driver |
| max7456.h | Maxim MAX7456 single-channel monochrome on-screen display driver |
| max7456_regs.h | Maxim MAX7456 single-channel monochrome on-screen display driver |
| ► dragspeed | |
| dragspeed.c | |
| dragspeed.h | |
| ► e_identification_fr | |
| e_identification_fr.c | |
| e_identification_fr.h | |
| ► energy | |
| bat_checker.c | Activate a buzzer/LED periodically or periodically to warn of low/critical battery level |
| bat_checker.h | |
| can_fuelcell.c | |
| can_fuelcell.h | |
| electrical.c | Implemnetation for electrical status: supply voltage, current, battery status, etc |
| electrical.h | Interface for electrical status: supply voltage, current, battery status, etc |
| MPPT.c | Solar cells MPTT monitoring |
| MPPT.h | Solar cells MPTT monitoring |
| sim_MPPT.c | |
| ► esc32 | |
| esc32.c | |
| esc32.h | |
| ► gas_engine | |
| gas_engine_idle_trim.c | |
| gas_engine_idle_trim.h | Handle idle throttle command and engine cut-off |
| ► geo_mag | |
| geo_mag.c | Calculation of the Geomagnetic field vector from current location |
| geo_mag.h | Calculation of the Geomagnetic field vector from current location |
| ► glide_wing_lock | |
| glide_wing_lock.c | |
| glide_wing_lock.h | |
| ► gpio_ext | |
| gpio_ext_common.c | |
| gpio_ext_common.h | |
| gpio_ext_pca95xx.c | |
| gpio_ext_pca95xx.h | |
| ► gps | |
| ► librtcm3 | |
| common.h | |
| CRC24Q.h | |
| rtcm3.h | |
| gps.c | Device independent GPS code |
| gps.h | Device independent GPS code (interface) |
| gps_datalink.c | GPS system based on datalink |
| gps_datalink.h | GPS system based on datalink |
| gps_furuno.c | GPS furuno based NMEA parser |
| gps_intermcu.c | GPS system based on intermcu |
| gps_intermcu.h | GPS system based on intermcu |
| gps_mtk.c | Mediatek MT3329 specific code |
| gps_mtk.h | Mediatek MT3329 specific code |
| gps_nmea.c | Basic parser for the NMEA protocol |
| gps_nmea.h | NMEA protocol specific code |
| gps_piksi.c | Driver for Piksi modules from Swift-Nav |
| gps_piksi.h | Driver for Piksi modules from Swift-Nav |
| gps_sim.c | |
| gps_sim.h | |
| gps_sim_nps.c | |
| gps_sim_nps.h | |
| gps_sirf.c | |
| gps_sirf.h | Sirf protocol specific code |
| gps_skytraq.c | |
| gps_skytraq.h | |
| gps_uavcan.c | |
| gps_uavcan.h | |
| gps_ubx.c | |
| gps_ubx.h | UBX protocol specific code |
| gps_ubx_i2c.c | Pprz link device for Ublox over I2C |
| gps_ubx_i2c.h | Pprz link device for Ublox over I2C |
| gps_ubx_ucenter.c | Configure Ublox GPS |
| gps_ubx_ucenter.h | Configure Ublox GPS |
| gps_udp.c | |
| gps_udp.h | |
| ► gsm | |
| gsm.c | |
| gsm.h | Communications through GSM |
| ► guidance | |
| ► gvf | |
| ► nav | |
| nav_ellipse.c | |
| nav_ellipse.h | |
| nav_line.c | |
| nav_line.h | |
| nav_sin.c | |
| nav_sin.h | |
| nav_survey_polygon_gvf.c | |
| nav_survey_polygon_gvf.h | |
| gvf.c | |
| gvf.h | Guidance algorithm based on vector fields |
| ► gvf_ik | |
| ► nav | |
| nav_ellipse.c | |
| nav_ellipse.h | |
| nav_line.c | |
| nav_line.h | |
| nav_sin.c | |
| nav_sin.h | |
| gvf_ik.c | |
| gvf_ik.h | |
| ► gvf_parametric | |
| ► nav | |
| nav_parametric_2d_bezier_splines.c | |
| nav_parametric_2d_bezier_splines.h | |
| nav_parametric_2d_trefoil.c | |
| nav_parametric_2d_trefoil.h | |
| nav_parametric_3d_ellipse.c | |
| nav_parametric_3d_ellipse.h | |
| nav_parametric_3d_lissajous.c | |
| nav_parametric_3d_lissajous.h | |
| gvf_parametric.cpp | Guiding vector field algorithm for 2D and 3D complex trajectories |
| gvf_parametric.h | Guiding vector field algorithm for 2D and 3D parametric trajectories |
| ► trajectories | |
| gvf_param_traj.c | |
| gvf_param_traj.h | |
| gvf_traj.c | |
| gvf_traj.h | |
| gvf_common.c | |
| gvf_common.h | |
| ► guidance_opticflow | |
| guidance_opticflow_hover.c | Optical-flow based control for Linux based systems |
| guidance_opticflow_hover.h | Optical-flow based control for Linux based systems |
| ► gumstix_interface | |
| qr_code_spi_link.c | |
| qr_code_spi_link.h | |
| ► helicopter | |
| swashplate_mixing.c | |
| swashplate_mixing.h | |
| throttle_curve.c | |
| throttle_curve.h | |
| ► hott | |
| hott.c | Graupner HOTT telemetry control module |
| hott.h | Graupner HOTT telemetry control module |
| hott_eam.h | Graupner HOTT electric air module description |
| hott_gam.h | |
| ► imu | |
| filter_1euro_imu.c | |
| filter_1euro_imu.h | |
| imu.c | Inertial Measurement Unit interface |
| imu.h | Inertial Measurement Unit interface |
| imu_ardrone2.c | IMU implementation for ardrone2 |
| imu_ardrone2.h | IMU implementation for ardrone2 |
| imu_aspirin.c | Driver for the Aspirin v1.x IMU using SPI for the accelerometer |
| imu_aspirin.h | Interface for the Aspirin v1.x IMU using SPI for the accelerometer |
| imu_aspirin_2_spi.c | Driver for the Aspirin v2.x IMU using SPI for the MPU6000 |
| imu_aspirin_2_spi.h | Driver for the Aspirin v2.x IMU using SPI for the MPU6000 |
| imu_aspirin_i2c.c | Driver for the Aspirin v1.x IMU using I2C for the accelerometer |
| imu_aspirin_i2c.h | Interface for the Aspirin v1.x IMU using I2C for the accelerometer |
| imu_bebop.c | Driver for the Bebop (2) magnetometer, accelerometer and gyroscope |
| imu_bebop.h | Interface for the Bebop magnetometer, accelerometer and gyroscope |
| imu_bmi088_i2c.c | IMU driver for the BMI088 using I2C |
| imu_bmi088_i2c.h | IMU driver for the BMI088 using I2C |
| imu_cube.c | Driver for the IMU's in the Cube autopilots |
| imu_cube.h | Driver for the IMU's in the Cube autopilots |
| imu_disco.c | Driver for the Disco magnetometer, accelerometer and gyroscope |
| imu_disco.h | Interface for the Disco magnetometer, accelerometer and gyroscope |
| imu_heater.c | IMU heater module which can actuate a resistor heater through GPIO or IOMCU |
| imu_heater.h | IMU heater module which can actuate a resistor heater through GPIO or IOMCU |
| imu_icm42688.c | Driver module for the Invensense v3 IMU ICM42688 |
| imu_icm42688.h | Driver for the IMU ICM42688 |
| imu_mpu6000.c | Driver for IMU with only MPU6000 via SPI |
| imu_mpu6000.h | Driver for IMU with only MPU6000 via SPI |
| imu_mpu6000_hmc5883.c | Driver for IMU with MPU6000 via SPI and HMC5883 via I2c |
| imu_mpu6000_hmc5883.h | Driver for IMU with MPU6000 via SPI and HMC5883 via I2c |
| imu_mpu60x0_i2c.c | Driver for IMU with only MPU60X0 via I2C |
| imu_mpu60x0_i2c.h | Driver for IMU with only MPU60x0 via I2C |
| imu_mpu9250.c | |
| imu_mpu9250.h | |
| imu_mpu9250_i2c.c | IMU driver for the MPU9250 using I2C |
| imu_mpu9250_i2c.h | IMU driver for the MPU9250 using I2C |
| imu_mpu9250_spi.c | IMU driver for the MPU9250 using SPI |
| imu_mpu9250_spi.h | IMU driver for the MPU9250 using SPI |
| imu_nps.c | |
| imu_nps.h | |
| imu_pixhawk6x.c | |
| imu_pixhawk6x.h | Driver for the IMU's in the Pixhawk 6X autopilots |
| imu_px4fmu.c | Driver for the PX4FMU SPI1 for the MPU6000 and I2C2 for the HMC5883 |
| imu_px4fmu.h | Driver for the PX4FMU SPI1 for the MPU6000 and I2C2 for the HMC5883 |
| imu_px4fmu_v2.4.c | |
| imu_px4fmu_v2.4.h | Driver for pixhawk IMU's |
| imu_vectornav.c | Vectornav VN-200 IMU module, to be used with other AHRS/INS algorithms |
| imu_vectornav.h | Vectornav VN-200 IMU module, to be used with other AHRS/INS algorithms |
| ► ins | |
| alt_filter.c | |
| alt_filter.h | |
| hf_float.c | Horizontal filter (x,y) to estimate position and velocity |
| hf_float.h | Horizontal filter (x,y) to estimate position and velocity |
| imu_temp_ctrl.c | INS temperature control on pwm 6 for Bebop2, pwm 10 for DISCO |
| imu_temp_ctrl.h | |
| imu_xsens.c | XSENS to just provide IMU measurements |
| imu_xsens.h | XSENS to just provide IMU measurements |
| ins.c | Integrated Navigation System interface |
| ins.h | Integrated Navigation System interface |
| ins_alt_float.c | Filters altitude and climb rate for fixedwings |
| ins_alt_float.h | Filters altitude and climb rate for fixedwings |
| ins_arduimu.c | |
| ins_arduimu.h | |
| ins_arduimu_basic.c | |
| ins_arduimu_basic.h | |
| ins_ekf2.cpp | INS based in the EKF2 of PX4 |
| ins_ekf2.h | INS based in the EKF2 of PX4 |
| ins_ext_pose.c | Integrated Navigation System interface |
| ins_ext_pose.h | Integrated Navigation System interface |
| ins_float_invariant.c | |
| ins_float_invariant.h | INS using invariant filter |
| ins_float_invariant_wrapper.c | Paparazzi specific wrapper to run INVARIANT filter |
| ins_float_invariant_wrapper.h | Paparazzi specific wrapper to run INVARIANT filter |
| ins_flow.c | |
| ins_flow.h | |
| ins_gps_passthrough.c | Simply converts GPS ECEF position and velocity to NED and passes it through to the state interface |
| ins_gps_passthrough.h | Simply passes GPS through to the state interface |
| ins_gps_passthrough_utm.c | Simply passes GPS UTM position and velocity through to the state interface |
| ins_int.c | INS for rotorcrafts combining vertical and horizontal filters |
| ins_int.h | INS for rotorcrafts combining vertical and horizontal filters |
| ins_mekf_wind.cpp | Multiplicative Extended Kalman Filter in rotation matrix formulation |
| ins_mekf_wind.h | Multiplicative Extended Kalman Filter in rotation matrix formulation |
| ins_mekf_wind_wrapper.c | Paparazzi specific wrapper to run MEKF-Wind INS filter |
| ins_mekf_wind_wrapper.h | Paparazzi specific wrapper to run MEKF-Wind INS filter |
| ins_module.h | Device independent INS code |
| ins_skeleton.c | Paparazzi specific wrapper to run simple module based INS |
| ins_skeleton.h | Paparazzi specific wrapper to run simple module based INS |
| ins_vectornav.c | Vectornav VN-200 INS subsystem |
| ins_vectornav.h | Vectornav VN-200 INS module |
| ins_vectornav_wrapper.c | Vectornav VN-200 INS subsystem |
| ins_vectornav_wrapper.h | Vectornav VN-200 INS subsystem |
| ins_vn100.c | |
| ins_vn100.h | Interface for the VectorNav VN100 AHRS use the binary protocal on the SPI link |
| ins_xsens.c | Xsens as a full INS solution |
| ins_xsens.h | Xsens as a full INS solution |
| ins_xsens700.c | Xsens700 as a full INS solution |
| ins_xsens700.h | Xsens700 as a full INS solution |
| vf_extended_float.c | Extended vertical filter (in float) |
| vf_extended_float.h | Interface for extended vertical filter (in float) |
| vf_float.c | Vertical filter (in float) estimating altitude, velocity and accel bias |
| vf_float.h | Vertical filter (in float) estimating altitude, velocity and accel bias |
| VN100.h | |
| xsens.c | Parser for the Xsens protocol |
| xsens.h | Parser for the Xsens protocol |
| xsens700.c | Parser for the Xsens700 protocol |
| xsens700.h | Parser for the Xsens protocol |
| xsens_parser.c | |
| xsens_parser.h | Parser for the XSens protocol |
| ► intermcu | |
| intermcu.h | Inter-MCU interface |
| intermcu_ap.c | Inter-MCU on the AP side |
| intermcu_ap.h | Inter-MCU on the AP side |
| intermcu_fbw.c | Inter-MCU on FlyByWire side |
| intermcu_fbw.h | Inter-MCU on FlyByWire side |
| iomcu.c | Driver to communicate with the ardupilot IO MCU |
| iomcu.h | Driver to communicate with the ardupilot IO MCU |
| ► joystick | |
| joystick.c | |
| joystick.h | |
| ► lidar | |
| ► slam | |
| lidar_correction.c | |
| lidar_correction.h | |
| servo_lidar.c | Driver for the servo to move the lidar |
| servo_lidar.h | Driver for the servo to move the lidar |
| lidar_lite.c | Driver for the Lidar-Lite i2c lidar version 1 (silver label) |
| lidar_lite.h | Driver for the Lidar-Lite i2c lidar |
| lidar_sf11.c | |
| lidar_sf11.h | Driver for the Parallax SF11-A/B/C Laser Rangefinder connected over i2c bus |
| tfmini.c | Driver for the TFMini lidar |
| tfmini.h | Driver for the TFMini lidar |
| tfmini_i2c.c | |
| tfmini_i2c.h | Driver for the TFMini ranging device when used via I2C bus |
| tfmini_nps.c | Simulation of a lidar |
| vl53l5cx_platform.h | |
| ► light | |
| led_safety_status.c | Simple module to blink LEDs when battery voltage drops below a certain level, radio control is lost or when takeoff safety conditions are not met |
| led_safety_status.h | Simple module to blink LEDs when battery voltage drops below a certain level, radio control is lost or when takeoff safety conditions are not met |
| light.c | |
| light.h | |
| light_scheduler.c | Basic LED scheduler based on WS2812 RGB led driver |
| light_scheduler.h | Basic LED scheduler based on WS2812 RGB led driver |
| ► loggers | |
| ► sdlog_chibios | |
| msg_queue.c | |
| msg_queue.h | |
| printf.c | |
| printf.h | Mini printf-like functionality |
| sdLog.c | |
| sdLog.h | |
| usb_msd.c | |
| usb_msd.h | |
| usbStorage.c | |
| usbStorage.h | |
| direct_memory_logger.c | Write logs directly to flash memory chips |
| direct_memory_logger.h | Write logs directly to flash memory chips |
| flight_recorder.c | |
| flight_recorder.h | |
| high_speed_logger_direct_memory.c | |
| high_speed_logger_direct_memory.h | |
| high_speed_logger_spi_link.c | |
| high_speed_logger_spi_link.h | |
| logger_control_effectiveness.c | Log data required to compute control effectiveness |
| logger_control_effectiveness.h | Log data required to compute control effectiveness |
| logger_file.c | File logger for Linux based autopilots |
| logger_file.h | File logger for Linux based autopilots |
| logger_uart.c | |
| logger_uart.h | |
| logger_uart_parse.py | |
| openlog.c | This module provides a timestamp-message, allowing sw/logalizer/openlog2tlm to convert a recorded dumpfile, created by openlog into the pprz-tlm format, to be converted into .data and .log files by sw/logalizer/sd2log |
| openlog.h | This module provides a timestamp-message, allowing sw/logalizer/openlog2tlm to convert a recorded dumpfile, created by openlog into the pprz-tlm format, to be converted into .data and .log files by sw/logalizer/sd2log |
| pprzlog_tp.c | Initialize pprzlog transport |
| pprzlog_tp.h | Initialize pprzlog transport |
| sdlog_chibios.c | |
| sdlog_chibios.h | |
| sdlogger_spi_direct.c | |
| sdlogger_spi_direct.h | |
| ► mav_course_exercise | |
| mav_exercise.c | |
| mav_exercise.h | |
| ► meteo | |
| ► lib_ukf_wind_estimator | |
| rtwtypes.h | |
| UKF_Wind_Estimator.c | |
| UKF_Wind_Estimator.h | |
| charge_sens.c | I2C interface for University of Reading charge sensor |
| charge_sens.h | |
| cloud_sensor.c | Get data from Cloud Sensor |
| cloud_sensor.h | Get data from Cloud Sensor |
| cloud_sim.c | |
| cloud_sim.h | |
| dust_gp2y.c | Sharp GP2Y1010AU dust sensor interface |
| dust_gp2y.h | |
| ekf_aw.cpp | |
| ekf_aw.h | |
| ekf_aw_wrapper.c | |
| ekf_aw_wrapper.h | |
| geiger_counter.c | I2C interface for University of Reading Geiger counter |
| geiger_counter.h | |
| humid_dpicco.c | DigiPicco I2C sensor interface |
| humid_dpicco.h | DigiPicco I2C sensor interface |
| humid_hih.c | Honeywell HIH-4030 sensor interface |
| humid_hih.h | |
| humid_htm_b71.c | TronSens HTM-B71 humidity/temperature sensor i2c interface |
| humid_htm_b71.h | |
| humid_pcap01.c | ACAM Picocap Single-chip Solution for Capacitance Measurement |
| humid_pcap01.h | ACAM Picocap Single-chip Solution for Capacitance Measurement |
| humid_sht.c | SHTxx sensor interface |
| humid_sht.h | SHTxx sensor interface |
| humid_sht_i2c.c | Sensirion SHT25 humidity/temperature sensor interface |
| humid_sht_i2c.h | |
| humid_sht_uart.c | SHTxx sensor interface |
| humid_sht_uart.h | SHTxx sensor interface |
| ir_mlx.c | Melexis MLX90614 I2C |
| ir_mlx.h | |
| light_solar.c | University of Reading solar radiation sensor interface |
| light_solar.h | |
| light_temt.c | Vishay TEMT6000 ambient light sensor interface |
| light_temt.h | |
| meteo_france_DAQ.c | Communication module with the Data Acquisition board from Meteo France |
| meteo_france_DAQ.h | Communication module with the Data Acquisition board from Meteo France |
| meteo_stick.c | |
| meteo_stick.h | Data acquisition module for ENAC PTU board |
| meteo_stick_calib.c | Parser for calibration data coming from 25AA256 EEPROM of the Meteo Stick |
| meteo_stick_calib.h | Parser for calibration data coming from 25AA256 EEPROM of the Meteo Stick |
| mf_ptu.c | |
| mf_ptu.h | |
| temp_lm75.c | National LM75 I2C sensor interface |
| temp_lm75.h | |
| temp_tcouple_adc.c | Universitaet Tuebingen thermocouple interface |
| temp_tcouple_adc.h | |
| temp_temod.c | Hygrosens TEMOD-I2C-Rx temperature sensor interface for PT1000 e.g |
| temp_temod.h | |
| temp_tmp102.c | TI TMP102 I2C sensor interface |
| temp_tmp102.h | |
| wind_estimation_quadrotor.c | |
| wind_estimation_quadrotor.h | |
| wind_estimator.c | Original Simulink files available at https://github.com/enacuavlab/UKF_Wind_Estimation |
| wind_estimator.h | Wind Estimator based on generated library from Matlab |
| wind_gfi.c | GFI wind speed/direction sensor interface |
| wind_gfi.h | |
| windturbine.c | This measures a trigger pulse length (e.g |
| windturbine.h | This measures a trigger pulse length (e.g |
| ► mission | |
| copilot.h | Mission Computer module, interfacing the mission computer (also known as Copilot), based losely on ISaAC: The Intelligent Safety and Airworthiness Co-Pilot module Based on paper "A Payload Verification and Management Framework for Small UAV-based Personal Remote Sensing Systems" by Cal Coopmans and Chris Coffin |
| copilot_common.c | Mission Computer module, interfacing the mission computer (also known as Copilot), based losely on ISaAC: The Intelligent Safety and Airworthiness Co-Pilot module Based on paper "A Payload Verification and Management Framework for Small UAV-based Personal Remote Sensing Systems" by Cal Coopmans and Chris Coffin |
| copilot_fixedwing.c | Mission Computer module, interfacing the mission computer (also known as Copilot), based losely on ISaAC: The Intelligent Safety and Airworthiness Co-Pilot module Based on paper "A Payload Verification and Management Framework for Small UAV-based Personal Remote Sensing Systems" by Cal Coopmans and Chris Coffin |
| copilot_rotorcraft.c | Mission Computer module, interfacing the mission computer (also known as Copilot), based losely on ISaAC: The Intelligent Safety and Airworthiness Co-Pilot module Based on paper "A Payload Verification and Management Framework for Small UAV-based Personal Remote Sensing Systems" by Cal Coopmans and Chris Coffin |
| mission_common.c | Messages parser for mission interface |
| mission_common.h | Mission planner library |
| mission_fw_nav.c | Mission navigation for fixedwing aircraft |
| mission_rotorcraft_nav.c | Mission navigation for rotorcrafts |
| mission_rover_nav.c | Mission navigation for rovers |
| ► multi | |
| ► ctc | |
| ctc.c | |
| ctc.h | Collective Tracking Control |
| ctc_target.c | |
| ctc_target.h | Collective Tracking Control (module for the target to be tracked) |
| ► dcf | |
| dcf.c | |
| dcf.h | Distributed circular formation algorithm |
| ► fc_rotor | |
| fc_rotor.c | |
| fc_rotor.h | Formation control algorithm for rotorcrafts |
| drop_zone.c | Drop zone |
| drop_zone.h | Drop zone |
| follow.c | Follow a certain AC ID |
| follow.h | Follow a certain AC id |
| formation.c | Library for formation flight |
| formation.h | Formation flight library |
| potential.c | |
| potential.h | Flying with potential field to avoid collision |
| rssi.c | |
| rssi.h | |
| tcas.c | Collision avoidance library |
| tcas.h | Collision avoidance library |
| traffic_info.c | |
| traffic_info.h | |
| ► nav | |
| ballistic_touchdown.c | |
| ballistic_touchdown.h | |
| common_flight_plan.c | Common flight_plan functions shared between fixedwing and rotorcraft |
| common_flight_plan.h | Common flight_plan functions shared between fixedwing and rotorcraft |
| common_nav.c | |
| common_nav.h | |
| ground_detect.c | Ground detection module |
| ground_detect.h | |
| nav_airspeed.c | |
| nav_airspeed.h | NAV Tunable standard airspeed settings to be called from the flight plan |
| nav_base.h | |
| nav_bungee_takeoff.c | Takeoff functions for bungee takeoff |
| nav_bungee_takeoff.h | Takeoff functions for bungee takeoff |
| nav_catapult.c | |
| nav_catapult.h | Catapult launch timing system |
| nav_cube.c | Fixedwing Navigation in a cube towards a center |
| nav_cube.h | Fixedwing Navigation in a cube towards a center |
| nav_drop.c | Navigation module to drop a ball at a given point taking into account the wind and ground speed |
| nav_drop.h | Navigation module to drop a ball at a given point taking into account the wind and ground speed |
| nav_fish.c | |
| nav_fish.h | |
| nav_flower.c | From OSAM advanced navigation routines |
| nav_flower.h | |
| nav_geofence.h | Optional exceptions triggeringg HOME_MODE 1) GEOFENCE_DATALINK_LOST_TIME: go to HOME mode if datalink lost for GEOFENCE_DATALINK_LOST_TIME 2) GEOFENCE_MAX_ALTITUDE: go HOME if airplane higher than the max altitude 3) GEOFENCE_MAX_HEIGHT: go HOME if airplane higher than the max height |
| nav_gls.c | Gps landing system |
| nav_gls.h | Gps landing system |
| nav_heli_spinup.c | |
| nav_heli_spinup.h | |
| nav_lace.c | |
| nav_lace.h | Adaptive border pattern for cloud exploration Can be used in mission mode with custom pattern and ID "LACE" |
| nav_launcher.c | Pneumatic launcher system See video of the system: https://www.youtube.com/watch?v=qc1uwH-8Dbw Launcher |
| nav_launcher.h | Pneumatic launcher system See video of the system: https://www.youtube.com/watch?v=qc1uwH-8Dbw Launcher |
| nav_line.c | Fixedwing navigation along a line with nice U-turns |
| nav_line.h | Fixedwing navigation along a line with nice U-turns |
| nav_line_border.c | Navigate along a border line (line 1-2) with turns in the same direction |
| nav_line_border.h | Navigate along a border line (line 1-2) with turns in the same direction |
| nav_line_osam.c | Flight line from OSAM advanced navigation routines |
| nav_line_osam.h | |
| nav_poles.c | |
| nav_poles.h | |
| nav_poles_rotorcraft.c | Turn around 2 points, with possible margins Can be used in mission mode |
| nav_poles_rotorcraft.h | Turn around 2 points, with possible margins Can be used in mission mode |
| nav_rosette.c | Adaptive flower pattern for cloud exploration |
| nav_rosette.h | Adaptive flower pattern for cloud exploration Can be used in mission mode with custom pattern and ID "RSTT" |
| nav_rotorcraft_base.c | |
| nav_rotorcraft_base.h | |
| nav_rotorcraft_hybrid.c | Specific navigation functions for hybrid aircraft |
| nav_rotorcraft_hybrid.h | Specific navigation functions for hybrid aircraft |
| nav_rover_base.c | |
| nav_rover_base.h | |
| nav_shakestart.c | |
| nav_shakestart.h | |
| nav_skid_landing.c | Landing on skidpads See video of the landing: https://www.youtube.com/watch?v=aYrB7s3oeX4 Standard landing procedure: 1) circle down passing AF waypoint (from left or right) 2) once low enough follow line to TD waypoint 3) once low enough flare |
| nav_skid_landing.h | Landing on skidpads See video of the landing: https://www.youtube.com/watch?v=aYrB7s3oeX4 Standard landing procedure: 1) circle down passing AF waypoint (from left or right) 2) once low enough follow line to TD waypoint 3) once low enough flare |
| nav_smooth.c | Smooth navigation to wp_a along an arc (around wp_cd), a segment (from wp_rd to wp_ta) and a second arc (around wp_ca) |
| nav_smooth.h | Smooth navigation to wp_a along an arc (around wp_cd), a segment (from wp_rd to wp_ta) and a second arc (around wp_ca) |
| nav_spiral.c | Fixedwing navigation in a spiral/helix |
| nav_spiral.h | Fixedwing navigation in a spiral/helix |
| nav_spiral_3D.c | Fixedwing navigation in a 3D spiral |
| nav_spiral_3D.h | Fixedwing navigation in a 3D spiral |
| nav_survey_disc.c | |
| nav_survey_disc.h | |
| nav_survey_hybrid.c | This routine will cover the enitre area of any Polygon defined in the flightplan which is a convex polygon |
| nav_survey_hybrid.h | |
| nav_survey_poly_osam.c | |
| nav_survey_poly_osam.h | |
| nav_survey_poly_rotorcraft.c | |
| nav_survey_poly_rotorcraft.h | |
| nav_survey_polygon.c | Advanced polygon survey for fixedwings from Uni Stuttgart |
| nav_survey_polygon.h | Advanced polygon survey for fixedwings from Uni Stuttgart |
| nav_survey_rectangle.c | Automatic survey of a rectangle for fixedwings |
| nav_survey_rectangle.h | |
| nav_survey_rectangle_rotorcraft.c | Automatic survey of a rectangle for rotorcraft |
| nav_survey_rectangle_rotorcraft.h | Automatic survey of a rectangle for rotorcraft |
| nav_survey_zamboni.c | Zamboni pattern survey for fixedwings |
| nav_survey_zamboni.h | Zamboni pattern survey for fixedwings |
| nav_takeoff_and_landing.h | |
| nav_takeoff_and_landing_fw.c | |
| nav_takeoff_and_landing_rotorcraft.c | |
| nav_trinity.c | |
| nav_trinity.h | |
| nav_vertical_raster.c | From OSAM advanced navigation routines |
| nav_vertical_raster.h | |
| takeoff_detect.c | Automatic takeoff assistance for fixed-wing |
| takeoff_detect.h | Automatic takeoff assistance for fixed-wing |
| waypoints.c | |
| waypoints.h | |
| ► obstacle_avoidance | |
| guidance_OA.c | Guidance for the obstacle avoidance methods |
| guidance_OA.h | Guidance for the obstacle avoidance methods |
| obstacle_avoidance.c | Obstacle avoidance methods |
| obstacle_avoidance.h | Obstacle avoidance methods |
| ► optical_flow | |
| mateksys_3901_l0x.c | |
| mateksys_3901_l0x.h | Driver for the mateksys_3901_l0x sensor via MSP protocol output |
| px4flow.c | Driver for the optical flow sensor PX4FLOW |
| px4flow.h | Driver for the optical flow sensor PX4FLOW |
| px4flow_i2c.c | |
| px4flow_i2c.h | |
| ► orange_avoider | |
| orange_avoider.c | |
| orange_avoider.h | |
| orange_avoider_guided.c | |
| orange_avoider_guided.h | |
| ► pano_unwrap | |
| pano_unwrap.c | |
| pano_unwrap.h | |
| ► pca9685 | |
| pca9685_i2c.c | |
| pca9685_i2c.h | |
| ► pose_history | |
| pose_history.c | |
| pose_history.h | |
| ► px4_flash | |
| protocol.h | PX4IO interface protocol |
| px4_flash.c | |
| px4_flash.h | |
| ► px4_gimbal | |
| px4_gimbal.c | |
| px4_gimbal.h | |
| ► radio_control | |
| ► cc2500_frsky | |
| cc2500_common.c | |
| cc2500_common.h | |
| cc2500_compat.c | |
| cc2500_compat.h | |
| cc2500_frsky_common.h | |
| cc2500_frsky_d.h | |
| cc2500_frsky_shared.c | |
| cc2500_frsky_shared.h | |
| cc2500_frsky_x.c | |
| cc2500_frsky_x.h | |
| cc2500_paparazzi.c | |
| cc2500_paparazzi.h | |
| cc2500_rx.c | |
| cc2500_rx.h | |
| cc2500_rx_spi.c | |
| cc2500_rx_spi.h | |
| cc2500_rx_spi_common.c | |
| cc2500_rx_spi_common.h | |
| cc2500_settings.c | |
| cc2500_settings.h | |
| cc2500_smartport.c | |
| cc2500_smartport.h | |
| hott.c | Single HOTT radio_control SUMD |
| hott.h | Radio control via single HOTT receiver in SUMD mode |
| hott_common.c | Graupner HOTT SUMD decoder |
| hott_common.h | |
| ppm.c | Architecture independent functions for PPM radio control |
| ppm.h | |
| radio_control.c | |
| radio_control.h | Generic interface for radio control modules |
| rc_datalink.c | Radio control input via datalink |
| rc_datalink.h | Radio control input via datalink |
| rc_intermcu.c | Radio control input via intermcu |
| rc_intermcu.h | Radio control input via intermcu |
| sbus.c | Single SBUS radio_control |
| sbus.h | Radio control via single SBUS receiver |
| sbus_common.c | Futaba SBUS decoder |
| sbus_common.h | Common sbus structs and defines |
| sbus_dual.c | Dual SBUS radio_control |
| sbus_dual.h | Radio control via two SBUS receivers |
| spektrum.c | Spektrum sattelite receiver implementation |
| spektrum.h | Radio control spektrum interface |
| spektrum_radio.h | Radio control channels defaults, because they are digital |
| superbitrf_rc.c | DSM2 and DSMX radio control implementation for the cyrf6936 2.4GHz radio chip trough SPI |
| superbitrf_rc.h | DSM2 and DSMX radio control implementation for the cyrf6936 2.4GHz radio chip trough SPI |
| ► range_finder | |
| cf_deck_multi_ranger.c | |
| cf_deck_multi_ranger.h | |
| laser_range_array.c | |
| laser_range_array.h | |
| teraranger_one.c | |
| teraranger_one.h | |
| ► range_forcefield | |
| range_forcefield.c | |
| range_forcefield.h | |
| ► relative_localization_filter | |
| discrete_ekf.c | |
| discrete_ekf.h | |
| discrete_ekf_no_north.c | |
| discrete_ekf_no_north.h | |
| relative_localization_filter.c | |
| relative_localization_filter.h | |
| ► rotwing_drone | |
| rotwing_state.c | |
| rotwing_state.h | |
| wing_rotation_adc_sensor.c | |
| wing_rotation_adc_sensor.h | |
| ► rust | |
| ► demo_module | |
| rust_demo_module.h | |
| ► safety | |
| parachute.c | |
| parachute.h | |
| ► sensors | |
| ► cameras | |
| jevois.c | |
| jevois.h | |
| jevois_mavlink.c | |
| jevois_mavlink.h | |
| airspeed_adc.c | Read an airspeed or differential pressure sensor via onboard ADC |
| airspeed_adc.h | Read an airspeed or differential pressure sensor via onboard ADC |
| airspeed_ads1114.c | |
| airspeed_ads1114.h | |
| airspeed_amsys.c | |
| airspeed_amsys.h | |
| airspeed_ets.c | Driver for the EagleTree Systems Airspeed Sensor v3 connected via an I2C port |
| airspeed_ets.h | Driver for the EagleTree Systems Airspeed Sensor |
| airspeed_ms45xx_i2c.c | Airspeed sensor module using the MS45xxDO digital pressure sensor via I2C |
| airspeed_ms45xx_i2c.h | Airspeed driver for the MS45xx pressure sensor via I2C |
| airspeed_otf.c | UART interface for Aeroprobe On-The-Fly! air data computer |
| airspeed_otf.h | |
| airspeed_sdp3x.c | Airspeed driver for the SDP3X pressure sensor via I2C |
| airspeed_sdp3x.h | Airspeed driver for the SDP3X pressure sensor via I2C |
| airspeed_uADC.c | UART interface for Aeroprobe uADC air data computer |
| airspeed_uADC.h | UART interface for Aeroprobe uADC air data computer |
| airspeed_uavcan.c | Airspeed sensor on the uavcan bus |
| airspeed_uavcan.h | Airspeed sensor on the uavcan bus |
| alt_srf08.c | Basic library for SRF08 telemeter |
| alt_srf08.h | Basic library for SRF08 telemeter |
| aoa_adc.c | Angle of Attack sensor on ADC Autor: Bruzzlee |
| aoa_adc.h | |
| aoa_pwm.c | Angle of Attack sensor on PWM |
| aoa_pwm.h | Angle of Attack sensor on PWM |
| aoa_t4.c | Angle of Attack sensor using T4 Actuators Board and a modified serial bus servo added wind vane |
| aoa_t4.h | Angle of Attack and optionally Sideslip Angle sensor using T4 Actuators Board and a modified serial bus servo The servo as AOA sensor must be of hall effect type and have motor and gears removed to minimize friction and this solution to work |
| baro.h | Common barometric sensor implementation |
| baro_amsys.c | |
| baro_amsys.h | |
| baro_bmp.c | Bosch BMP085 I2C sensor interface |
| baro_bmp.h | Bosch BMP085 I2C sensor interface |
| baro_bmp280.c | Bosch BMP280 sensor interface |
| baro_bmp280.h | Bosch BMP280 sensor interface |
| baro_bmp3.c | Bosch BMP3 I2C sensor interface |
| baro_bmp3.h | Bosch BMP3 I2C sensor interface |
| baro_board_common.c | General interface for board integrated barometers |
| baro_board_common.h | General interface for board integrated barometers |
| baro_ets.c | Driver for the EagleTree Systems Altitude Sensor |
| baro_ets.h | Driver for the EagleTree Systems Altitude Sensor |
| baro_hca.c | |
| baro_hca.h | |
| baro_mpl3115.c | Module for the baro MPL3115A2 from Freescale (i2c) |
| baro_mpl3115.h | Module for the baro MPL3115A2 from Freescale (i2c) |
| baro_MS5534A.c | Handling of the MS5534a pressure sensor |
| baro_MS5534A.h | Handling of the MS5534a pressure sensor |
| baro_ms5611_i2c.c | Measurement Specialties (Intersema) MS5611-01BA pressure/temperature sensor interface for I2C |
| baro_ms5611_i2c.h | |
| baro_ms5611_spi.c | Measurement Specialties (Intersema) MS5611-01BA pressure/temperature sensor interface for SPI |
| baro_ms5611_spi.h | Measurement Specialties (Intersema) MS5611-01BA pressure/temperature sensor interface for SPI |
| baro_scp_i2c.c | VTI SCP1000 I2C sensor interface |
| baro_scp_i2c.h | |
| baro_sim.c | Simulate barometer pressure measurement using gps.hmsl |
| baro_sim.h | Simulate barometer pressure measurement using gps.hmsl |
| bat_voltage_ardrone2.c | Read battery voltage on ARDrone2 and publish to electrical subsystem |
| bat_voltage_ardrone2.h | |
| encoder_amt22.c | |
| encoder_amt22.h | |
| ezcurrent.c | Copyright (C) 2012 Gerard Toonstra |
| ezcurrent.h | |
| generic_uart.c | |
| generic_uart.h | |
| mag_hmc5843.c | |
| mag_hmc5843.h | |
| mag_hmc58xx.c | Module wrapper for Honeywell HMC5843 and HMC5883 magnetometers |
| mag_hmc58xx.h | Module wrapper for Honeywell HMC5843 and HMC5883 magnetometers |
| mag_ist8310.c | Module wrapper for Isentek IST8310 magnetometers |
| mag_ist8310.h | Module wrapper for Isentek IST8310 magnetometers |
| mag_lis3mdl.c | Module wrapper for ST LIS3MDL magnetometers |
| mag_lis3mdl.h | Module wrapper for ST LIS3MDL magnetometers |
| mag_pitot_uart.c | |
| mag_pitot_uart.h | |
| mag_qmc5883l.c | Module for QST QMC5883L magnetometer, the DB version |
| mag_qmc5883l.h | Module wrapper for QNI QMC5883L magnetometer |
| mag_rm3100.c | Module wrapper for PNI RM3100 magnetometers |
| mag_rm3100.h | Module wrapper for PNI RM3100 magnetometers |
| mag_uavcan.c | |
| mag_uavcan.h | |
| met_module.h | Device independent serial meteo code |
| opticflow_pmw3901.c | |
| opticflow_pmw3901.h | |
| power_uavcan.c | Power sensors on the uavcan bus |
| power_uavcan.h | Power sensors on the uavcan bus |
| range_sensor_uavcan.c | Range sensor on the uavcan bus |
| range_sensor_uavcan.h | Range sensor sensor on the uavcan bus |
| rpm_sensor.c | |
| rpm_sensor.h | |
| sensors_hitl.c | |
| sensors_hitl.h | |
| temp_adc.c | Temperature sensor module for LM35 or NTC (10k / 100k) sensor via analog input |
| temp_adc.h | Temperature driver for LM35 and 100k NTC analog sensores |
| thd_test.c | |
| thd_test.h | |
| ► servo_tester | |
| servo_tester.c | Module that has a setting to change the input to a servo Call the servo that you want to test SERVO_TEST, and don't use it with the command laws |
| servo_tester.h | Module useful for testing a servo and finding the response |
| ► sonar | |
| agl_dist.c | |
| agl_dist.h | Bind to agl ABI message and provide a filtered value to be used in flight plans |
| sonar_adc.c | |
| sonar_adc.h | Driver for an sonar rangfinder sensor when used via an ADC channel |
| sonar_bebop.c | Parrot Bebop Sonar driver |
| sonar_bebop.h | Parrot Bebop Sonar driver |
| sonar_i2c.c | |
| sonar_i2c.h | Driver for an sonar rangfinder sensor when used via I2C bus |
| sonar_pwm.c | |
| sonar_pwm.h | |
| sonar_vl53l1x.c | |
| sonar_vl53l1x.h | |
| ► spektrum_soft_bind | |
| spektrum_soft_bind.c | |
| spektrum_soft_bind.h | |
| spektrum_soft_bind_ap.c | |
| spektrum_soft_bind_ap.h | |
| spektrum_soft_bind_fbw.c | |
| spektrum_soft_bind_fbw.h | |
| ► stereocam | |
| ► droplet | |
| stereocam_droplet.c | |
| stereocam_droplet.h | |
| ► nav_line_avoid | |
| avoid_navigation.c | |
| avoid_navigation.h | |
| stereo_avoid.c | Parse avoidance messages from stereocamera to use obstacle results in navigation |
| stereo_avoid.h | |
| stereo_avoid_sim.c | |
| ► stereocam_follow_me | |
| follow_me.c | |
| follow_me.h | |
| stereocam.c | Interface to TU Delft serial stereocam Include stereocam.xml to your airframe file |
| stereocam.h | Interface to the TU Delft serial stereocam |
| ► switching | |
| auto1_commands.c | |
| auto1_commands.h | Enable AUTO1 commands flaps and hatch from RC |
| switch_servo.c | |
| switch_servo.h | |
| switch_uart.c | |
| switch_uart.h | |
| ► system_identification | |
| pprz_chirp.c | |
| pprz_chirp.h | |
| pprz_doublet.c | |
| pprz_doublet.h | |
| pprz_wave.c | |
| pprz_wave.h | |
| sys_id_auto_doublets.c | |
| sys_id_auto_doublets.h | |
| sys_id_chirp.c | |
| sys_id_chirp.h | |
| sys_id_doublet.c | |
| sys_id_doublet.h | |
| sys_id_wave.c | |
| sys_id_wave.h | |
| ► time | |
| time_countdown.c | Count down remaining time |
| time_countdown.h | Count down remaining time |
| ► tlsf | |
| tlsf_malloc.h | Dynamic memory allocation based on TLSF library |
| ► uav_recovery | |
| uav_recovery.c | |
| uav_recovery.h | |
| ► wedgebug | |
| wedgebug.c | |
| wedgebug.h | |
| wedgebug_opencv.cpp | |
| wedgebug_opencv.h | |
| ► peripherals | |
| ads1114.c | |
| ads1114.h | |
| ads1220.c | Driver for the ADS1220 24-bits ADC from TI SPI communication |
| ads1220.h | Driver for the ADS1220 24-bits ADC from TI SPI communication |
| adxl345.h | Analog Devices ADXL345 accelerometer driver common interface (I2C and SPI) |
| adxl345_i2c.c | Driver for ADXL345 accelerometer using I2C |
| adxl345_i2c.h | Driver for the accelerometer ADXL345 from Analog Devices using I2C |
| adxl345_regs.h | Register and address definitions for ADXL345 accelerometer |
| adxl345_spi.c | Driver for the accelerometer ADXL345 from Analog Devices using SPI |
| adxl345_spi.h | Driver for the accelerometer ADXL345 from Analog Devices using SPI |
| ak8963.c | Driver for the AKM AK8963 magnetometer |
| ak8963.h | Register and address definitions for AK8963 magnetometer |
| ak8963_regs.h | |
| ak8975.c | Driver for the AKM AK8975 magnetometer |
| ak8975.h | Driver for the AKM AK8975 magnetometer |
| ami601.c | |
| ami601.h | |
| amt22.c | |
| amt22.h | |
| bmi088.c | BMI088 driver common functions (I2C and SPI) |
| bmi088.h | BMI088 driver common interface (I2C and SPI) |
| bmi088_i2c.c | Driver for the BMI088 using I2C |
| bmi088_i2c.h | Driver for the BMI088 using I2C |
| bmi088_regs.h | Register and address definitions for BMI088 |
| bmp085.c | Bosch BMP085 driver interface |
| bmp085.h | Bosch BMP085 driver interface |
| bmp085_regs.h | Bosch BMP085 register definitions |
| bmp280.c | Sensor driver for BMP280 sensor |
| bmp280.h | Sensor driver for BMP280 sensor |
| bmp280_regs.h | |
| bmp3_i2c.c | Sensor driver for BMP3 sensor via I2C |
| bmp3_i2c.h | Sensor driver for BMP3 sensor via I2C |
| bmp3_regs.h | Sensor driver for BMP280 sensor register definition |
| cc2500.c | |
| cc2500.h | |
| cyrf6936.c | Driver for the cyrf6936 2.4GHz radio chip |
| cyrf6936.h | Driver for the cyrf6936 2.4GHz radio chip |
| cyrf6936_regs.h | Register defines for the CYRF6936 2.4GHz radio chip |
| eeprom25AA256.c | |
| eeprom25AA256.h | Driver for the eeprom 225AA256 (and 25LC256) 256K SPI bus serial EEPROM from Microchip |
| hmc5843.c | |
| hmc5843.h | |
| hmc58xx.c | Driver for Honeywell HMC5843, HMC5883 and HMC5983 magnetometers |
| hmc58xx.h | |
| hmc58xx_regs.h | Register defs for Honeywell HMC5843, HMC5883 and HMC5983 magnetometers |
| invensense2.c | Driver for the Invensense V2 IMUs ICM20948, ICM20648 and ICM20649 |
| invensense2.h | Driver for the Invensense V2 IMUs ICM20948, ICM20648 and ICM20649 |
| invensense2_regs.h | Register and address definitions for the Invensense V2 from ardupilot |
| invensense3.c | Driver for the Invensense v3 IMUs ICM40605, ICM40609, ICM42605, IIM42652 and ICM42688 |
| invensense3.h | Driver for the Invensense V3 IMUs ICM40605, ICM40609, ICM42605, IIM42652 and ICM42688 |
| invensense3_456.c | Driver for the Invensense 456XY IMUs: |
| invensense3_456.h | Driver for the Invensense 456XY IMUs: |
| invensense3_456_regs.h | Register and address definitions for the Invensense V3 ICM456xy sensors from ardupilot |
| invensense3_regs.h | Register and address definitions for the Invensense V3 from ardupilot |
| ist8310.c | Driver for the Isentek IST8310 magnetometer |
| ist8310.h | |
| ist8310_regs.h | Register and address definitions for the IST8310 magnetometer |
| itg3200.c | Driver for ITG3200 |
| itg3200.h | Driver for the gyro ITG3200 from InvenSense |
| itg3200_regs.h | Register defs for ITG3200 and IMU3000 gyros |
| l3g4200.c | Driver for L3G4200 from ST |
| l3g4200.h | Driver for the gyro L3G4200 From ST |
| l3g4200_regs.h | Register defs for L3G4200 gyros |
| l3gd20.h | ST L3GD20 3-axis gyroscope driver common interface (I2C and SPI) |
| l3gd20_regs.h | ST L3GD20 3-axis gyroscope register definitions |
| l3gd20_spi.c | Driver for L3GD20 3-axis gyroscope from ST using SPI |
| l3gd20_spi.h | Driver for L3GD20 3-axis gyroscope from ST using SPI |
| lis302dl.h | ST LIS302DL 3-axis accelerometer driver common interface (I2C and SPI) |
| lis302dl_regs.h | ST LIS302DL 3-axis accelerometer register definitions |
| lis302dl_spi.c | Driver for LIS302DL 3-axis accelerometer from ST using SPI |
| lis302dl_spi.h | Driver for LIS302DL 3-axis accelerometer from ST using SPI |
| lis3mdl.c | ST LIS3MDL 3-axis magnetometer driver interface (I2C) |
| lis3mdl.h | ST LIS3MDL 3-axis magnetometer driver interface (I2C) |
| lps25h.h | LPS25H barometer driver interface |
| lps25h_i2c.c | Driver for LPS25H barometer I2C |
| lps25h_i2c.h | I2C interface for LPS25H barometer |
| lps25h_regs.h | |
| lsm303d.h | Driver for ST LSM303D 3D accelerometer and magnetometer |
| lsm303d_regs.h | Register defs for ST LSM303D 3D accelerometer and magnetometer |
| lsm303d_spi.c | Driver for ST LSM303D 3D accelerometer and magnetometer |
| lsm303d_spi.h | Driver for ST LSM303D 3D accelerometer and magnetometer |
| lsm303dlhc.h | Driver for ST LSM303DLHC 3D accelerometer and magnetometer |
| lsm303dlhc_i2c.c | Driver for ST LSM303DLHC 3D accelerometer and magnetometer |
| lsm303dlhc_i2c.h | |
| lsm303dlhc_regs.h | Register defs for ST LSM303DLHC 3D accelerometer and magnetometer |
| lsm6ds33.h | LSM6DS33 accelerometer and gyrometer driver I2C interface |
| lsm6ds33_i2c.c | Driver for LSM6DS33 accelerometer and gyrometer using I2C |
| lsm6ds33_i2c.h | Driver for the accelerometer and gyrometer LSM6DS33 |
| lsm6ds33_regs.h | Register defs for ST LSM6DS33 3D accelerometer and gyroscope |
| max1168.c | |
| max1168.h | |
| mcp355x.c | Driver for MCP3550/1/3 |
| mcp355x.h | |
| mpl3115.c | Driver for MPL3115A2 baro sensor |
| mpl3115.h | Driver for the baro MPL3115A2 from Freescale (i2c) |
| mpu60x0.c | MPU-60X0 driver common functions (I2C and SPI) |
| mpu60x0.h | MPU-60X0 driver common interface (I2C and SPI) |
| mpu60x0_i2c.c | Driver for the MPU-60X0 using I2C |
| mpu60x0_i2c.h | Driver for the MPU-60X0 using I2C |
| mpu60x0_regs.h | Register and address definitions for MPU-6000 and MPU-6050 |
| mpu60x0_spi.c | Driver for the MPU-60X0 using SPI |
| mpu60x0_spi.h | Driver for the MPU-60X0 using SPI |
| mpu9250.c | MPU-9250 driver common functions (I2C and SPI) |
| mpu9250.h | MPU-60X0 driver common interface (I2C and SPI) |
| mpu9250_i2c.c | Driver for the MPU-9250 using I2C |
| mpu9250_i2c.h | Driver for the MPU-9250 using I2C |
| mpu9250_regs.h | Register and address definitions for MPU-9250 |
| mpu9250_spi.c | Driver for the MPU-9250 using SPI |
| mpu9250_spi.h | Driver for the MPU-9250 using SPI |
| ms2100.c | Driver for the ms2100 magnetic sensor from PNI |
| ms2100.h | Driver for the ms2100 magnetic sensor from PNI |
| ms5611.c | MS5611 and MS5607 barometer driver common functions (I2C and SPI) |
| ms5611.h | MS5611 barometer driver common interface (I2C and SPI) |
| ms5611_i2c.c | Measurement Specialties (Intersema) MS5611-01BA and MS5607-02BA03 pressure/temperature sensor interface for I2C |
| ms5611_i2c.h | Measurement Specialties (Intersema) MS5611-01BA and MS5607-02BA03 pressure/temperature sensor interface for I2C |
| ms5611_regs.h | Register definitions for MS5611 barometer |
| ms5611_spi.c | Measurement Specialties (Intersema) MS5611-01BA and MS5607-02BA03 pressure/temperature sensor interface for SPI |
| ms5611_spi.h | Measurement Specialties (Intersema) MS5611-01BA and MS5607-02BA03 pressure/temperature sensor interface for SPI |
| pca95xx.c | Driver for the 8-bit I/O expander based on i2c |
| pca95xx.h | Driver for the 8-bit I/O expander based on i2c |
| pmw3901.c | |
| pmw3901.h | |
| qmc5883l.c | QST QMC5883L 3-axis magnetometer driver interface (I2C) |
| qmc5883l.h | QST QMC5883L 3-axis magnetometer driver interface (I2C) |
| rm3100.c | PNI RM3100 3-axis magnetometer driver interface (I2C) |
| rm3100.h | PNI RM3100 3-axis magnetometer driver interface (I2C) |
| sc18i600.c | |
| sc18i600.h | |
| sdcard_spi.c | This is an interface for reading and writing blocks of data to and from an SD card directly over SPI |
| sdcard_spi.h | Interface for reading and writing blocks of data to and from an SD card directly over SPI |
| sst25vfxxxx.c | Driver for the SST25Vxxxx flash chips |
| sst25vfxxxx.h | Driver for the SST25Vxxxx flash chips |
| sts3032_regs.h | |
| video_device.h | |
| vl53l1_platform.c | |
| vl53l1_platform.h | Those platform functions are platform dependent and have to be implemented by the user |
| vl53l1_types.h | VL53L1 types definition |
| vl53l1x_api.c | Functions implementation |
| vl53l1x_api.h | Functions definition |
| vl53l1x_nonblocking.c | Non-blocking runtime functions for the VL53L1X |
| vl53l1x_nonblocking.h | Non-blocking runtime functions for the VL53L1X |
| vl53l5cx_api.c | |
| vl53l5cx_api.h | |
| vl53l5cx_buffers.h | |
| vn200_serial.c | Vectornav VN-200 INS subsystem |
| vn200_serial.h | Vectornav VN-200 INS subsystem |
| ► utils | |
| circular_buffer.c | |
| circular_buffer.h | |
| autopilot.c | Core autopilot interface common to all firmwares |
| autopilot.h | Core autopilot interface common to all firmwares |
| c++.cpp | |
| led.h | Arch independent LED (Light Emitting Diodes) API |
| main_ap.c | Autopilot main loop |
| main_ap.h | Autopilot main loop |
| main_bare.c | Program main function with baremetal inplementation (no RTOS) |
| main_bare.h | |
| main_chibios.c | Program main function for ChibiOS inplementation |
| main_chibios.h | |
| main_fbw.c | FBW main loop |
| main_fbw.h | Fly By Wire: |
| mcu.c | Arch independent mcu ( Micro Controller Unit ) utilities |
| mcu.h | Arch independent mcu ( Micro Controller Unit ) utilities |
| paparazzi.h | |
| pprz_debug.c | |
| pprz_debug.h | |
| pprz_syscalls.c | |
| state.c | General interface for the main vehicle states |
| state.h | API to get/set the generic vehicle states |
| ▼ simulator | |
| ► mesonh | |
| __init__.py | |
| mesonh.py | |
| mesonh_atmosphere.py | |
| ► nps | |
| ► pybullet | |
| simple_quad_sim.py | |
| flight_gear.h | |
| nps_atmosphere.c | Atmosphere model (pressure, wind) for NPS |
| nps_atmosphere.h | Atmosphere model (pressure, wind) for NPS |
| nps_autopilot.h | |
| nps_autopilot_fixedwing.c | |
| nps_autopilot_rotorcraft.c | |
| nps_autopilot_rover.c | |
| nps_electrical.c | Electrical status (bat voltage) for NPS |
| nps_electrical.h | Electrical status (bat voltage) for NPS |
| nps_fdm.h | |
| nps_fdm_crrcsim.c | Flight Dynamics Model (FDM) for NPS using CRRCSIM |
| nps_fdm_fixedwing_sim.c | |
| nps_fdm_gazebo.cpp | Flight Dynamics Model (FDM) for NPS using Gazebo |
| nps_fdm_jsbsim.cpp | |
| nps_fdm_pybullet.c | |
| nps_fdm_rover.c | |
| nps_flightgear.c | |
| nps_flightgear.h | |
| nps_hitl_sensors.c | |
| nps_ins.h | |
| nps_ivy.c | |
| nps_ivy.h | |
| nps_main.h | |
| nps_main_common.c | |
| nps_main_hitl.c | |
| nps_main_sitl.c | |
| nps_radio_control.c | |
| nps_radio_control.h | |
| nps_radio_control_joystick.c | Direct RC control for NPS with a standard joystick using SDL |
| nps_radio_control_joystick.h | |
| nps_radio_control_spektrum.c | |
| nps_radio_control_spektrum.h | |
| nps_random.c | |
| nps_random.h | |
| nps_sensor_accel.c | |
| nps_sensor_accel.h | |
| nps_sensor_airspeed.c | Simulated airspeed for NPS simulator |
| nps_sensor_airspeed.h | Simulated airspeed for NPS simulator |
| nps_sensor_aoa.c | Simulated Angle of Attack of the Wind for NPS simulator |
| nps_sensor_aoa.h | Simulated Angle Of Attack of the Wind for NPS simulator |
| nps_sensor_baro.c | |
| nps_sensor_baro.h | |
| nps_sensor_gps.c | |
| nps_sensor_gps.h | |
| nps_sensor_gyro.c | |
| nps_sensor_gyro.h | |
| nps_sensor_mag.c | |
| nps_sensor_mag.h | |
| nps_sensor_sideslip.c | Simulated Angle of Attack of the Wind for NPS simulator |
| nps_sensor_sideslip.h | Simulated Angle Of Attack of the Wind for NPS simulator |
| nps_sensor_sonar.c | Simulated sonar for NPS simulator |
| nps_sensor_sonar.h | Simulated sonar for NPS simulator |
| nps_sensor_temperature.c | |
| nps_sensor_temperature.h | |
| nps_sensors.c | |
| nps_sensors.h | |
| nps_sensors_utils.c | |
| nps_sensors_utils.h | |
| ► scilab | |
| ► q3d | |
| ► fonts | |
| ttx2scilab.c | |
| ► povray | |
| q3d.inc | |
| ► q6d | |
| ► povray | |
| q6d.inc |