|
Paparazzi UAS
v5.18.0_stable
Paparazzi is a free software Unmanned Aircraft System.
|
Go to the documentation of this file.
34 #pragma GCC diagnostic push
35 #pragma GCC diagnostic ignored "-Wunused-parameter"
37 #include <FGFDMExec.h>
38 #include <FGJSBBase.h>
39 #include <initialization/FGInitialCondition.h>
40 #include <models/FGPropulsion.h>
41 #include <models/FGGroundReactions.h>
42 #include <models/FGAccelerations.h>
43 #include <models/FGAuxiliary.h>
44 #include <models/FGAtmosphere.h>
45 #include <models/FGAircraft.h>
46 #include <models/FGFCS.h>
47 #include <models/atmosphere/FGWinds.h>
50 #include <models/propulsion/FGThruster.h>
51 #include <models/propulsion/FGPropeller.h>
54 #pragma GCC diagnostic pop
66 #include "generated/airframe.h"
67 #include "generated/flight_plan.h"
70 #define MetersOfFeet(_f) ((_f)/3.2808399)
71 #define FeetOfMeters(_m) ((_m)*3.2808399)
73 #define PascalOfPsf(_p) ((_p) * 47.8802588889)
74 #define CelsiusOfRankine(_r) (((_r) - 491.67) / 1.8)
77 #if NPS_JSBSIM_USE_SGPATH
78 #define JSBSIM_PATH(_x) SGPath(_x)
80 #define JSBSIM_PATH(_x) _x
86 #ifndef NPS_JSBSIM_MODEL
87 #define NPS_JSBSIM_MODEL AIRFRAME_NAME
90 #ifdef NPS_INITIAL_CONDITITONS
91 #warning NPS_INITIAL_CONDITITONS was replaced by NPS_JSBSIM_INIT!
92 #warning Defaulting to flight plan location.
98 #ifndef NPS_JSBSIM_PITCH_TRIM
99 #define NPS_JSBSIM_PITCH_TRIM 0.0
102 #ifndef NPS_JSBSIM_ROLL_TRIM
103 #define NPS_JSBSIM_ROLL_TRIM 0.0
106 #ifndef NPS_JSBSIM_YAW_TRIM
107 #define NPS_JSBSIM_YAW_TRIM 0.0
113 #define DEG2RAD 0.017
115 #ifndef NPS_JSBSIM_ELEVATOR_MAX_RAD
116 #define NPS_JSBSIM_ELEVATOR_MAX_RAD (20.0*DEG2RAD)
119 #ifndef NPS_JSBSIM_AILERON_MAX_RAD
120 #define NPS_JSBSIM_AILERON_MAX_RAD (20.0*DEG2RAD)
123 #ifndef NPS_JSBSIM_RUDDER_MAX_RAD
124 #define NPS_JSBSIM_RUDDER_MAX_RAD (20.0*DEG2RAD)
127 #ifndef NPS_JSBSIM_FLAP_MAX_RAD
128 #define NPS_JSBSIM_FLAP_MAX_RAD (20.0*DEG2RAD)
134 #define MIN_DT (1.0/10240.0)
138 using namespace JSBSim;
197 printf(
"fdm.time,fdm.body_ecef_accel.x,fdm.body_ecef_accel.y,fdm.body_ecef_accel.z,fdm.ltp_ecef_accel.x,fdm.ltp_ecef_accel.y,fdm.ltp_ecef_accel.z,fdm.ecef_ecef_accel.x,fdm.ecef_ecef_accel.y,fdm.ecef_ecef_accel.z,fdm.ltpprz_ecef_accel.z,fdm.ltpprz_ecef_accel.y,fdm.ltpprz_ecef_accel.z,fdm.agl\n");
207 #ifdef NPS_JSBSIM_LAUNCHSPEED
208 static bool already_launched =
FALSE;
210 if (launch && !already_launched) {
211 printf(
"Launching with speed of %.1f m/s!\n", (
float)NPS_JSBSIM_LAUNCHSPEED);
214 already_launched =
TRUE;
241 if (numDT_to_impact <= 1.0) {
256 for (i = 0; i < num_steps; i++) {
264 printf(
"Error: FDM simulation encountered a total of %i NaN values at simulation time %f.\n",
fdm.
nan_count,
fdm.
time);
265 printf(
"It is likely the simulation diverged and gave non-physical results. If you did\n");
266 printf(
"not crash, check your model and/or initial conditions. Exiting with status 1.\n");
274 FGWinds *Winds =
FDMExec->GetWinds();
276 Winds->SetWindPsi(
dir);
281 FGWinds *Winds =
FDMExec->GetWinds();
288 FGWinds *Winds =
FDMExec->GetWinds();
291 Winds->SetProbabilityOfExceedence(turbulence_severity);
296 FDMExec->GetAtmosphere()->SetTemperature(temp,
h, FGAtmosphere::eCelsius);
307 #ifdef NPS_ACTUATOR_NAMES
309 const char *names[] = NPS_ACTUATOR_NAMES;
313 for (i = 0; i < commands_nb; i++) {
314 sprintf(buf,
"fcs/%s", names[i]);
315 property = string(buf);
316 FDMExec->GetPropertyManager()->GetNode(property)->SetDouble(
"",
commands[i]);
321 FGFCS *FCS =
FDMExec->GetFCS();
328 #ifdef COMMAND_THROTTLE
329 FGPropulsion *FProp =
FDMExec->GetPropulsion();
330 for (
unsigned int i = 0; i <
FDMExec->GetPropulsion()->GetNumEngines(); i++) {
331 FCS->SetThrottleCmd(i,
commands[COMMAND_THROTTLE]);
334 if (
commands[COMMAND_THROTTLE] > 0.01) {
335 FProp->SetStarter(1);
337 FProp->SetStarter(0);
343 FCS->SetDaCmd(
commands[COMMAND_ROLL]);
347 FCS->SetDeCmd(
commands[COMMAND_PITCH]);
351 FCS->SetDrCmd(
commands[COMMAND_YAW]);
355 FCS->SetDfCmd(
commands[COMMAND_FLAP]);
367 fdm.
time =
FDMExec->GetPropertyManager()->GetNode(
"simulation/sim-time-sec")->getDoubleValue();
373 FGPropagate *propagate =
FDMExec->GetPropagate();
374 FGAccelerations *accelerations =
FDMExec->GetAccelerations();
382 fdm.
hmsl = propagate->GetAltitudeASLmeters();
400 const FGColumnVector3 &fg_ltp_ecef_accel = propagate->GetTb2l() * accelerations->GetUVWdot();
408 const FGColumnVector3 &fg_ecef_ecef_vel = propagate->GetECEFVelocity();
411 const FGColumnVector3 &fg_ecef_ecef_accel = propagate->GetTb2ec() * accelerations->GetUVWdot();
443 const FGQuaternion jsb_quat = propagate->GetQuaternion();
465 const FGColumnVector3 &fg_wind_ned =
FDMExec->GetWinds()->GetTotalWindNED();
481 fdm.
aoa=
FDMExec->GetPropertyManager()->GetNode(
"aero/alpha-rad")->getDoubleValue();
482 fdm.
sideslip =
FDMExec->GetPropertyManager()->GetNode(
"aero/beta-rad")->getDoubleValue();
488 fdm.
rudder = (
FDMExec->GetPropertyManager()->GetNode(
"fcs/rudder-pos-rad")->getDoubleValue()) /
490 fdm.
left_aileron = (-1 *
FDMExec->GetPropertyManager()->GetNode(
"fcs/left-aileron-pos-rad")->getDoubleValue()) /
494 fdm.
elevator = (
FDMExec->GetPropertyManager()->GetNode(
"fcs/elevator-pos-rad")->getDoubleValue()) /
501 FGPropulsion *FGProp =
FDMExec->GetPropulsion();
510 FGEngine *FGEng = FGProp->GetEngine(k);
511 FGThruster *FGThrst = FGEng->GetThruster();
513 fdm.
rpm[k] = (float) FGThrst->GetRPM();
534 string jsbsim_home =
"/conf/simulator/jsbsim/";
535 string jsbsim_ic_name;
537 char* pprz_home = getenv(
"PAPARAZZI_HOME");
540 if (strlen(pprz_home) <
sizeof(buf)) {
541 cnt = snprintf(buf, strlen(pprz_home) + 1,
"%s", pprz_home);
542 rootdir = string(buf) + jsbsim_home;
549 cout <<
"PPRZ_HOME not set correctly, exiting..." << endl;
556 #ifdef NPS_JSBSIM_INIT
557 jsbsim_ic_name = NPS_JSBSIM_INIT;
574 cerr <<
" JSBSim could not be started" << endl << endl;
581 cerr <<
"NumEngines: " <<
FDMExec->GetPropulsion()->GetNumEngines() << endl;
582 cerr <<
"NumGearUnits: " <<
FDMExec->GetGroundReactions()->GetNumGearUnits() << endl;
588 FGInitialCondition *IC =
FDMExec->GetIC();
589 if (!jsbsim_ic_name.empty()) {
592 cerr <<
"Initialization unsuccessful" << endl;
599 cout <<
"JSBSim initial conditions loaded from " << jsbsim_ic_name << endl;
604 IC->SetVgroundFpsIC(0.);
608 double gd_lat = RadOfDeg(NAV_LAT0 / 1e7);
610 IC->SetLatitudeDegIC(DegOfRad(gc_lat));
611 IC->SetLongitudeDegIC(NAV_LON0 / 1e7);
613 IC->SetWindNEDFpsIC(0.0, 0.0, 0.0);
616 IC->SetPsiDegIC(QFU);
617 IC->SetVgroundFpsIC(0.);
619 lla0.
lon = RadOfDeg(NAV_LON0 / 1e7);
621 lla0.
alt = (double)(NAV_ALT0 + NAV_MSL0) / 1000.0;
630 cerr <<
"Initialization unsuccessful" << endl;
635 FDMExec->GetPropulsion()->InitRunning(-1);
649 int num_gear =
FDMExec->GetGroundReactions()->GetNumGearUnits();
651 for (i = 0; i < num_gear; i++) {
652 FGColumnVector3 gear_location =
FDMExec->GetGroundReactions()->GetGearUnit(i)->GetBodyLocation();
653 double radius =
MetersOfFeet(gear_location.Magnitude());
666 FGPropagate *propagate =
FDMExec->GetPropagate();
676 #if !NPS_CALC_GEO_MAG && defined(AHRS_H_X)
677 PRINT_CONFIG_MSG(
"Using magnetic field as defined in airframe file (AHRS section).")
681 #elif !NPS_CALC_GEO_MAG && defined(INS_H_X)
682 PRINT_CONFIG_MSG(
"Using magnetic field as defined in airframe file (INS section).")
687 PRINT_CONFIG_MSG(
"Using WMM2010 model to calculate magnetic field at simulated location.")
693 double sdate = 2019.0;
704 mag_calc(1, latitude, longitude, alt, nmax, gha,
757 fdm_quat->
qi = jsb_quat->Entry(1);
758 fdm_quat->
qx = jsb_quat->Entry(2);
759 fdm_quat->
qy = jsb_quat->Entry(3);
760 fdm_quat->
qz = jsb_quat->Entry(4);
773 fdm_rate->
p = jsb_vector->Entry(1);
774 fdm_rate->
q = jsb_vector->Entry(2);
775 fdm_rate->
r = jsb_vector->Entry(3);
790 fdm_lla->
lat = propagate->GetGeodLatitudeRad();
791 fdm_lla->
lon = propagate->GetLongitude();
792 fdm_lla->
alt = propagate->GetAltitudeASLmeters();
810 fdm_lla->
lat = propagate->GetLatitude();
811 fdm_lla->
lon = propagate->GetLongitude();
827 fdm_lla->
lat = propagate->GetGeodLatitudeRad();
828 fdm_lla->
lon = propagate->GetLongitude();
836 static int isnan(
double f) {
return (
f !=
f); }
double vehicle_radius_max
The largest distance between vehicle CG and contact point.
#define NPS_COMMANDS_NB
Number of commands sent to the FDM of NPS.
static void jsbsimvec_to_vec(DoubleVect3 *fdm_vector, const FGColumnVector3 *jsb_vector)
Convert JSBSim vector format and struct to NPS vector format and struct.
uint32_t eng_state[FG_NET_FDM_MAX_ENGINES]
void ltp_def_from_ecef_d(struct LtpDef_d *def, struct EcefCoor_d *ecef)
static void jsbsimquat_to_quat(DoubleQuat *fdm_quat, const FGQuaternion *jsb_quat)
Convert JSBSim quaternion struct to NPS quaternion struct.
static struct EcefCoor_d offset
#define NPS_JSBSIM_YAW_TRIM
static void lla_from_jsbsim_geocentric(LlaCoor_d *fdm_lla, FGPropagate *propagate)
Convert JSBSim location to NPS LLA.
double airspeed
equivalent airspeed in m/s
Paparazzi generic macros for geodetic calculations.
static int check_for_nan(void)
Checks NpsFdm struct for NaNs.
struct DoubleVect3 body_ecef_accel
acceleration in body frame, wrt ECEF frame
WMM2020 Geomagnetic field model.
vector in Latitude, Longitude and Altitude
static void h(const real32_T x[7], const real32_T q[4], real32_T y[6])
void ecef_of_lla_d(struct EcefCoor_d *ecef, struct LlaCoor_d *lla)
double alt
in meters above WGS84 reference ellipsoid
struct NedCoor_d ltpprz_ecef_vel
velocity in ltppprz frame, wrt ECEF frame
static void init_ltp(void)
Initialize the ltp from the JSBSim location.
struct DoubleVect3 wind
velocity in m/s in NED
#define NPS_JSBSIM_AILERON_MAX_RAD
void nps_fdm_set_wind(double speed, double dir)
struct DoubleVect3 body_accel
acceleration in body frame as measured by an accelerometer (incl.
#define VECT3_DIFF(_c, _a, _b)
void double_eulers_of_quat(struct DoubleEulers *e, struct DoubleQuat *q)
struct LlaCoor_d lla_pos_pprz
int16_t extrapsh(double date, double dte1, int16_t nmax1, int16_t nmax2, double *gh)
double sideslip
sideslip angle in rad
static void feed_jsbsim(double *commands, int commands_nb)
Feed JSBSim with the latest actuator commands.
#define MetersOfFeet(_f)
Macro to convert from feet to metres.
struct NedCoor_d ltpprz_ecef_accel
accel in ltppprz frame, wrt ECEF frame
Paparazzi floating point algebra.
#define NPS_JSBSIM_ELEVATOR_MAX_RAD
void nps_fdm_set_turbulence(double wind_speed, int turbulence_severity)
#define VECT3_ADD(_a, _b)
struct DoubleQuat ltp_to_body_quat
void nps_fdm_set_temperature(double temp, double h)
Set temperature in degrees Celcius at given height h above MSL.
struct NedCoor_d ltp_ecef_vel
velocity in LTP frame, wrt ECEF frame
struct DoubleEulers ltpprz_to_body_eulers
struct DoubleRates body_inertial_rotaccel
struct DoubleVect3 body_inertial_accel
acceleration in body frame, wrt ECI inertial frame
static void double_vect3_normalize(struct DoubleVect3 *v)
normalize 3D vector in place
void nps_fdm_set_wind_ned(double wind_north, double wind_east, double wind_down)
struct DoubleRates body_ecef_rotvel
struct EcefCoor_d ecef_ecef_vel
velocity in ECEF frame, wrt ECEF frame
Paparazzi floating point math for geodetic calculations.
struct DoubleVect3 body_ecef_vel
velocity in body frame, wrt ECEF frame
struct NedCoor_d ltp_ecef_accel
acceleration in LTP frame, wrt ECEF frame
double total_pressure
total atmospheric pressure in Pascal
#define JSBSIM_PATH(_x)
Macro to build file path according to the lib version.
struct LlaCoor_d lla_pos_geoc
#define EULERS_COPY(_a, _b)
static struct LtpDef_d ltpdef
double min_dt
Timestep used for higher fidelity near the ground.
static void jsbsimvec_to_rate(DoubleRates *fdm_rate, const FGColumnVector3 *jsb_vector)
Convert JSBSim rates vector struct to NPS rates struct.
#define NPS_JSBSIM_PITCH_TRIM
Trim values for the airframe.
struct DoubleRates body_ecef_rotaccel
void nps_fdm_run_step(bool launch, double *commands, int commands_nb)
Update the simulation state.
void nps_fdm_init(double dt)
Initialize actuator dynamics, set unused fields in fdm.
static void lla_from_jsbsim_geodetic(LlaCoor_d *fdm_lla, FGPropagate *propagate)
Convert JSBSim location to NPS LLA.
Paparazzi double-precision floating point math for geodetic calculations.
#define NPS_JSBSIM_FLAP_MAX_RAD
definition of the local (flat earth) coordinate system
uint16_t f
Camera baseline, in meters (i.e. horizontal distance between the two cameras of the stereo setup)
struct EcefCoor_d ecef_ecef_accel
acceleration in ECEF frame, wrt ECEF frame
static const ShellCommand commands[]
PRINT_CONFIG_MSG("USE_INS_NAV_INIT defaulting to TRUE")
#define NPS_JSBSIM_MODEL
Name of the JSBSim model.
double aoa
angle of attack in rad
struct NpsFdm fdm
Holds all necessary NPS FDM state information.
struct DoubleQuat ecef_to_body_quat
#define QUAT_COPY(_qo, _qi)
struct DoubleEulers ltp_to_body_eulers
struct NedCoor_d ltpprz_pos
static void init_jsbsim(double dt)
Initializes JSBSim.
void ned_of_ecef_point_d(struct NedCoor_d *ned, struct LtpDef_d *def, struct EcefCoor_d *ecef)
struct DoubleQuat ltpprz_to_body_quat
vector in EarthCenteredEarthFixed coordinates
struct EcefCoor_d ecef_pos
static FGFDMExec * FDMExec
The JSBSim executive object.
double temperature
current temperature in degrees Celcius
static void fetch_state(void)
Populates the NPS fdm struct after a simulation step.
void lla_of_ecef_d(struct LlaCoor_d *lla, struct EcefCoor_d *ecef)
static void llh_from_jsbsim(LlaCoor_d *fdm_lla, FGPropagate *propagate)
Convert JSBSim location to NPS LLH.
double gc_of_gd_lat_d(double gd_lat, double hmsl)
void ned_of_ecef_vect_d(struct NedCoor_d *ned, struct LtpDef_d *def, struct EcefCoor_d *ecef)
double pressure
current (static) atmospheric pressure in Pascal
int16_t mag_calc(int16_t igdgc, double flat, double flon, double elev, int16_t nmax, double *gh, double *geo_mag_x, double *geo_mag_y, double *geo_mag_z, int16_t iext, double ext1, double ext2, double ext3)
double dynamic_pressure
dynamic pressure in Pascal
#define CelsiusOfRankine(_r)
Paparazzi generic algebra macros.
#define VECT3_ASSIGN(_a, _x, _y, _z)
struct LlaCoor_d lla_pos_geod
float rpm[FG_NET_FDM_MAX_ENGINES]
#define NPS_JSBSIM_RUDDER_MAX_RAD
struct DoubleRates body_inertial_rotvel
#define NPS_JSBSIM_ROLL_TRIM
double pressure_sl
pressure at sea level in Pascal
static void jsbsimloc_to_loc(EcefCoor_d *fdm_location, const FGLocation *jsb_location)
Convert JSBSim location format and struct to NPS location format and struct.
#define MIN_DT
Minimum JSBSim timestep Around 1/10000 seems to be good for ground impacts.