2015-08-11 03:28:43 -03:00
|
|
|
#include <AP_HAL/AP_HAL.h>
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2020-09-12 16:04:38 -03:00
|
|
|
#if CONFIG_HAL_BOARD == HAL_BOARD_SITL && !defined(HAL_BUILD_AP_PERIPH)
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-08-11 03:28:43 -03:00
|
|
|
#include "AP_HAL_SITL.h"
|
2015-05-04 03:15:12 -03:00
|
|
|
#include "AP_HAL_SITL_Namespace.h"
|
|
|
|
#include "HAL_SITL_Class.h"
|
2012-12-14 21:54:26 -04:00
|
|
|
#include "UARTDriver.h"
|
|
|
|
#include "Scheduler.h"
|
|
|
|
|
|
|
|
#include <stdio.h>
|
|
|
|
#include <signal.h>
|
|
|
|
#include <unistd.h>
|
|
|
|
#include <stdlib.h>
|
|
|
|
#include <errno.h>
|
2012-12-18 03:12:05 -04:00
|
|
|
#include <sys/select.h>
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-08-11 03:28:43 -03:00
|
|
|
#include <AP_Param/AP_Param.h>
|
2016-01-01 02:09:07 -04:00
|
|
|
#include <SITL/SIM_JSBSim.h>
|
2016-01-03 17:22:02 -04:00
|
|
|
#include <AP_HAL/utility/Socket.h>
|
2015-03-21 11:27:25 -03:00
|
|
|
|
2012-12-14 21:54:26 -04:00
|
|
|
extern const AP_HAL::HAL& hal;
|
|
|
|
|
2015-05-04 03:15:12 -03:00
|
|
|
using namespace HALSITL;
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-05-04 18:08:42 -03:00
|
|
|
void SITL_State::_set_param_default(const char *parm)
|
2014-04-10 23:28:32 -03:00
|
|
|
{
|
2015-05-04 18:08:42 -03:00
|
|
|
char *pdup = strdup(parm);
|
|
|
|
char *p = strchr(pdup, '=');
|
2016-10-30 02:24:21 -03:00
|
|
|
if (p == nullptr) {
|
2014-04-10 23:28:32 -03:00
|
|
|
printf("Please specify parameter as NAME=VALUE");
|
|
|
|
exit(1);
|
|
|
|
}
|
2016-10-30 02:24:21 -03:00
|
|
|
float value = strtof(p+1, nullptr);
|
2014-04-10 23:28:32 -03:00
|
|
|
*p = 0;
|
|
|
|
enum ap_var_type var_type;
|
2015-10-01 22:15:21 -03:00
|
|
|
AP_Param *vp = AP_Param::find(pdup, &var_type);
|
2016-10-30 02:24:21 -03:00
|
|
|
if (vp == nullptr) {
|
2015-10-01 22:15:21 -03:00
|
|
|
printf("Unknown parameter %s\n", pdup);
|
2015-05-04 21:59:07 -03:00
|
|
|
exit(1);
|
2014-04-10 23:28:32 -03:00
|
|
|
}
|
|
|
|
if (var_type == AP_PARAM_FLOAT) {
|
|
|
|
((AP_Float *)vp)->set_and_save(value);
|
|
|
|
} else if (var_type == AP_PARAM_INT32) {
|
|
|
|
((AP_Int32 *)vp)->set_and_save(value);
|
|
|
|
} else if (var_type == AP_PARAM_INT16) {
|
|
|
|
((AP_Int16 *)vp)->set_and_save(value);
|
|
|
|
} else if (var_type == AP_PARAM_INT8) {
|
|
|
|
((AP_Int8 *)vp)->set_and_save(value);
|
|
|
|
} else {
|
2015-10-01 22:15:21 -03:00
|
|
|
printf("Unable to set parameter %s\n", pdup);
|
2014-04-10 23:28:32 -03:00
|
|
|
exit(1);
|
|
|
|
}
|
2015-10-01 22:15:21 -03:00
|
|
|
printf("Set parameter %s to %f\n", pdup, value);
|
2015-05-04 18:08:42 -03:00
|
|
|
free(pdup);
|
2014-04-10 23:28:32 -03:00
|
|
|
}
|
|
|
|
|
|
|
|
|
2012-12-14 21:54:26 -04:00
|
|
|
/*
|
|
|
|
setup for SITL handling
|
|
|
|
*/
|
2021-12-11 05:49:33 -04:00
|
|
|
void SITL_State::_sitl_setup()
|
2012-12-14 21:54:26 -04:00
|
|
|
{
|
2018-03-02 00:28:15 -04:00
|
|
|
#if !defined(__CYGWIN__) && !defined(__CYGWIN64__)
|
2015-05-04 21:59:07 -03:00
|
|
|
_parent_pid = getppid();
|
2012-12-14 21:54:26 -04:00
|
|
|
#endif
|
|
|
|
|
2015-05-04 21:59:07 -03:00
|
|
|
_setup_fdm();
|
|
|
|
fprintf(stdout, "Starting SITL input\n");
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-05-04 21:59:07 -03:00
|
|
|
// find the barometer object if it exists
|
2018-06-15 17:03:18 -03:00
|
|
|
_sitl = AP::sitl();
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_sitl != nullptr) {
|
2012-12-14 21:54:26 -04:00
|
|
|
// setup some initial values
|
2017-05-11 10:38:32 -03:00
|
|
|
_update_airspeed(0);
|
2015-05-24 23:11:16 -03:00
|
|
|
if (enable_gimbal) {
|
2016-02-26 01:15:00 -04:00
|
|
|
gimbal = new SITL::Gimbal(_sitl->state);
|
2015-05-24 23:11:16 -03:00
|
|
|
}
|
2016-01-01 02:09:07 -04:00
|
|
|
|
2019-10-08 01:14:45 -03:00
|
|
|
sitl_model->set_buzzer(&_sitl->buzzer_sim);
|
2018-07-31 09:32:43 -03:00
|
|
|
sitl_model->set_sprayer(&_sitl->sprayer_sim);
|
|
|
|
sitl_model->set_gripper_servo(&_sitl->gripper_sim);
|
|
|
|
sitl_model->set_gripper_epm(&_sitl->gripper_epm_sim);
|
2019-01-08 21:40:22 -04:00
|
|
|
sitl_model->set_parachute(&_sitl->parachute_sim);
|
2019-02-28 22:24:15 -04:00
|
|
|
sitl_model->set_precland(&_sitl->precland_sim);
|
2020-10-20 19:41:31 -03:00
|
|
|
_sitl->i2c_sim.init();
|
2020-08-03 00:24:26 -03:00
|
|
|
sitl_model->set_i2c(&_sitl->i2c_sim);
|
2023-01-22 03:33:55 -04:00
|
|
|
#if AP_TEST_DRONECAN_DRIVERS
|
|
|
|
sitl_model->set_dronecan_device(&_sitl->dronecan_sim);
|
|
|
|
#endif
|
2016-09-21 14:02:15 -03:00
|
|
|
if (_use_fg_view) {
|
2018-06-16 22:39:41 -03:00
|
|
|
fg_socket.connect(_fg_address, _fg_view_port);
|
2016-09-21 14:02:15 -03:00
|
|
|
}
|
|
|
|
|
2016-11-21 09:39:13 -04:00
|
|
|
fprintf(stdout, "Using Irlock at port : %d\n", _irlock_port);
|
2016-11-17 14:05:04 -04:00
|
|
|
_sitl->irlock_port = _irlock_port;
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
2015-03-21 11:27:25 -03:00
|
|
|
|
|
|
|
if (_synthetic_clock_mode) {
|
|
|
|
// start with non-zero clock
|
2015-04-30 04:15:40 -03:00
|
|
|
hal.scheduler->stop_clock(1);
|
2015-03-21 11:27:25 -03:00
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
|
|
|
|
/*
|
|
|
|
setup a SITL FDM listening UDP port
|
|
|
|
*/
|
|
|
|
void SITL_State::_setup_fdm(void)
|
|
|
|
{
|
2018-12-19 06:44:34 -04:00
|
|
|
if (!_sitl_rc_in.reuseaddress()) {
|
|
|
|
fprintf(stderr, "SITL: socket reuseaddress failed on RC in port: %d - %s\n", _rcin_port, strerror(errno));
|
2018-06-08 01:12:58 -03:00
|
|
|
fprintf(stderr, "Aborting launch...\n");
|
2015-05-04 21:59:07 -03:00
|
|
|
exit(1);
|
|
|
|
}
|
2018-12-19 06:44:34 -04:00
|
|
|
if (!_sitl_rc_in.bind("0.0.0.0", _rcin_port)) {
|
|
|
|
fprintf(stderr, "SITL: socket bind failed on RC in port : %d - %s\n", _rcin_port, strerror(errno));
|
2018-12-13 22:37:20 -04:00
|
|
|
fprintf(stderr, "Aborting launch...\n");
|
|
|
|
exit(1);
|
|
|
|
}
|
|
|
|
if (!_sitl_rc_in.set_blocking(false)) {
|
|
|
|
fprintf(stderr, "SITL: socket set_blocking(false) failed on RC in port: %d - %s\n", _rcin_port, strerror(errno));
|
|
|
|
fprintf(stderr, "Aborting launch...\n");
|
|
|
|
exit(1);
|
|
|
|
}
|
|
|
|
if (!_sitl_rc_in.set_cloexec()) {
|
|
|
|
fprintf(stderr, "SITL: socket set_cloexec() failed on RC in port: %d - %s\n", _rcin_port, strerror(errno));
|
|
|
|
fprintf(stderr, "Aborting launch...\n");
|
|
|
|
exit(1);
|
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
|
|
|
|
/*
|
2015-05-02 08:41:13 -03:00
|
|
|
step the FDM by one time step
|
2012-12-14 21:54:26 -04:00
|
|
|
*/
|
2015-05-02 08:41:13 -03:00
|
|
|
void SITL_State::_fdm_input_step(void)
|
2012-12-14 21:54:26 -04:00
|
|
|
{
|
2015-05-02 08:41:13 -03:00
|
|
|
static uint32_t last_pwm_input = 0;
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-11-22 22:21:33 -04:00
|
|
|
_fdm_input_local();
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-05-02 08:41:13 -03:00
|
|
|
/* make sure we die if our parent dies */
|
|
|
|
if (kill(_parent_pid, 0) != 0) {
|
|
|
|
exit(1);
|
|
|
|
}
|
2015-05-04 21:59:07 -03:00
|
|
|
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_scheduler->interrupts_are_blocked() || _sitl == nullptr) {
|
2015-05-02 08:41:13 -03:00
|
|
|
return;
|
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-05-02 08:41:13 -03:00
|
|
|
// simulate RC input at 50Hz
|
2021-08-13 05:07:37 -03:00
|
|
|
if (AP_HAL::millis() - last_pwm_input >= 20 && _sitl != nullptr && _sitl->rc_fail != SITL::SIM::SITL_RCFail_NoPulses) {
|
2015-11-19 23:11:17 -04:00
|
|
|
last_pwm_input = AP_HAL::millis();
|
2015-05-02 08:41:13 -03:00
|
|
|
new_rc_input = true;
|
|
|
|
}
|
2015-03-21 11:27:25 -03:00
|
|
|
|
2015-05-02 08:41:13 -03:00
|
|
|
_scheduler->sitl_begin_atomic();
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_update_count == 0 && _sitl != nullptr) {
|
2021-08-13 05:06:02 -03:00
|
|
|
HALSITL::Scheduler::timer_event();
|
2015-03-21 11:27:25 -03:00
|
|
|
_scheduler->sitl_end_atomic();
|
2015-05-02 08:41:13 -03:00
|
|
|
return;
|
|
|
|
}
|
2015-03-21 11:27:25 -03:00
|
|
|
|
2016-10-30 02:24:21 -03:00
|
|
|
if (_sitl != nullptr) {
|
2017-05-11 10:38:32 -03:00
|
|
|
_update_airspeed(_sitl->state.airspeed);
|
2021-12-07 21:49:53 -04:00
|
|
|
_update_rangefinder();
|
2015-05-02 08:41:13 -03:00
|
|
|
}
|
2015-05-04 21:59:07 -03:00
|
|
|
|
|
|
|
// trigger all APM timers.
|
2021-08-13 05:06:02 -03:00
|
|
|
HALSITL::Scheduler::timer_event();
|
2015-05-02 08:41:13 -03:00
|
|
|
_scheduler->sitl_end_atomic();
|
|
|
|
}
|
|
|
|
|
|
|
|
|
|
|
|
void SITL_State::wait_clock(uint64_t wait_time_usec)
|
|
|
|
{
|
2022-11-06 19:25:52 -04:00
|
|
|
float speedup = sitl_model->get_speedup();
|
|
|
|
if (speedup < 1) {
|
|
|
|
// for purposes of sleeps treat low speedups as 1
|
|
|
|
speedup = 1.0;
|
|
|
|
}
|
2015-11-19 23:11:17 -04:00
|
|
|
while (AP_HAL::micros64() < wait_time_usec) {
|
2019-09-02 03:00:16 -03:00
|
|
|
if (hal.scheduler->in_main_thread() ||
|
|
|
|
Scheduler::from(hal.scheduler)->semaphore_wait_hack_required()) {
|
2018-07-06 23:42:00 -03:00
|
|
|
_fdm_input_step();
|
|
|
|
} else {
|
2022-11-06 19:25:52 -04:00
|
|
|
#ifdef CYGWIN_BUILD
|
2022-11-08 23:26:34 -04:00
|
|
|
if (speedup > 2 && hal.util->get_soft_armed()) {
|
|
|
|
const char *current_thread = Scheduler::from(hal.scheduler)->get_current_thread_name();
|
|
|
|
if (current_thread && strcmp(current_thread, "Scripting") == 0) {
|
|
|
|
// this effectively does a yield of the CPU. The
|
|
|
|
// granularity of sleeps on cygwin is very high,
|
|
|
|
// so this is needed for good thread performance
|
|
|
|
// in scripting. We don't do this at low speedups
|
|
|
|
// as it causes the cpu to run hot
|
|
|
|
// We also don't do it while disarmed, as lua performance is less
|
|
|
|
// critical while disarmed
|
|
|
|
usleep(0);
|
|
|
|
continue;
|
|
|
|
}
|
2022-11-06 19:25:52 -04:00
|
|
|
}
|
|
|
|
#endif
|
2018-07-06 23:42:00 -03:00
|
|
|
usleep(1000);
|
|
|
|
}
|
2015-03-21 11:27:25 -03:00
|
|
|
}
|
2020-04-02 21:50:25 -03:00
|
|
|
// check the outbound TCP queue size. If it is too long then
|
|
|
|
// MAVProxy/pymavlink take too long to process packets and it ends
|
|
|
|
// up seeing traffic well into our past and hits time-out
|
|
|
|
// conditions.
|
2022-11-06 19:25:52 -04:00
|
|
|
if (speedup > 1 && hal.scheduler->in_main_thread()) {
|
2020-04-02 21:50:25 -03:00
|
|
|
while (true) {
|
2020-12-10 20:18:38 -04:00
|
|
|
const int queue_length = ((HALSITL::UARTDriver*)hal.serial(0))->get_system_outqueue_length();
|
2020-04-02 21:50:25 -03:00
|
|
|
// ::fprintf(stderr, "queue_length=%d\n", (signed)queue_length);
|
|
|
|
if (queue_length < 1024) {
|
|
|
|
break;
|
|
|
|
}
|
|
|
|
usleep(1000);
|
|
|
|
}
|
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
|
|
|
|
2017-08-10 07:23:11 -03:00
|
|
|
#define streq(a, b) (!strcmp(a, b))
|
2021-10-26 09:31:22 -03:00
|
|
|
SITL::SerialDevice *SITL_State::create_serial_sim(const char *name, const char *arg)
|
2017-08-10 07:23:11 -03:00
|
|
|
{
|
2018-03-07 21:25:34 -04:00
|
|
|
if (streq(name, "vicon")) {
|
|
|
|
if (vicon != nullptr) {
|
|
|
|
AP_HAL::panic("Only one vicon system at a time");
|
|
|
|
}
|
|
|
|
vicon = new SITL::Vicon();
|
2021-10-26 09:31:22 -03:00
|
|
|
return vicon;
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_ADSB_ENABLED
|
2021-11-09 02:23:34 -04:00
|
|
|
} else if (streq(name, "adsb")) {
|
|
|
|
// ADSB is a stand-out as it is the only serial device which
|
|
|
|
// will cope with begin() being called multiple times on a
|
|
|
|
// serial port
|
|
|
|
if (adsb == nullptr) {
|
|
|
|
adsb = new SITL::ADSB();
|
|
|
|
}
|
|
|
|
return adsb;
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "benewake_tf02")) {
|
|
|
|
if (benewake_tf02 != nullptr) {
|
|
|
|
AP_HAL::panic("Only one benewake_tf02 at a time");
|
|
|
|
}
|
|
|
|
benewake_tf02 = new SITL::RF_Benewake_TF02();
|
2021-10-26 09:31:22 -03:00
|
|
|
return benewake_tf02;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "benewake_tf03")) {
|
|
|
|
if (benewake_tf03 != nullptr) {
|
|
|
|
AP_HAL::panic("Only one benewake_tf03 at a time");
|
|
|
|
}
|
|
|
|
benewake_tf03 = new SITL::RF_Benewake_TF03();
|
2021-10-26 09:31:22 -03:00
|
|
|
return benewake_tf03;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "benewake_tfmini")) {
|
|
|
|
if (benewake_tfmini != nullptr) {
|
|
|
|
AP_HAL::panic("Only one benewake_tfmini at a time");
|
|
|
|
}
|
|
|
|
benewake_tfmini = new SITL::RF_Benewake_TFmini();
|
2021-10-26 09:31:22 -03:00
|
|
|
return benewake_tfmini;
|
2023-06-16 15:31:34 -03:00
|
|
|
} else if (streq(name, "nooploop_tofsense")) {
|
|
|
|
if (nooploop != nullptr) {
|
|
|
|
AP_HAL::panic("Only one nooploop_tofsense at a time");
|
|
|
|
}
|
|
|
|
nooploop = new SITL::RF_Nooploop();
|
|
|
|
return nooploop;
|
2022-08-01 20:44:01 -03:00
|
|
|
} else if (streq(name, "teraranger_serial")) {
|
|
|
|
if (teraranger_serial != nullptr) {
|
|
|
|
AP_HAL::panic("Only one teraranger_serial at a time");
|
|
|
|
}
|
|
|
|
teraranger_serial = new SITL::RF_TeraRanger_Serial();
|
|
|
|
return teraranger_serial;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "lightwareserial")) {
|
|
|
|
if (lightwareserial != nullptr) {
|
|
|
|
AP_HAL::panic("Only one lightwareserial at a time");
|
|
|
|
}
|
|
|
|
lightwareserial = new SITL::RF_LightWareSerial();
|
2021-10-26 09:31:22 -03:00
|
|
|
return lightwareserial;
|
2020-06-30 08:10:28 -03:00
|
|
|
} else if (streq(name, "lightwareserial-binary")) {
|
|
|
|
if (lightwareserial_binary != nullptr) {
|
|
|
|
AP_HAL::panic("Only one lightwareserial-binary at a time");
|
|
|
|
}
|
|
|
|
lightwareserial_binary = new SITL::RF_LightWareSerialBinary();
|
2021-10-26 09:31:22 -03:00
|
|
|
return lightwareserial_binary;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "lanbao")) {
|
|
|
|
if (lanbao != nullptr) {
|
|
|
|
AP_HAL::panic("Only one lanbao at a time");
|
|
|
|
}
|
|
|
|
lanbao = new SITL::RF_Lanbao();
|
2021-10-26 09:31:22 -03:00
|
|
|
return lanbao;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "blping")) {
|
|
|
|
if (blping != nullptr) {
|
|
|
|
AP_HAL::panic("Only one blping at a time");
|
|
|
|
}
|
|
|
|
blping = new SITL::RF_BLping();
|
2021-10-26 09:31:22 -03:00
|
|
|
return blping;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "leddarone")) {
|
|
|
|
if (leddarone != nullptr) {
|
|
|
|
AP_HAL::panic("Only one leddarone at a time");
|
|
|
|
}
|
|
|
|
leddarone = new SITL::RF_LeddarOne();
|
2021-10-26 09:31:22 -03:00
|
|
|
return leddarone;
|
2023-05-12 22:24:27 -03:00
|
|
|
} else if (streq(name, "rds02uf")) {
|
|
|
|
if (rds02uf != nullptr) {
|
|
|
|
AP_HAL::panic("Only one rds02uf at a time");
|
|
|
|
}
|
|
|
|
rds02uf = new SITL::RF_RDS02UF();
|
|
|
|
return rds02uf;
|
2021-10-25 18:41:10 -03:00
|
|
|
} else if (streq(name, "USD1_v0")) {
|
|
|
|
if (USD1_v0 != nullptr) {
|
|
|
|
AP_HAL::panic("Only one USD1_v0 at a time");
|
|
|
|
}
|
|
|
|
USD1_v0 = new SITL::RF_USD1_v0();
|
2021-10-26 09:31:22 -03:00
|
|
|
return USD1_v0;
|
2021-10-25 18:41:10 -03:00
|
|
|
} else if (streq(name, "USD1_v1")) {
|
|
|
|
if (USD1_v1 != nullptr) {
|
|
|
|
AP_HAL::panic("Only one USD1_v1 at a time");
|
|
|
|
}
|
|
|
|
USD1_v1 = new SITL::RF_USD1_v1();
|
2021-10-26 09:31:22 -03:00
|
|
|
return USD1_v1;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "maxsonarseriallv")) {
|
|
|
|
if (maxsonarseriallv != nullptr) {
|
|
|
|
AP_HAL::panic("Only one maxsonarseriallv at a time");
|
|
|
|
}
|
|
|
|
maxsonarseriallv = new SITL::RF_MaxsonarSerialLV();
|
2021-10-26 09:31:22 -03:00
|
|
|
return maxsonarseriallv;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "wasp")) {
|
|
|
|
if (wasp != nullptr) {
|
|
|
|
AP_HAL::panic("Only one wasp at a time");
|
|
|
|
}
|
|
|
|
wasp = new SITL::RF_Wasp();
|
2021-10-26 09:31:22 -03:00
|
|
|
return wasp;
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "nmea")) {
|
|
|
|
if (nmea != nullptr) {
|
|
|
|
AP_HAL::panic("Only one nmea at a time");
|
|
|
|
}
|
|
|
|
nmea = new SITL::RF_NMEA();
|
2021-10-26 09:31:22 -03:00
|
|
|
return nmea;
|
2019-12-16 22:21:13 -04:00
|
|
|
|
2020-04-21 00:29:11 -03:00
|
|
|
} else if (streq(name, "rf_mavlink")) {
|
2021-10-21 22:17:04 -03:00
|
|
|
if (rf_mavlink != nullptr) {
|
2020-04-21 00:29:11 -03:00
|
|
|
AP_HAL::panic("Only one rf_mavlink at a time");
|
|
|
|
}
|
|
|
|
rf_mavlink = new SITL::RF_MAVLink();
|
2021-10-26 09:31:22 -03:00
|
|
|
return rf_mavlink;
|
2020-04-21 00:29:11 -03:00
|
|
|
|
2019-12-16 22:21:13 -04:00
|
|
|
} else if (streq(name, "frsky-d")) {
|
|
|
|
if (frsky_d != nullptr) {
|
|
|
|
AP_HAL::panic("Only one frsky_d at a time");
|
|
|
|
}
|
|
|
|
frsky_d = new SITL::Frsky_D();
|
2021-10-26 09:31:22 -03:00
|
|
|
return frsky_d;
|
2019-12-16 22:21:13 -04:00
|
|
|
// } else if (streq(name, "frsky-SPort")) {
|
|
|
|
// if (frsky_sport != nullptr) {
|
|
|
|
// AP_HAL::panic("Only one frsky_sport at a time");
|
|
|
|
// }
|
|
|
|
// frsky_sport = new SITL::Frsky_SPort();
|
2021-10-26 09:31:22 -03:00
|
|
|
// return frsky_sport;
|
2019-12-16 22:21:13 -04:00
|
|
|
|
|
|
|
// } else if (streq(name, "frsky-SPortPassthrough")) {
|
|
|
|
// if (frsky_sport_passthrough != nullptr) {
|
|
|
|
// AP_HAL::panic("Only one frsky_sport passthrough at a time");
|
|
|
|
// }
|
|
|
|
// frsky_sport = new SITL::Frsky_SPortPassthrough();
|
2021-10-26 09:31:22 -03:00
|
|
|
// return frsky_sportpassthrough;
|
2022-01-14 22:47:15 -04:00
|
|
|
#if AP_SIM_CRSF_ENABLED
|
2020-06-04 14:59:30 -03:00
|
|
|
} else if (streq(name, "crsf")) {
|
|
|
|
if (crsf != nullptr) {
|
|
|
|
AP_HAL::panic("Only one crsf at a time");
|
|
|
|
}
|
|
|
|
crsf = new SITL::CRSF();
|
2021-10-26 09:31:22 -03:00
|
|
|
return crsf;
|
2022-01-14 22:47:15 -04:00
|
|
|
#endif
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_PS_RPLIDARA2_ENABLED
|
2019-11-20 22:11:42 -04:00
|
|
|
} else if (streq(name, "rplidara2")) {
|
|
|
|
if (rplidara2 != nullptr) {
|
|
|
|
AP_HAL::panic("Only one rplidara2 at a time");
|
|
|
|
}
|
|
|
|
rplidara2 = new SITL::PS_RPLidarA2();
|
2021-10-26 09:31:22 -03:00
|
|
|
return rplidara2;
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2021-02-04 21:46:44 -04:00
|
|
|
#if HAL_SIM_PS_RPLIDARA1_ENABLED
|
|
|
|
} else if (streq(name, "rplidara1")) {
|
|
|
|
if (rplidara1 != nullptr) {
|
|
|
|
AP_HAL::panic("Only one rplidara1 at a time");
|
|
|
|
}
|
|
|
|
rplidara1 = new SITL::PS_RPLidarA1();
|
|
|
|
return rplidara1;
|
|
|
|
#endif
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_PS_TERARANGERTOWER_ENABLED
|
2020-12-07 07:07:21 -04:00
|
|
|
} else if (streq(name, "terarangertower")) {
|
|
|
|
if (terarangertower != nullptr) {
|
|
|
|
AP_HAL::panic("Only one terarangertower at a time");
|
|
|
|
}
|
|
|
|
terarangertower = new SITL::PS_TeraRangerTower();
|
2021-10-26 09:31:22 -03:00
|
|
|
return terarangertower;
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
|
|
|
#if HAL_SIM_PS_LIGHTWARE_SF45B_ENABLED
|
2020-12-08 06:13:41 -04:00
|
|
|
} else if (streq(name, "sf45b")) {
|
|
|
|
if (sf45b != nullptr) {
|
|
|
|
AP_HAL::panic("Only one sf45b at a time");
|
|
|
|
}
|
|
|
|
sf45b = new SITL::PS_LightWare_SF45B();
|
2021-10-26 09:31:22 -03:00
|
|
|
return sf45b;
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2019-10-28 23:53:01 -03:00
|
|
|
} else if (streq(name, "richenpower")) {
|
|
|
|
sitl_model->set_richenpower(&_sitl->richenpower_sim);
|
2021-10-26 09:31:22 -03:00
|
|
|
return &_sitl->richenpower_sim;
|
2021-06-28 19:24:15 -03:00
|
|
|
} else if (streq(name, "fetteconewireesc")) {
|
|
|
|
sitl_model->set_fetteconewireesc(&_sitl->fetteconewireesc_sim);
|
2021-10-26 09:31:22 -03:00
|
|
|
return &_sitl->fetteconewireesc_sim;
|
2020-09-22 22:03:51 -03:00
|
|
|
} else if (streq(name, "ie24")) {
|
|
|
|
sitl_model->set_ie24(&_sitl->ie24_sim);
|
2021-10-26 09:31:22 -03:00
|
|
|
return &_sitl->ie24_sim;
|
2020-06-14 20:36:08 -03:00
|
|
|
} else if (streq(name, "gyus42v2")) {
|
|
|
|
if (gyus42v2 != nullptr) {
|
|
|
|
AP_HAL::panic("Only one gyus42v2 at a time");
|
|
|
|
}
|
|
|
|
gyus42v2 = new SITL::RF_GYUS42v2();
|
2021-10-26 09:31:22 -03:00
|
|
|
return gyus42v2;
|
2021-10-10 22:12:20 -03:00
|
|
|
} else if (streq(name, "megasquirt")) {
|
|
|
|
if (efi_ms != nullptr) {
|
|
|
|
AP_HAL::panic("Only one megasquirt at a time");
|
|
|
|
}
|
|
|
|
efi_ms = new SITL::EFI_MegaSquirt();
|
2021-10-26 09:31:22 -03:00
|
|
|
return efi_ms;
|
2020-12-29 06:30:34 -04:00
|
|
|
} else if (streq(name, "VectorNav")) {
|
|
|
|
if (vectornav != nullptr) {
|
|
|
|
AP_HAL::panic("Only one VectorNav at a time");
|
|
|
|
}
|
|
|
|
vectornav = new SITL::VectorNav();
|
2021-10-26 09:31:22 -03:00
|
|
|
return vectornav;
|
2021-09-23 19:26:03 -03:00
|
|
|
} else if (streq(name, "LORD")) {
|
|
|
|
if (lord != nullptr) {
|
|
|
|
AP_HAL::panic("Only one LORD at a time");
|
|
|
|
}
|
|
|
|
lord = new SITL::LORD();
|
2021-10-26 09:31:22 -03:00
|
|
|
return lord;
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_AIS_ENABLED
|
2021-04-11 11:42:17 -03:00
|
|
|
} else if (streq(name, "AIS")) {
|
|
|
|
if (ais != nullptr) {
|
|
|
|
AP_HAL::panic("Only one AIS at a time");
|
|
|
|
}
|
|
|
|
ais = new SITL::AIS();
|
2021-10-26 09:31:22 -03:00
|
|
|
return ais;
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2021-10-16 00:10:40 -03:00
|
|
|
} else if (strncmp(name, "gps", 3) == 0) {
|
|
|
|
const char *p = strchr(name, ':');
|
|
|
|
if (p == nullptr) {
|
|
|
|
AP_HAL::panic("Need a GPS number (e.g. sim:gps:1)");
|
|
|
|
}
|
|
|
|
uint8_t x = atoi(p+1);
|
|
|
|
if (x <= 0 || x > ARRAY_SIZE(gps)) {
|
|
|
|
AP_HAL::panic("Bad GPS number %u", x);
|
|
|
|
}
|
|
|
|
gps[x-1] = new SITL::GPS(x-1);
|
2021-10-26 09:31:22 -03:00
|
|
|
return gps[x-1];
|
2018-03-07 21:25:34 -04:00
|
|
|
}
|
2019-10-28 23:52:19 -03:00
|
|
|
|
|
|
|
AP_HAL::panic("unknown simulated device: %s", name);
|
|
|
|
}
|
2017-08-10 07:23:11 -03:00
|
|
|
|
2012-12-14 21:54:26 -04:00
|
|
|
/*
|
2016-09-21 14:15:00 -03:00
|
|
|
check for a SITL RC input packet
|
2012-12-14 21:54:26 -04:00
|
|
|
*/
|
2016-09-21 14:15:00 -03:00
|
|
|
void SITL_State::_check_rc_input(void)
|
2012-12-14 21:54:26 -04:00
|
|
|
{
|
2018-05-30 07:18:40 -03:00
|
|
|
uint32_t count = 0;
|
|
|
|
while (_read_rc_sitl_input()) {
|
|
|
|
count++;
|
|
|
|
}
|
|
|
|
|
|
|
|
if (count > 100) {
|
|
|
|
::fprintf(stderr, "Read %u rc inputs\n", count);
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
|
|
|
bool SITL_State::_read_rc_sitl_input()
|
|
|
|
{
|
2015-05-04 21:59:07 -03:00
|
|
|
struct pwm_packet {
|
2016-01-03 17:22:02 -04:00
|
|
|
uint16_t pwm[16];
|
2015-11-22 22:21:33 -04:00
|
|
|
} pwm_pkt;
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2018-05-30 07:18:40 -03:00
|
|
|
const ssize_t size = _sitl_rc_in.recv(&pwm_pkt, sizeof(pwm_pkt), 0);
|
2022-08-04 20:31:57 -03:00
|
|
|
|
2022-09-01 08:34:45 -03:00
|
|
|
// if we are simulating no pulses RC failure, do not update pwm_input
|
|
|
|
if (_sitl->rc_fail == SITL::SIM::SITL_RCFail_NoPulses) {
|
|
|
|
return size != -1; // we must continue to drain _sitl_rc
|
|
|
|
}
|
|
|
|
|
2022-08-04 20:31:57 -03:00
|
|
|
if (_sitl->rc_fail == SITL::SIM::SITL_RCFail_Throttle950) {
|
|
|
|
// discard anything we just read from the "receiver" and set
|
|
|
|
// values to bind values:
|
|
|
|
for (uint8_t i=0; i<ARRAY_SIZE(pwm_input); i++) {
|
|
|
|
pwm_input[0] = 1500; // centre all inputs
|
|
|
|
}
|
|
|
|
pwm_input[2] = 950; // reset throttle (assumed to be on channel 3...)
|
|
|
|
return size != -1; // we must continue to drain _sitl_rc
|
|
|
|
}
|
|
|
|
|
2015-11-22 22:21:33 -04:00
|
|
|
switch (size) {
|
2018-05-30 07:18:40 -03:00
|
|
|
case -1:
|
|
|
|
return false;
|
2016-01-03 17:22:02 -04:00
|
|
|
case 8*2:
|
|
|
|
case 16*2: {
|
2015-05-04 21:59:07 -03:00
|
|
|
// a packet giving the receiver PWM inputs
|
2018-07-31 07:24:18 -03:00
|
|
|
for (uint8_t i=0; i<size/2; i++) {
|
2016-01-04 09:21:54 -04:00
|
|
|
// setup the pwm input for the RC channel inputs
|
2016-05-03 23:50:02 -03:00
|
|
|
if (i < _sitl->state.rcin_chan_count) {
|
|
|
|
// we're using rc from simulator
|
|
|
|
continue;
|
|
|
|
}
|
2018-07-31 07:24:18 -03:00
|
|
|
uint16_t pwm = pwm_pkt.pwm[i];
|
|
|
|
if (pwm != 0) {
|
|
|
|
pwm_input[i] = pwm;
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
|
|
|
}
|
2018-05-30 07:18:40 -03:00
|
|
|
return true;
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
2018-05-30 07:18:40 -03:00
|
|
|
default:
|
2019-10-28 03:05:28 -03:00
|
|
|
fprintf(stderr, "Malformed SITL RC input (%ld)", (long)size);
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
2018-05-30 07:18:40 -03:00
|
|
|
return false;
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
2015-05-02 07:27:33 -03:00
|
|
|
|
2016-01-01 02:09:07 -04:00
|
|
|
/*
|
|
|
|
output current state to flightgear
|
|
|
|
*/
|
|
|
|
void SITL_State::_output_to_flightgear(void)
|
|
|
|
{
|
|
|
|
SITL::FGNetFDM fdm {};
|
|
|
|
const SITL::sitl_fdm &sfdm = _sitl->state;
|
|
|
|
|
|
|
|
fdm.version = 0x18;
|
|
|
|
fdm.padding = 0;
|
2018-10-10 16:03:11 -03:00
|
|
|
fdm.longitude = DEG_TO_RAD_DOUBLE*sfdm.longitude;
|
|
|
|
fdm.latitude = DEG_TO_RAD_DOUBLE*sfdm.latitude;
|
2016-01-01 02:09:07 -04:00
|
|
|
fdm.altitude = sfdm.altitude;
|
|
|
|
fdm.agl = sfdm.altitude;
|
|
|
|
fdm.phi = radians(sfdm.rollDeg);
|
|
|
|
fdm.theta = radians(sfdm.pitchDeg);
|
|
|
|
fdm.psi = radians(sfdm.yawDeg);
|
2022-08-25 10:30:02 -03:00
|
|
|
fdm.vcas = sfdm.velocity_air_bf.length()/0.3048;
|
2016-01-03 20:09:27 -04:00
|
|
|
if (_vehicle == ArduCopter) {
|
|
|
|
fdm.num_engines = 4;
|
|
|
|
for (uint8_t i=0; i<4; i++) {
|
|
|
|
fdm.rpm[i] = constrain_float((pwm_output[i]-1000), 0, 1000);
|
|
|
|
}
|
|
|
|
} else {
|
|
|
|
fdm.num_engines = 4;
|
|
|
|
fdm.rpm[0] = constrain_float((pwm_output[2]-1000)*3, 0, 3000);
|
|
|
|
// for quadplane
|
|
|
|
fdm.rpm[1] = constrain_float((pwm_output[5]-1000)*12, 0, 12000);
|
|
|
|
fdm.rpm[2] = constrain_float((pwm_output[6]-1000)*12, 0, 12000);
|
|
|
|
fdm.rpm[3] = constrain_float((pwm_output[7]-1000)*12, 0, 12000);
|
|
|
|
}
|
2016-01-01 02:09:07 -04:00
|
|
|
fdm.ByteSwap();
|
|
|
|
|
|
|
|
fg_socket.send(&fdm, sizeof(fdm));
|
|
|
|
}
|
2015-05-02 07:27:33 -03:00
|
|
|
|
|
|
|
/*
|
|
|
|
get FDM input from a local model
|
|
|
|
*/
|
|
|
|
void SITL_State::_fdm_input_local(void)
|
|
|
|
{
|
2018-07-31 09:32:43 -03:00
|
|
|
struct sitl_input input;
|
2015-05-02 07:27:33 -03:00
|
|
|
|
2015-05-02 08:54:19 -03:00
|
|
|
// check for direct RC input
|
2021-01-18 23:36:07 -04:00
|
|
|
if (_sitl != nullptr) {
|
|
|
|
_check_rc_input();
|
|
|
|
}
|
2015-05-02 08:54:19 -03:00
|
|
|
|
|
|
|
// construct servos structure for FDM
|
2015-05-02 07:27:33 -03:00
|
|
|
_simulator_servos(input);
|
2015-05-02 08:54:19 -03:00
|
|
|
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_JSON_MASTER_ENABLED
|
2021-04-24 21:31:35 -03:00
|
|
|
// read servo inputs from ride along flight controllers
|
|
|
|
ride_along.receive(input);
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2021-04-24 21:31:35 -03:00
|
|
|
|
2015-05-02 08:54:19 -03:00
|
|
|
// update the model
|
2019-08-15 03:52:50 -03:00
|
|
|
sitl_model->update_model(input);
|
2015-05-02 08:54:19 -03:00
|
|
|
|
|
|
|
// get FDM output from the model
|
2016-03-25 07:35:16 -03:00
|
|
|
if (_sitl) {
|
|
|
|
sitl_model->fill_fdm(_sitl->state);
|
2016-05-03 23:50:02 -03:00
|
|
|
|
2021-07-30 07:13:59 -03:00
|
|
|
if (_sitl->rc_fail == SITL::SIM::SITL_RCFail_None) {
|
2016-06-04 16:54:46 -03:00
|
|
|
for (uint8_t i=0; i< _sitl->state.rcin_chan_count; i++) {
|
|
|
|
pwm_input[i] = 1000 + _sitl->state.rcin[i]*1000;
|
|
|
|
}
|
2016-05-03 23:50:02 -03:00
|
|
|
}
|
2016-03-25 07:35:16 -03:00
|
|
|
}
|
2015-05-02 08:54:19 -03:00
|
|
|
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_JSON_MASTER_ENABLED
|
2021-04-24 21:31:35 -03:00
|
|
|
// output JSON state to ride along flight controllers
|
|
|
|
ride_along.send(_sitl->state,sitl_model->get_position_relhome());
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2021-04-24 21:31:35 -03:00
|
|
|
|
2016-10-30 02:24:21 -03:00
|
|
|
if (gimbal != nullptr) {
|
2015-05-24 23:11:16 -03:00
|
|
|
gimbal->update();
|
|
|
|
}
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_ADSB_ENABLED
|
2016-10-30 02:24:21 -03:00
|
|
|
if (adsb != nullptr) {
|
2021-11-09 02:23:34 -04:00
|
|
|
adsb->update(*sitl_model);
|
2015-11-18 21:22:47 -04:00
|
|
|
}
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2018-03-07 21:25:34 -04:00
|
|
|
if (vicon != nullptr) {
|
|
|
|
Quaternion attitude;
|
|
|
|
sitl_model->get_attitude(attitude);
|
|
|
|
vicon->update(sitl_model->get_location(),
|
2021-07-10 03:19:32 -03:00
|
|
|
sitl_model->get_position_relhome(),
|
2020-05-14 23:14:22 -03:00
|
|
|
sitl_model->get_velocity_ef(),
|
2018-03-07 21:25:34 -04:00
|
|
|
attitude);
|
|
|
|
}
|
2019-10-28 23:53:01 -03:00
|
|
|
if (benewake_tf02 != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
benewake_tf02->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
|
|
|
if (benewake_tf03 != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
benewake_tf03->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
|
|
|
if (benewake_tfmini != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
benewake_tfmini->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
2023-06-16 15:31:34 -03:00
|
|
|
if (nooploop != nullptr) {
|
|
|
|
nooploop->update(sitl_model->rangefinder_range());
|
|
|
|
}
|
2022-08-01 20:44:01 -03:00
|
|
|
if (teraranger_serial != nullptr) {
|
|
|
|
teraranger_serial->update(sitl_model->rangefinder_range());
|
|
|
|
}
|
2019-10-28 23:53:01 -03:00
|
|
|
if (lightwareserial != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
lightwareserial->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
2020-06-30 08:10:28 -03:00
|
|
|
if (lightwareserial_binary != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
lightwareserial_binary->update(sitl_model->rangefinder_range());
|
2020-06-30 08:10:28 -03:00
|
|
|
}
|
2019-10-28 23:53:01 -03:00
|
|
|
if (lanbao != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
lanbao->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
|
|
|
if (blping != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
blping->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
|
|
|
if (leddarone != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
leddarone->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
2023-05-12 22:24:27 -03:00
|
|
|
if (rds02uf != nullptr) {
|
|
|
|
rds02uf->update(sitl_model->rangefinder_range());
|
|
|
|
}
|
2021-10-25 18:41:10 -03:00
|
|
|
if (USD1_v0 != nullptr) {
|
|
|
|
USD1_v0->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
2021-10-25 18:41:10 -03:00
|
|
|
if (USD1_v1 != nullptr) {
|
|
|
|
USD1_v1->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
|
|
|
if (maxsonarseriallv != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
maxsonarseriallv->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
|
|
|
if (wasp != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
wasp->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
|
|
|
if (nmea != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
nmea->update(sitl_model->rangefinder_range());
|
2019-10-28 23:53:01 -03:00
|
|
|
}
|
2020-04-21 00:29:11 -03:00
|
|
|
if (rf_mavlink != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
rf_mavlink->update(sitl_model->rangefinder_range());
|
2020-04-21 00:29:11 -03:00
|
|
|
}
|
2020-06-14 20:36:08 -03:00
|
|
|
if (gyus42v2 != nullptr) {
|
2020-08-04 00:47:23 -03:00
|
|
|
gyus42v2->update(sitl_model->rangefinder_range());
|
2020-06-14 20:36:08 -03:00
|
|
|
}
|
2021-10-10 22:12:20 -03:00
|
|
|
if (efi_ms != nullptr) {
|
|
|
|
efi_ms->update();
|
|
|
|
}
|
2015-05-24 23:11:16 -03:00
|
|
|
|
2019-12-16 22:21:13 -04:00
|
|
|
if (frsky_d != nullptr) {
|
|
|
|
frsky_d->update();
|
|
|
|
}
|
|
|
|
// if (frsky_sport != nullptr) {
|
|
|
|
// frsky_sport->update();
|
|
|
|
// }
|
|
|
|
// if (frsky_sportpassthrough != nullptr) {
|
|
|
|
// frsky_sportpassthrough->update();
|
|
|
|
// }
|
2020-06-04 14:59:30 -03:00
|
|
|
|
2022-01-14 22:47:15 -04:00
|
|
|
#if AP_SIM_CRSF_ENABLED
|
2020-06-04 14:59:30 -03:00
|
|
|
if (crsf != nullptr) {
|
|
|
|
crsf->update();
|
|
|
|
}
|
2022-01-14 22:47:15 -04:00
|
|
|
#endif
|
2020-06-04 14:59:30 -03:00
|
|
|
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_PS_RPLIDARA2_ENABLED
|
2019-11-20 22:11:42 -04:00
|
|
|
if (rplidara2 != nullptr) {
|
|
|
|
rplidara2->update(sitl_model->get_location());
|
|
|
|
}
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2019-12-16 22:21:13 -04:00
|
|
|
|
2021-02-04 21:46:44 -04:00
|
|
|
#if HAL_SIM_PS_RPLIDARA1_ENABLED
|
|
|
|
if (rplidara1 != nullptr) {
|
|
|
|
rplidara1->update(sitl_model->get_location());
|
|
|
|
}
|
|
|
|
#endif
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_PS_TERARANGERTOWER_ENABLED
|
2020-12-07 07:07:21 -04:00
|
|
|
if (terarangertower != nullptr) {
|
|
|
|
terarangertower->update(sitl_model->get_location());
|
|
|
|
}
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2020-12-07 07:07:21 -04:00
|
|
|
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_PS_LIGHTWARE_SF45B_ENABLED
|
2020-12-08 06:13:41 -04:00
|
|
|
if (sf45b != nullptr) {
|
|
|
|
sf45b->update(sitl_model->get_location());
|
|
|
|
}
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
|
|
|
|
2020-12-29 06:30:34 -04:00
|
|
|
if (vectornav != nullptr) {
|
|
|
|
vectornav->update();
|
|
|
|
}
|
2020-12-08 06:13:41 -04:00
|
|
|
|
2021-09-23 19:26:03 -03:00
|
|
|
if (lord != nullptr) {
|
|
|
|
lord->update();
|
|
|
|
}
|
|
|
|
|
2021-11-01 04:03:23 -03:00
|
|
|
#if HAL_SIM_AIS_ENABLED
|
2021-04-11 11:42:17 -03:00
|
|
|
if (ais != nullptr) {
|
|
|
|
ais->update();
|
|
|
|
}
|
2021-11-01 04:03:23 -03:00
|
|
|
#endif
|
2021-10-16 00:10:40 -03:00
|
|
|
for (uint8_t i=0; i<ARRAY_SIZE(gps); i++) {
|
|
|
|
if (gps[i] != nullptr) {
|
|
|
|
gps[i]->update();
|
|
|
|
}
|
|
|
|
}
|
2021-04-11 11:42:17 -03:00
|
|
|
|
2016-09-21 14:02:15 -03:00
|
|
|
if (_sitl && _use_fg_view) {
|
2016-03-25 07:35:16 -03:00
|
|
|
_output_to_flightgear();
|
|
|
|
}
|
2016-01-01 02:09:07 -04:00
|
|
|
|
2015-05-02 08:54:19 -03:00
|
|
|
// update simulation time
|
2016-03-25 07:35:16 -03:00
|
|
|
if (_sitl) {
|
|
|
|
hal.scheduler->stop_clock(_sitl->state.timestamp_us);
|
|
|
|
} else {
|
|
|
|
hal.scheduler->stop_clock(AP_HAL::micros64()+100);
|
|
|
|
}
|
2015-05-02 08:54:19 -03:00
|
|
|
|
2016-11-19 02:21:54 -04:00
|
|
|
set_height_agl();
|
|
|
|
|
2015-05-02 07:27:33 -03:00
|
|
|
_synthetic_clock_mode = true;
|
|
|
|
_update_count++;
|
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
|
|
|
|
/*
|
2015-05-02 07:27:33 -03:00
|
|
|
create sitl_input structure for sending to FDM
|
2012-12-14 21:54:26 -04:00
|
|
|
*/
|
2018-07-31 09:32:43 -03:00
|
|
|
void SITL_State::_simulator_servos(struct sitl_input &input)
|
2012-12-14 21:54:26 -04:00
|
|
|
{
|
2015-05-02 07:27:33 -03:00
|
|
|
static uint32_t last_update_usec;
|
|
|
|
|
2015-05-04 21:59:07 -03:00
|
|
|
/* this maps the registers used for PWM outputs. The RC
|
|
|
|
* driver updates these whenever it wants the channel output
|
|
|
|
* to change */
|
|
|
|
|
2017-08-07 09:05:52 -03:00
|
|
|
if (last_update_usec == 0 || !output_ready) {
|
2021-06-25 23:14:15 -03:00
|
|
|
for (uint8_t i=0; i<SITL_NUM_CHANNELS; i++) {
|
2015-05-04 21:59:07 -03:00
|
|
|
pwm_output[i] = 1000;
|
|
|
|
}
|
|
|
|
if (_vehicle == ArduPlane) {
|
|
|
|
pwm_output[0] = pwm_output[1] = pwm_output[3] = 1500;
|
|
|
|
}
|
2020-03-26 21:51:15 -03:00
|
|
|
if (_vehicle == Rover) {
|
2015-05-04 21:59:07 -03:00
|
|
|
pwm_output[0] = pwm_output[1] = pwm_output[2] = pwm_output[3] = 1500;
|
|
|
|
}
|
2022-03-30 13:56:15 -03:00
|
|
|
if (_vehicle == ArduSub) {
|
|
|
|
pwm_output[0] = pwm_output[1] = pwm_output[2] = pwm_output[3] =
|
|
|
|
pwm_output[4] = pwm_output[5] = pwm_output[6] = pwm_output[7] = 1500;
|
|
|
|
}
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2015-05-04 21:59:07 -03:00
|
|
|
// output at chosen framerate
|
2015-11-19 23:11:17 -04:00
|
|
|
uint32_t now = AP_HAL::micros();
|
2015-05-04 21:59:07 -03:00
|
|
|
last_update_usec = now;
|
2013-09-15 20:16:52 -03:00
|
|
|
|
2021-10-26 21:48:23 -03:00
|
|
|
float altitude = AP::baro().get_altitude();
|
2016-07-15 22:36:59 -03:00
|
|
|
float wind_speed = 0;
|
|
|
|
float wind_direction = 0;
|
2018-01-30 12:37:18 -04:00
|
|
|
float wind_dir_z = 0;
|
2018-04-30 12:26:15 -03:00
|
|
|
|
|
|
|
// give 5 seconds to calibrate airspeed sensor at 0 wind speed
|
|
|
|
if (wind_start_delay_micros == 0) {
|
|
|
|
wind_start_delay_micros = now;
|
|
|
|
} else if (_sitl && (now - wind_start_delay_micros) > 5000000 ) {
|
2016-07-15 22:36:59 -03:00
|
|
|
// The EKF does not like step inputs so this LPF keeps it happy.
|
2018-01-30 12:37:18 -04:00
|
|
|
wind_speed = _sitl->wind_speed_active = (0.95f*_sitl->wind_speed_active) + (0.05f*_sitl->wind_speed);
|
2016-07-15 22:36:59 -03:00
|
|
|
wind_direction = _sitl->wind_direction_active = (0.95f*_sitl->wind_direction_active) + (0.05f*_sitl->wind_direction);
|
2018-01-30 12:37:18 -04:00
|
|
|
wind_dir_z = _sitl->wind_dir_z_active = (0.95f*_sitl->wind_dir_z_active) + (0.05f*_sitl->wind_dir_z);
|
2018-04-30 12:26:15 -03:00
|
|
|
|
|
|
|
// pass wind into simulators using different wind types via param SIM_WIND_T*.
|
|
|
|
switch (_sitl->wind_type) {
|
2021-07-30 07:13:59 -03:00
|
|
|
case SITL::SIM::WIND_TYPE_SQRT:
|
2018-04-30 12:26:15 -03:00
|
|
|
if (altitude < _sitl->wind_type_alt) {
|
|
|
|
wind_speed *= sqrtf(MAX(altitude / _sitl->wind_type_alt, 0));
|
|
|
|
}
|
|
|
|
break;
|
|
|
|
|
2021-07-30 07:13:59 -03:00
|
|
|
case SITL::SIM::WIND_TYPE_COEF:
|
2018-04-30 12:26:15 -03:00
|
|
|
wind_speed += (altitude - _sitl->wind_type_alt) * _sitl->wind_type_coef;
|
|
|
|
break;
|
2016-07-15 22:36:59 -03:00
|
|
|
|
2021-07-30 07:13:59 -03:00
|
|
|
case SITL::SIM::WIND_TYPE_NO_LIMIT:
|
2018-04-30 12:26:15 -03:00
|
|
|
default:
|
|
|
|
break;
|
|
|
|
}
|
|
|
|
|
|
|
|
// never allow negative wind velocity
|
|
|
|
wind_speed = MAX(wind_speed, 0);
|
|
|
|
}
|
2016-07-15 22:36:59 -03:00
|
|
|
|
2015-05-22 22:04:13 -03:00
|
|
|
input.wind.speed = wind_speed;
|
2016-07-15 22:36:59 -03:00
|
|
|
input.wind.direction = wind_direction;
|
2016-03-25 07:35:16 -03:00
|
|
|
input.wind.turbulence = _sitl?_sitl->wind_turbulance:0;
|
2018-01-30 12:37:18 -04:00
|
|
|
input.wind.dir_z = wind_dir_z;
|
2015-05-22 22:04:13 -03:00
|
|
|
|
2021-06-25 23:14:15 -03:00
|
|
|
for (uint8_t i=0; i<SITL_NUM_CHANNELS; i++) {
|
2015-05-04 21:59:07 -03:00
|
|
|
if (pwm_output[i] == 0xFFFF) {
|
|
|
|
input.servos[i] = 0;
|
|
|
|
} else {
|
|
|
|
input.servos[i] = pwm_output[i];
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
2021-06-28 19:24:15 -03:00
|
|
|
if (_sitl != nullptr) {
|
|
|
|
// FETtec ESC simulation support. Input signals of 1000-2000
|
|
|
|
// are positive thrust, 0 to 1000 are negative thrust. Deeper
|
|
|
|
// changes required to support negative thrust - potentially
|
|
|
|
// adding a field to input.
|
|
|
|
if (_sitl != nullptr) {
|
|
|
|
if (_sitl->fetteconewireesc_sim.enabled()) {
|
|
|
|
_sitl->fetteconewireesc_sim.update_sitl_input_pwm(input);
|
|
|
|
for (uint8_t i=0; i<ARRAY_SIZE(input.servos); i++) {
|
|
|
|
if (input.servos[i] != 0 && input.servos[i] < 1000) {
|
|
|
|
AP_HAL::panic("Bad input servo value (%u)", input.servos[i]);
|
|
|
|
}
|
|
|
|
}
|
|
|
|
}
|
|
|
|
}
|
|
|
|
}
|
|
|
|
|
2016-03-26 00:17:12 -03:00
|
|
|
float engine_mul = _sitl?_sitl->engine_mul.get():1;
|
2017-03-20 17:41:09 -03:00
|
|
|
uint8_t engine_fail = _sitl?_sitl->engine_fail.get():0;
|
2019-12-24 17:19:05 -04:00
|
|
|
float throttle = 0.0f;
|
2016-03-25 07:35:16 -03:00
|
|
|
|
2017-04-07 22:50:28 -03:00
|
|
|
if (engine_fail >= ARRAY_SIZE(input.servos)) {
|
2017-03-20 17:41:09 -03:00
|
|
|
engine_fail = 0;
|
|
|
|
}
|
2017-04-07 22:50:28 -03:00
|
|
|
// apply engine multiplier to motor defined by the SIM_ENGINE_FAIL parameter
|
2020-03-26 21:51:15 -03:00
|
|
|
if (_vehicle != Rover) {
|
2017-03-05 09:20:20 -04:00
|
|
|
input.servos[engine_fail] = ((input.servos[engine_fail]-1000) * engine_mul) + 1000;
|
|
|
|
} else {
|
|
|
|
input.servos[engine_fail] = static_cast<uint16_t>(((input.servos[engine_fail] - 1500) * engine_mul) + 1500);
|
|
|
|
}
|
2019-12-24 17:19:05 -04:00
|
|
|
|
2015-05-04 21:59:07 -03:00
|
|
|
if (_vehicle == ArduPlane) {
|
2020-01-16 15:00:58 -04:00
|
|
|
float forward_throttle = constrain_float((input.servos[2] - 1000) / 1000.0f, 0.0f, 1.0f);
|
|
|
|
// do a little quadplane dance
|
|
|
|
float hover_throttle = 0.0f;
|
|
|
|
uint8_t running_motors = 0;
|
2022-08-18 04:22:01 -03:00
|
|
|
uint32_t mask = _sitl->state.motor_mask;
|
|
|
|
uint8_t bit;
|
|
|
|
while ((bit = __builtin_ffs(mask)) != 0) {
|
|
|
|
uint8_t motor = bit-1;
|
|
|
|
mask &= ~(1U<<motor);
|
|
|
|
float motor_throttle = constrain_float((input.servos[motor] - 1000) / 1000.0f, 0.0f, 1.0f);
|
2020-01-16 15:00:58 -04:00
|
|
|
// update motor_on flag
|
|
|
|
if (!is_zero(motor_throttle)) {
|
|
|
|
hover_throttle += motor_throttle;
|
|
|
|
running_motors++;
|
|
|
|
}
|
|
|
|
}
|
|
|
|
if (running_motors > 0) {
|
|
|
|
hover_throttle /= running_motors;
|
|
|
|
}
|
|
|
|
if (!is_zero(forward_throttle)) {
|
|
|
|
throttle = forward_throttle;
|
|
|
|
} else {
|
|
|
|
throttle = hover_throttle;
|
|
|
|
}
|
2020-03-26 21:51:15 -03:00
|
|
|
} else if (_vehicle == Rover) {
|
2017-03-05 09:20:20 -04:00
|
|
|
input.servos[2] = static_cast<uint16_t>(constrain_int16(input.servos[2], 1000, 2000));
|
|
|
|
input.servos[0] = static_cast<uint16_t>(constrain_int16(input.servos[0], 1000, 2000));
|
2019-12-24 17:19:05 -04:00
|
|
|
throttle = fabsf((input.servos[2] - 1500) / 500.0f);
|
2015-05-04 21:59:07 -03:00
|
|
|
} else {
|
2013-05-19 02:29:08 -03:00
|
|
|
// run checks on each motor
|
2019-12-24 17:19:05 -04:00
|
|
|
uint8_t running_motors = 0;
|
2022-08-18 04:22:01 -03:00
|
|
|
uint32_t mask = _sitl->state.motor_mask;
|
|
|
|
uint8_t bit;
|
|
|
|
while ((bit = __builtin_ffs(mask)) != 0) {
|
|
|
|
const uint8_t motor = bit-1;
|
|
|
|
mask &= ~(1U<<motor);
|
|
|
|
float motor_throttle = constrain_float((input.servos[motor] - 1000) / 1000.0f, 0.0f, 1.0f);
|
2013-05-19 02:29:08 -03:00
|
|
|
// update motor_on flag
|
2019-12-24 17:19:05 -04:00
|
|
|
if (!is_zero(motor_throttle)) {
|
|
|
|
throttle += motor_throttle;
|
|
|
|
running_motors++;
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
|
|
|
}
|
2019-12-24 17:19:05 -04:00
|
|
|
if (running_motors > 0) {
|
|
|
|
throttle /= running_motors;
|
|
|
|
}
|
2015-05-04 21:59:07 -03:00
|
|
|
}
|
2016-03-25 07:35:16 -03:00
|
|
|
if (_sitl) {
|
2019-12-24 17:19:05 -04:00
|
|
|
_sitl->throttle = throttle;
|
2016-03-25 07:35:16 -03:00
|
|
|
}
|
2012-12-14 21:54:26 -04:00
|
|
|
|
2016-03-25 07:35:16 -03:00
|
|
|
float voltage = 0;
|
|
|
|
_current = 0;
|
2015-11-22 22:31:29 -04:00
|
|
|
|
2016-03-25 07:35:16 -03:00
|
|
|
if (_sitl != nullptr) {
|
|
|
|
if (_sitl->state.battery_voltage <= 0) {
|
2017-10-27 14:24:53 -03:00
|
|
|
if (_vehicle == ArduSub) {
|
|
|
|
voltage = _sitl->batt_voltage;
|
2021-06-25 23:14:15 -03:00
|
|
|
for (uint8_t i=0; i<6; i++) {
|
2017-10-27 14:24:53 -03:00
|
|
|
float pwm = input.servos[i];
|
|
|
|
//printf("i: %d, pwm: %.2f\n", i, pwm);
|
|
|
|
float fraction = fabsf((pwm - 1500) / 500.0f);
|
|
|
|
|
|
|
|
voltage -= fraction * 0.5f;
|
|
|
|
|
|
|
|
float draw = fraction * 15;
|
|
|
|
_current += draw;
|
|
|
|
}
|
|
|
|
} else {
|
|
|
|
// simulate simple battery setup
|
|
|
|
// lose 0.7V at full throttle
|
2019-12-24 17:19:05 -04:00
|
|
|
voltage = _sitl->batt_voltage - 0.7f * throttle;
|
2017-10-27 14:24:53 -03:00
|
|
|
|
|
|
|
// assume 50A at full throttle
|
2019-12-24 17:19:05 -04:00
|
|
|
_current = 50.0f * throttle;
|
2017-10-27 14:24:53 -03:00
|
|
|
}
|
2016-03-25 07:35:16 -03:00
|
|
|
} else {
|
|
|
|
// FDM provides voltage and current
|
|
|
|
voltage = _sitl->state.battery_voltage;
|
|
|
|
_current = _sitl->state.battery_current;
|
|
|
|
}
|
2015-11-22 22:31:29 -04:00
|
|
|
}
|
2015-05-02 07:27:33 -03:00
|
|
|
|
2013-09-30 02:34:47 -03:00
|
|
|
// assume 3DR power brick
|
2023-05-04 16:50:02 -03:00
|
|
|
voltage_pin_voltage = (voltage / 10.1f);
|
|
|
|
current_pin_voltage = _current/17.0f;
|
2018-03-07 22:11:05 -04:00
|
|
|
// fake battery2 as just a 25% gain on the first one
|
2023-05-04 16:50:02 -03:00
|
|
|
voltage2_pin_voltage = voltage_pin_voltage * .25f;
|
|
|
|
current2_pin_voltage = current_pin_voltage * .25f;
|
2015-05-02 07:27:33 -03:00
|
|
|
}
|
|
|
|
|
2012-12-14 21:54:26 -04:00
|
|
|
void SITL_State::init(int argc, char * const argv[])
|
|
|
|
{
|
2019-09-15 03:46:13 -03:00
|
|
|
pwm_input[0] = pwm_input[1] = pwm_input[3] = 1500;
|
|
|
|
pwm_input[4] = pwm_input[7] = 1800;
|
|
|
|
pwm_input[2] = pwm_input[5] = pwm_input[6] = 1000;
|
2012-12-17 23:56:21 -04:00
|
|
|
|
2016-01-10 02:23:32 -04:00
|
|
|
_scheduler = Scheduler::from(hal.scheduler);
|
2015-05-04 21:59:07 -03:00
|
|
|
_parse_command_line(argc, argv);
|
2012-12-14 21:54:26 -04:00
|
|
|
}
|
|
|
|
|
2015-01-03 06:47:54 -04:00
|
|
|
/*
|
2016-11-19 02:21:54 -04:00
|
|
|
set height above the ground in meters
|
2015-01-03 06:47:54 -04:00
|
|
|
*/
|
2016-11-19 02:21:54 -04:00
|
|
|
void SITL_State::set_height_agl(void)
|
2015-01-03 06:47:54 -04:00
|
|
|
{
|
2015-05-04 21:59:07 -03:00
|
|
|
static float home_alt = -1;
|
2015-01-03 06:47:54 -04:00
|
|
|
|
2018-11-04 01:31:04 -04:00
|
|
|
if (!_sitl) {
|
|
|
|
// in example program
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
2018-08-14 23:35:38 -03:00
|
|
|
if (is_equal(home_alt, -1.0f) && _sitl->state.altitude > 0) {
|
2015-01-03 06:47:54 -04:00
|
|
|
// remember home altitude as first non-zero altitude
|
2015-05-04 21:59:07 -03:00
|
|
|
home_alt = _sitl->state.altitude;
|
2015-01-03 06:47:54 -04:00
|
|
|
}
|
|
|
|
|
2016-06-03 15:07:36 -03:00
|
|
|
#if AP_TERRAIN_AVAILABLE
|
2020-07-20 22:56:10 -03:00
|
|
|
if (_sitl != nullptr &&
|
2018-03-31 02:11:31 -03:00
|
|
|
_sitl->terrain_enable) {
|
2015-01-03 06:47:54 -04:00
|
|
|
// get height above terrain from AP_Terrain. This assumes
|
|
|
|
// AP_Terrain is working
|
|
|
|
float terrain_height_amsl;
|
2023-02-02 18:58:38 -04:00
|
|
|
Location location;
|
2015-01-03 06:47:54 -04:00
|
|
|
location.lat = _sitl->state.latitude*1.0e7;
|
|
|
|
location.lng = _sitl->state.longitude*1.0e7;
|
|
|
|
|
2020-07-20 22:56:10 -03:00
|
|
|
AP_Terrain *_terrain = AP_Terrain::get_singleton();
|
|
|
|
if (_terrain != nullptr &&
|
2022-03-27 18:27:33 -03:00
|
|
|
_terrain->height_amsl(location, terrain_height_amsl, false)) {
|
2016-11-19 02:21:54 -04:00
|
|
|
_sitl->height_agl = _sitl->state.altitude - terrain_height_amsl;
|
|
|
|
return;
|
2015-01-03 06:47:54 -04:00
|
|
|
}
|
|
|
|
}
|
2016-06-03 15:07:36 -03:00
|
|
|
#endif
|
2015-01-03 06:47:54 -04:00
|
|
|
|
2018-03-31 02:11:31 -03:00
|
|
|
if (_sitl != nullptr) {
|
|
|
|
// fall back to flat earth model
|
|
|
|
_sitl->height_agl = _sitl->state.altitude - home_alt;
|
|
|
|
}
|
2015-01-03 06:47:54 -04:00
|
|
|
}
|
|
|
|
|
2012-12-14 21:54:26 -04:00
|
|
|
#endif
|