ardupilot/libraries/SITL
Peter Barker 7da5d9861a SITL: remove use of fprintf in SIM_SPI 2021-10-21 13:04:33 +11:00
..
examples SITL: remove HIL_MODE vestiges 2021-10-12 08:57:05 +11:00
tests SITL: sim_MS5611 fix simulated driver for 32bit usage 2021-09-28 09:15:11 +10:00
tools
SIM_ADSB.cpp SITL: Add instance to ADSB simulation 2021-10-20 20:21:33 +11:00
SIM_ADSB.h SITL: Add instance to ADSB simulation 2021-10-20 20:21:33 +11:00
SIM_AIS.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_AIS.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_AIS_data.txt SITL: add SIM_AIS 2021-08-10 08:11:18 +09:00
SIM_AirSim.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_AirSim.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Aircraft.cpp SITL: fixed plane-tailsitter model 2021-08-19 12:08:54 +10:00
SIM_Aircraft.h SITL: add simulated FETtec ESC 2021-08-13 16:22:37 +10:00
SIM_Airspeed_DLVR.cpp SITL: airspeed DLVR add atmosphere temperature model 2021-09-21 09:30:58 +10:00
SIM_Airspeed_DLVR.h SITL: add simulated DLVR airspeed sensor 2020-12-22 23:07:24 +11:00
SIM_BalanceBot.cpp SITL: convert to double precision for positions 2021-06-24 21:34:30 +10:00
SIM_BalanceBot.h SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Balloon.cpp
SIM_Balloon.h
SIM_BattMonitor_SMBus.cpp SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_BattMonitor_SMBus.h SITL: correct SMBus block reads 2021-01-05 14:45:20 +11:00
SIM_BattMonitor_SMBus_Generic.cpp SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_BattMonitor_SMBus_Generic.h SITL: add maxell to i2c bus and make it 14-cells 2021-06-15 09:46:26 +10:00
SIM_BattMonitor_SMBus_Maxell.cpp SITL: add Maxell SMBus battery support 2020-10-26 20:34:05 +11:00
SIM_BattMonitor_SMBus_Maxell.h SITL: add maxell to i2c bus and make it 14-cells 2021-06-15 09:46:26 +10:00
SIM_BattMonitor_SMBus_Rotoye.cpp SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_BattMonitor_SMBus_Rotoye.h SITL: add simulator for Rotoye battery monitor 2020-11-11 19:27:21 +11:00
SIM_Battery.cpp SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Battery.h SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Blimp.cpp SITL: Blimp SITL add initial dynamics 2021-09-18 08:26:23 +10:00
SIM_Blimp.h SITL: Blimp SITL add initial dynamics 2021-09-18 08:26:23 +10:00
SIM_Buzzer.cpp
SIM_Buzzer.h
SIM_CRRCSim.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_CRRCSim.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_CRSF.cpp SITL: add CRSF simulation driver 2020-07-07 18:48:06 +10:00
SIM_CRSF.h SITL: add CRSF simulation driver 2020-07-07 18:48:06 +10:00
SIM_Calibration.cpp SITL: remove use of Vector3 as function 2020-06-16 11:06:47 +10:00
SIM_Calibration.h
SIM_EFI_MegaSquirt.cpp SITL: move simulated megasquirt to SerialDevice framework 2021-10-17 10:00:08 +11:00
SIM_EFI_MegaSquirt.h SITL: move simulated megasquirt to SerialDevice framework 2021-10-17 10:00:08 +11:00
SIM_FETtecOneWireESC.cpp SITL: avoid use of stderr/::fprintf 2021-10-12 09:00:17 +11:00
SIM_FETtecOneWireESC.h SITL: add simulated FETtec ESC 2021-08-13 16:22:37 +10:00
SIM_FlightAxis.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_FlightAxis.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Frame.cpp SITL: swap rotation direciton of motor 2 for lower yaw offset 2021-08-28 10:32:59 +09:00
SIM_Frame.h SITL: Add momentum drag to multicopter model 2020-12-11 15:21:41 +11:00
SIM_Frsky.cpp
SIM_Frsky.h
SIM_Frsky_D.cpp SITL: avoid use of stderr/::fprintf 2021-10-12 09:00:17 +11:00
SIM_Frsky_D.h
SIM_GPS.cpp SITL: correct buffer over-read in GPS lag simulation 2021-10-21 12:09:21 +11:00
SIM_GPS.h SITL: make simulated GPS work as a SerialDevice 2021-10-21 12:09:21 +11:00
SIM_Gazebo.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Gazebo.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Gimbal.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Gimbal.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Gripper_EPM.cpp SITL: avoid use of stderr/::fprintf 2021-10-12 09:00:17 +11:00
SIM_Gripper_EPM.h SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Gripper_Servo.cpp SITL: avoid use of stderr/::fprintf 2021-10-12 09:00:17 +11:00
SIM_Gripper_Servo.h SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Helicopter.cpp SITL: make heli-blade simulation work 2021-09-08 14:33:19 +10:00
SIM_Helicopter.h SITL: make heli-blade simulation work 2021-09-08 14:33:19 +10:00
SIM_I2C.cpp SITL: add simulated MCP9600 2021-10-19 08:15:00 +11:00
SIM_I2C.h SITL: add support for multiple i2c buses 2020-12-24 16:05:49 +11:00
SIM_I2CDevice.cpp SITL: add simulated MCP9600 2021-10-19 08:15:00 +11:00
SIM_I2CDevice.h SITL: add simulated MCP9600 2021-10-19 08:15:00 +11:00
SIM_ICEngine.cpp
SIM_ICEngine.h
SIM_ICM40609.h SITL: add simulator for ICM40609 2021-01-12 17:43:36 +11:00
SIM_IntelligentEnergy.cpp SITL: add simulator for IntelligentEnergy 2.4kWh 2020-11-24 12:54:52 +11:00
SIM_IntelligentEnergy.h SITL: add simulator for IntelligentEnergy 2.4kWh 2020-11-24 12:54:52 +11:00
SIM_IntelligentEnergy24.cpp SITL: correct format string in SIM_IntelligentEnergy24 2021-10-21 13:01:49 +11:00
SIM_IntelligentEnergy24.h SITL: add simulator for IntelligentEnergy 2.4kWh 2020-11-24 12:54:52 +11:00
SIM_Invensense_v3.cpp SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_Invensense_v3.h SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_JSBSim.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_JSBSim.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_JSON.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_JSON.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_JSON_Master.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_JSON_Master.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_LORD.cpp Tools: autotest: add test for LORD EAHRS 2021-10-17 08:55:03 +11:00
SIM_LORD.h Tools: autotest: add test for LORD EAHRS 2021-10-17 08:55:03 +11:00
SIM_MS5XXX.cpp SITL: avoid use of stderr/::fprintf 2021-10-12 09:00:17 +11:00
SIM_MS5XXX.h SITL: MS5XXX drivers use check_conversion_accuracy 2021-09-21 09:30:58 +10:00
SIM_MS5525.cpp SITL: MS5XXX drivers use check_conversion_accuracy 2021-09-21 09:30:58 +10:00
SIM_MS5525.h SITL: MS5XXX drivers use check_conversion_accuracy 2021-09-21 09:30:58 +10:00
SIM_MS5611.cpp SITL: sim_MS5611 fix simulated driver for 32bit usage 2021-09-28 09:15:11 +10:00
SIM_MS5611.h SITL: MS5XXX drivers use check_conversion_accuracy 2021-09-21 09:30:58 +10:00
SIM_MaxSonarI2CXL.h SITL: factor out an I2C command/response class from simulated MaxSonar sensor 2020-12-05 09:35:53 +11:00
SIM_Morse.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Morse.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Motor.cpp SITL: fixed order of rotations in tilt vehicles 2021-06-08 19:11:32 +10:00
SIM_Motor.h SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_MotorBoat.h
SIM_Multicopter.cpp SITL: added is_lock_step_scheduled() API 2021-05-24 20:13:37 +10:00
SIM_Multicopter.h SITL: quadplane updates 2020-02-22 11:15:37 +11:00
SIM_PS_LightWare.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_PS_LightWare_SF45B.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_PS_LightWare_SF45B.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_PS_RPLidarA2.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_PS_RPLidarA2.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_PS_TeraRangerTower.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_PS_TeraRangerTower.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Parachute.cpp SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Parachute.h SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Plane.cpp SITL: added is_lock_step_scheduled() API 2021-05-24 20:13:37 +10:00
SIM_Plane.h SITL: delete unused parameter 'Vector3f &body_accel' in Plane::calculate_forces() 2020-12-30 18:59:12 +11:00
SIM_Precland.cpp SITL: convert to double precision for positions 2021-06-24 21:34:30 +10:00
SIM_Precland.h SITL: convert to double precision for positions 2021-06-24 21:34:30 +10:00
SIM_QuadPlane.cpp SITL: added is_lock_step_scheduled() API 2021-05-24 20:13:37 +10:00
SIM_QuadPlane.h SITL: quadplane updates 2020-02-22 11:15:37 +11:00
SIM_RAMTRON.cpp SITL: add simulated RAMTRON device 2021-10-12 20:01:49 +11:00
SIM_RAMTRON.h SITL: add simulated RAMTRON device 2021-10-12 20:01:49 +11:00
SIM_RAMTRON_FM25V02.cpp SITL: add simulated RAMTRON device 2021-10-12 20:01:49 +11:00
SIM_RAMTRON_FM25V02.h SITL: add simulated RAMTRON device 2021-10-12 20:01:49 +11:00
SIM_RF_BLping.cpp
SIM_RF_BLping.h
SIM_RF_Benewake.cpp
SIM_RF_Benewake.h
SIM_RF_Benewake_TF02.h
SIM_RF_Benewake_TF03.h
SIM_RF_Benewake_TFmini.h
SIM_RF_GYUS42v2.cpp SITL: add simulated GY-US42-v2 rangefinder 2020-07-04 13:40:10 +10:00
SIM_RF_GYUS42v2.h SITL: add simulated GY-US42-v2 rangefinder 2020-07-04 13:40:10 +10:00
SIM_RF_Lanbao.cpp
SIM_RF_Lanbao.h
SIM_RF_LeddarOne.cpp
SIM_RF_LeddarOne.h
SIM_RF_LightWareSerial.cpp SITL: fixed build with no GCS 2020-11-10 16:15:45 +11:00
SIM_RF_LightWareSerial.h
SIM_RF_LightWareSerialBinary.cpp SITL: add simulated LightWare serial lidar talking new binary protocol 2020-07-02 10:50:59 +10:00
SIM_RF_LightWareSerialBinary.h SITL: add simulated LightWare serial lidar talking new binary protocol 2020-07-02 10:50:59 +10:00
SIM_RF_MAVLink.cpp SITL: correct max_distance in simulated mavlink rangefinder 2021-01-06 15:33:41 +11:00
SIM_RF_MAVLink.h SITL: add simulated mavlink-attached rangefinder 2020-04-21 20:44:59 +10:00
SIM_RF_MaxsonarSerialLV.cpp
SIM_RF_MaxsonarSerialLV.h
SIM_RF_NMEA.cpp SITL: NMEA Depthfinder add temperature simulation 2021-10-15 13:08:17 +11:00
SIM_RF_NMEA.h SITL: NMEA Depthfinder add temperature simulation 2021-10-15 13:08:17 +11:00
SIM_RF_Wasp.cpp SITL: fixed build with no GCS 2020-11-10 16:15:45 +11:00
SIM_RF_Wasp.h
SIM_RF_uLanding.cpp
SIM_RF_uLanding.h
SIM_RF_uLanding_v0.cpp
SIM_RF_uLanding_v0.h
SIM_RF_uLanding_v1.cpp
SIM_RF_uLanding_v1.h
SIM_RichenPower.cpp SITL: SIM_RichenPower: remove reference to stderr 2021-10-12 09:00:45 +11:00
SIM_RichenPower.h SITL: SIM_RichenPower: remove reference to stderr 2021-10-12 09:00:45 +11:00
SIM_Rover.cpp SITL: convert to double precision for positions 2021-06-24 21:34:30 +10:00
SIM_Rover.h SITL: add rover with vectored thrust support 2021-04-08 08:47:07 +09:00
SIM_SMBusDevice.cpp SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_SMBusDevice.h SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_SPI.cpp SITL: remove use of fprintf in SIM_SPI 2021-10-21 13:04:33 +11:00
SIM_SPI.h SITL: add simulated SPI devices 2021-10-12 20:01:49 +11:00
SIM_SPIDevice.h SITL: add simulated SPI devices 2021-10-12 20:01:49 +11:00
SIM_Sailboat.cpp SITL: SIM_Sailboat: remove use of AHRS 2021-08-30 13:40:37 +10:00
SIM_Sailboat.h
SIM_Scrimmage.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Scrimmage.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_SerialDevice.cpp SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_SerialDevice.h SITL: make simulated GPS work as a SerialDevice 2021-10-21 12:09:21 +11:00
SIM_SerialProximitySensor.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_SerialProximitySensor.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_SerialRangeFinder.cpp SITL: NMEA Depthfinder add temperature simulation 2021-10-15 13:08:17 +11:00
SIM_SerialRangeFinder.h SITL: NMEA Depthfinder add temperature simulation 2021-10-15 13:08:17 +11:00
SIM_Ship.cpp SITL: separate origin and home in SITL 2021-07-14 17:34:40 +10:00
SIM_Ship.h SITL: added ship takeoff/landing simulation 2020-07-10 13:28:38 +10:00
SIM_SilentWings.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_SilentWings.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_SingleCopter.cpp SITL: added is_lock_step_scheduled() API 2021-05-24 20:13:37 +10:00
SIM_SingleCopter.h
SIM_Sprayer.cpp
SIM_Sprayer.h
SIM_Submarine.cpp SITL: convert to double precision for positions 2021-06-24 21:34:30 +10:00
SIM_Submarine.h SITL: convert to double precision for positions 2021-06-24 21:34:30 +10:00
SIM_Temperature_MCP9600.cpp SITL: add simulated MCP9600 2021-10-19 08:15:00 +11:00
SIM_Temperature_MCP9600.h SITL: add simulated MCP9600 2021-10-19 08:15:00 +11:00
SIM_Temperature_TSYS01.cpp SITL: fix labs on unsigned value subtraction 2021-05-26 17:40:19 +10:00
SIM_Temperature_TSYS01.h SITL: add support for simulated TSYS01 temperature sensor 2021-01-05 12:01:51 +11:00
SIM_ToneAlarm.cpp
SIM_ToneAlarm.h
SIM_ToshibaLED.cpp SITL: make ToshibaLED an 8-bit register device 2020-11-12 21:19:55 +11:00
SIM_ToshibaLED.h SITL: use enumeration in place of O_RDWR for I2C register defs 2021-10-12 14:44:31 +11:00
SIM_Tracker.cpp SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_Tracker.h SITL: Add missing const in member functions 2021-02-03 18:45:14 +11:00
SIM_VectorNav.cpp SITL: added VectorNav simulator 2021-01-05 21:13:12 +11:00
SIM_VectorNav.h SITL: added VectorNav simulator 2021-01-05 21:13:12 +11:00
SIM_Vicon.cpp SITL: avoid use of stderr/::fprintf 2021-10-12 09:00:17 +11:00
SIM_Vicon.h SITL: convert to double precision for positions 2021-06-24 21:34:30 +10:00
SIM_Webots.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_Webots.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_XPlane.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_XPlane.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_last_letter.cpp SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SIM_last_letter.h SITL: provide HAL_x_ENABLED for many SITL features 2021-10-12 09:04:55 +11:00
SITL.cpp SITL: make simulated GPS work as a SerialDevice 2021-10-21 12:09:21 +11:00
SITL.h SITL: make simulated GPS work as a SerialDevice 2021-10-21 12:09:21 +11:00
SITL_Input.h
picojson.h SITL: allow loading of model from ROMFS 2020-10-28 14:20:44 +11:00