Browse Source

remove @unit enum

sbg
Daniel Agar 9 years ago
parent
commit
6888545037
  1. 2
      src/drivers/camera_trigger/camera_trigger_params.c
  2. 1
      src/drivers/gimbal/gimbal_params.c
  3. 1
      src/drivers/mkblctrl/mkblctrl_params.c
  4. 1
      src/lib/runway_takeoff/runway_takeoff_params.c
  5. 1
      src/modules/attitude_estimator_q/attitude_estimator_q_params.c
  6. 9
      src/modules/commander/commander_params.c
  7. 1
      src/modules/ekf2/ekf2_params.c
  8. 1
      src/modules/fw_att_control/fw_att_control_params.c
  9. 3
      src/modules/navigator/geofence_params.c
  10. 2
      src/modules/navigator/mission_params.c
  11. 1
      src/modules/sdlog2/params.c
  12. 30
      src/modules/sensors/sensor_params.c
  13. 1
      src/modules/systemlib/system_params.c
  14. 1
      src/modules/uavcan/uavcan_params.c
  15. 1
      src/modules/vtol_att_control/vtol_att_control_params.c

2
src/drivers/camera_trigger/camera_trigger_params.c

@ -58,7 +58,6 @@ PARAM_DEFINE_FLOAT(TRIG_INTERVAL, 40.0f); @@ -58,7 +58,6 @@ PARAM_DEFINE_FLOAT(TRIG_INTERVAL, 40.0f);
*
* This parameter sets the polarity of the trigger (0 = ACTIVE_LOW, 1 = ACTIVE_HIGH )
*
* @unit enum
* @value 0 ACTIVE_LOW
* @value 1 ACTIVE_HIGH
* @min 0
@ -82,7 +81,6 @@ PARAM_DEFINE_FLOAT(TRIG_ACT_TIME, 0.5f); @@ -82,7 +81,6 @@ PARAM_DEFINE_FLOAT(TRIG_ACT_TIME, 0.5f);
*
* 0 disables the trigger, 1 sets it to enabled on command, 2 always on, 3 distance based, 4 distance based enabled on command
*
* @unit enum
* @value 0 disable
* @value 1 cmd
* @value 2 always

1
src/drivers/gimbal/gimbal_params.c

@ -63,7 +63,6 @@ PARAM_DEFINE_INT32(GMB_USE_MNT, 0); @@ -63,7 +63,6 @@ PARAM_DEFINE_INT32(GMB_USE_MNT, 0);
* Switch on means the gimbal can move freely, and landing gear
* will be retracted if applicable.
*
* @unit enum
* @value 0 disable
* @value 1 aux1
* @value 2 aux2

1
src/drivers/mkblctrl/mkblctrl_params.c

@ -46,7 +46,6 @@ @@ -46,7 +46,6 @@
/**
* Enables testmode (Identify) of MKBLCTRL Driver
*
* @unit enum
* @value 0 Disabled
* @value 1 Enabled
* @min 0

1
src/lib/runway_takeoff/runway_takeoff_params.c

@ -54,7 +54,6 @@ PARAM_DEFINE_INT32(RWTO_TKOFF, 0); @@ -54,7 +54,6 @@ PARAM_DEFINE_INT32(RWTO_TKOFF, 0);
*
* 0: airframe heading, 1: heading towards takeoff waypoint
*
* @unit enum
* @value 0 airframe
* @value 1 waypoint
* @min 0

1
src/modules/attitude_estimator_q/attitude_estimator_q_params.c

@ -107,7 +107,6 @@ PARAM_DEFINE_INT32(ATT_MAG_DECL_A, 1); @@ -107,7 +107,6 @@ PARAM_DEFINE_INT32(ATT_MAG_DECL_A, 1);
* Set to 2 to use heading from motion capture.
*
* @group Attitude Q estimator
* @unit enum
* @value 0 none
* @value 1 vision
* @value 2 motion capture

9
src/modules/commander/commander_params.c

@ -316,7 +316,6 @@ PARAM_DEFINE_INT32(COM_AUTOS_PAR, 1); @@ -316,7 +316,6 @@ PARAM_DEFINE_INT32(COM_AUTOS_PAR, 1);
* of directly forwarding the manual input data.
*
* @group Commander
* @unit enum
* @min 0
* @max 2
* @value 0 RC Transmitter
@ -347,7 +346,6 @@ PARAM_DEFINE_INT32(COM_DISARM_LAND, 0); @@ -347,7 +346,6 @@ PARAM_DEFINE_INT32(COM_DISARM_LAND, 0);
* If the main switch channel is in this range the
* selected flight mode will be applied.
*
* @unit enum
* @value -1 Unassigned
* @value 0 Manual
* @value 1 Altitude
@ -370,7 +368,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE1, -1); @@ -370,7 +368,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE1, -1);
* If the main switch channel is in this range the
* selected flight mode will be applied.
*
* @unit enum
* @value -1 Unassigned
* @value 0 Manual
* @value 1 Altitude
@ -393,7 +390,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE2, -1); @@ -393,7 +390,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE2, -1);
* If the main switch channel is in this range the
* selected flight mode will be applied.
*
* @unit enum
* @value -1 Unassigned
* @value 0 Manual
* @value 1 Altitude
@ -416,7 +412,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE3, -1); @@ -416,7 +412,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE3, -1);
* If the main switch channel is in this range the
* selected flight mode will be applied.
*
* @unit enum
* @value -1 Unassigned
* @value 0 Manual
* @value 1 Altitude
@ -439,7 +434,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE4, -1); @@ -439,7 +434,6 @@ PARAM_DEFINE_INT32(COM_FLTMODE4, -1);
* If the main switch channel is in this range the
* selected flight mode will be applied.
*
* @unit enum
* @value -1 Unassigned
* @value 0 Manual
* @value 1 Altitude
@ -457,12 +451,11 @@ PARAM_DEFINE_INT32(COM_FLTMODE4, -1); @@ -457,12 +451,11 @@ PARAM_DEFINE_INT32(COM_FLTMODE4, -1);
PARAM_DEFINE_INT32(COM_FLTMODE5, -1);
/**
* Sixt flightmode slot (1800-2000)
* Sixth flightmode slot (1800-2000)
*
* If the main switch channel is in this range the
* selected flight mode will be applied.
*
* @unit enum
* @value -1 Unassigned
* @value 0 Manual
* @value 1 Altitude

1
src/modules/ekf2/ekf2_params.c

@ -345,7 +345,6 @@ PARAM_DEFINE_INT32(EKF2_DECL_TYPE, 7); @@ -345,7 +345,6 @@ PARAM_DEFINE_INT32(EKF2_DECL_TYPE, 7);
* If set to automatic: heading fusion on-ground and 3-axis fusion in-flight
*
* @group EKF2
* @unit enum
* @value 0 Automatic
* @value 1 Magnetic heading
* @value 2 3-axis fusion

1
src/modules/fw_att_control/fw_att_control_params.c

@ -365,7 +365,6 @@ PARAM_DEFINE_FLOAT(FW_YCO_VMIN, 1000.0f); @@ -365,7 +365,6 @@ PARAM_DEFINE_FLOAT(FW_YCO_VMIN, 1000.0f);
* 0: open-loop zero lateral acceleration based on kinematic constraints
* 1: closed-loop: try to reduce lateral acceleration to 0 by measuring the acceleration
*
* @unit enum
* @min 0
* @max 1
* @value 0 open-loop

3
src/modules/navigator/geofence_params.c

@ -48,7 +48,6 @@ @@ -48,7 +48,6 @@
*
* 0 = none, 1 = warning (default), 2 = loiter, 3 = return to launch, 4 = fight termination
*
* @unit enum
* @min 0
* @max 4
* @value 0 none
@ -66,7 +65,6 @@ PARAM_DEFINE_INT32(GF_ACTION, 1); @@ -66,7 +65,6 @@ PARAM_DEFINE_INT32(GF_ACTION, 1);
* Select which altitude reference should be used
* 0 = WGS84, 1 = AMSL
*
* @unit enum
* @min 0
* @max 1
* @value 0 WGS84
@ -82,7 +80,6 @@ PARAM_DEFINE_INT32(GF_ALTMODE, 0); @@ -82,7 +80,6 @@ PARAM_DEFINE_INT32(GF_ALTMODE, 0);
* no dependence on the position estimator
* 0 = global position, 1 = GPS
*
* @unit enum
* @min 0
* @max 1
* @value 0 GPOS

2
src/modules/navigator/mission_params.c

@ -99,7 +99,6 @@ PARAM_DEFINE_FLOAT(MIS_DIST_1WP, 900); @@ -99,7 +99,6 @@ PARAM_DEFINE_FLOAT(MIS_DIST_1WP, 900);
* 1: the system will follow a first order hold altitude setpoint
* values follow the definition in enum mission_altitude_mode
*
* @unit enum
* @min 0
* @max 1
* @value 0 Zero Order Hold
@ -113,7 +112,6 @@ PARAM_DEFINE_INT32(MIS_ALTMODE, 1); @@ -113,7 +112,6 @@ PARAM_DEFINE_INT32(MIS_ALTMODE, 1);
*
* The values are defined in the enum mission_altitude_mode
*
* @unit enum
* @min 0
* @max 3
* @value 0 Heading as set by waypoint

1
src/modules/sdlog2/params.c

@ -56,7 +56,6 @@ PARAM_DEFINE_INT32(SDLOG_RATE, -1); @@ -56,7 +56,6 @@ PARAM_DEFINE_INT32(SDLOG_RATE, -1);
* parameter is only read out before logging starts
* (which commonly is before arming).
*
* @unit enum
* @min -1
* @max 1
* @value -1 command line

30
src/modules/sensors/sensor_params.c

@ -329,7 +329,6 @@ PARAM_DEFINE_INT32(CAL_MAG1_ID, 0); @@ -329,7 +329,6 @@ PARAM_DEFINE_INT32(CAL_MAG1_ID, 0);
* should only attempt to configure the rotation if the value is
* greater than or equal to zero.
*
* @unit enum
* @value -1 Internal mag
* @value 0 No rotation
* @value 1 Yaw 45°
@ -536,7 +535,6 @@ PARAM_DEFINE_INT32(CAL_MAG2_ID, 0); @@ -536,7 +535,6 @@ PARAM_DEFINE_INT32(CAL_MAG2_ID, 0);
* should only attempt to configure the rotation if the value is
* greater than or equal to zero.
*
* @unit enum
* @value -1 Internal mag
* @value 0 No rotation
* @value 1 Yaw 45°
@ -735,7 +733,6 @@ PARAM_DEFINE_FLOAT(SENS_BARO_QNH, 1013.25f); @@ -735,7 +733,6 @@ PARAM_DEFINE_FLOAT(SENS_BARO_QNH, 1013.25f);
*
* This parameter defines the rotation of the FMU board relative to the platform.
*
* @unit enum
* @value 0 No rotation
* @value 1 Yaw 45°
* @value 2 Yaw 90°
@ -773,7 +770,6 @@ PARAM_DEFINE_INT32(SENS_BOARD_ROT, 0); @@ -773,7 +770,6 @@ PARAM_DEFINE_INT32(SENS_BOARD_ROT, 0);
* This parameter defines the rotation of the PX4FLOW board relative to the platform.
* Zero rotation is defined as Y on flow board pointing towards front of vehicle
*
* @unit enum
* @value 0 No rotation
* @value 1 Yaw 45°
* @value 2 Yaw 90°
@ -825,7 +821,6 @@ PARAM_DEFINE_FLOAT(SENS_BOARD_Z_OFF, 0.0f); @@ -825,7 +821,6 @@ PARAM_DEFINE_FLOAT(SENS_BOARD_Z_OFF, 0.0f);
/**
* External magnetometer rotation
*
* @unit enum
* @value 0 No rotation
* @value 1 Yaw 45°
* @value 2 Yaw 90°
@ -860,7 +855,6 @@ PARAM_DEFINE_INT32(SENS_EXT_MAG_ROT, 0); @@ -860,7 +855,6 @@ PARAM_DEFINE_INT32(SENS_EXT_MAG_ROT, 0);
/**
* Select primary magnetometer
*
* @unit enum
* @min 0
* @max 2
* @value 0 Auto-select Mag
@ -1921,7 +1915,6 @@ PARAM_DEFINE_FLOAT(RC18_DZ, 0.0f); @@ -1921,7 +1915,6 @@ PARAM_DEFINE_FLOAT(RC18_DZ, 0.0f);
/**
* Enable relay control of relay 1 mapped to the Spektrum receiver power supply
*
* @unit enum
* @min 0
* @max 1
* @value 0 Disabled
@ -1933,7 +1926,6 @@ PARAM_DEFINE_INT32(RC_RL1_DSM_VCC, 0); /* Relay 1 controls DSM VCC */ @@ -1933,7 +1926,6 @@ PARAM_DEFINE_INT32(RC_RL1_DSM_VCC, 0); /* Relay 1 controls DSM VCC */
/**
* DSM binding trigger.
*
* @unit enum
* @value -1 Inactive
* @value 0 Start DSM2 bind
* @value 1 Start DSMX bind
@ -2005,7 +1997,6 @@ PARAM_DEFINE_INT32(RC_TH_USER, 1); @@ -2005,7 +1997,6 @@ PARAM_DEFINE_INT32(RC_TH_USER, 1);
* which channel should be used for reading roll inputs from.
* A value of zero indicates the switch is not assigned.
*
* @unit enum
* @min 0
* @max 18
* @value 0 Unassigned
@ -2038,7 +2029,6 @@ PARAM_DEFINE_INT32(RC_MAP_ROLL, 0); @@ -2038,7 +2029,6 @@ PARAM_DEFINE_INT32(RC_MAP_ROLL, 0);
* which channel should be used for reading pitch inputs from.
* A value of zero indicates the switch is not assigned.
*
* @unit enum
* @min 0
* @max 18
* @value 0 Unassigned
@ -2071,7 +2061,6 @@ PARAM_DEFINE_INT32(RC_MAP_PITCH, 0); @@ -2071,7 +2061,6 @@ PARAM_DEFINE_INT32(RC_MAP_PITCH, 0);
* If 0, whichever channel is mapped to throttle is used
* otherwise the value indicates the specific rc channel to use
*
* @unit enum
* @min 0
* @max 18
* @value 0 Unassigned
@ -2103,7 +2092,6 @@ PARAM_DEFINE_INT32(RC_MAP_FAILSAFE, 0); //Default to throttle function @@ -2103,7 +2092,6 @@ PARAM_DEFINE_INT32(RC_MAP_FAILSAFE, 0); //Default to throttle function
* which channel should be used for reading throttle inputs from.
* A value of zero indicates the switch is not assigned.
*
* @unit enum
* @min 0
* @max 18
* @value 0 Unassigned
@ -2136,7 +2124,6 @@ PARAM_DEFINE_INT32(RC_MAP_THROTTLE, 0); @@ -2136,7 +2124,6 @@ PARAM_DEFINE_INT32(RC_MAP_THROTTLE, 0);
* which channel should be used for reading yaw inputs from.
* A value of zero indicates the switch is not assigned.
*
* @unit enum
* @min 0
* @max 18
* @value 0 Unassigned
@ -2168,7 +2155,6 @@ PARAM_DEFINE_INT32(RC_MAP_YAW, 0); @@ -2168,7 +2155,6 @@ PARAM_DEFINE_INT32(RC_MAP_YAW, 0);
* If this parameter is non-zero, flight modes are only selected
* by this channel and are assigned to six slots.
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2202,7 +2188,6 @@ PARAM_DEFINE_INT32(RC_MAP_FLTMODE, 0); @@ -2202,7 +2188,6 @@ PARAM_DEFINE_INT32(RC_MAP_FLTMODE, 0);
* which channel should be used for deciding about the main mode.
* A value of zero indicates the switch is not assigned.
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2231,7 +2216,6 @@ PARAM_DEFINE_INT32(RC_MAP_MODE_SW, 0); @@ -2231,7 +2216,6 @@ PARAM_DEFINE_INT32(RC_MAP_MODE_SW, 0);
/**
* Return switch channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2260,7 +2244,6 @@ PARAM_DEFINE_INT32(RC_MAP_RETURN_SW, 0); @@ -2260,7 +2244,6 @@ PARAM_DEFINE_INT32(RC_MAP_RETURN_SW, 0);
/**
* Rattitude switch channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2289,7 +2272,6 @@ PARAM_DEFINE_INT32(RC_MAP_RATT_SW, 0); @@ -2289,7 +2272,6 @@ PARAM_DEFINE_INT32(RC_MAP_RATT_SW, 0);
/**
* Position Control switch channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2318,7 +2300,6 @@ PARAM_DEFINE_INT32(RC_MAP_POSCTL_SW, 0); @@ -2318,7 +2300,6 @@ PARAM_DEFINE_INT32(RC_MAP_POSCTL_SW, 0);
/**
* Loiter switch channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2347,7 +2328,6 @@ PARAM_DEFINE_INT32(RC_MAP_LOITER_SW, 0); @@ -2347,7 +2328,6 @@ PARAM_DEFINE_INT32(RC_MAP_LOITER_SW, 0);
/**
* Acro switch channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2376,7 +2356,6 @@ PARAM_DEFINE_INT32(RC_MAP_ACRO_SW, 0); @@ -2376,7 +2356,6 @@ PARAM_DEFINE_INT32(RC_MAP_ACRO_SW, 0);
/**
* Offboard switch channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2405,7 +2384,6 @@ PARAM_DEFINE_INT32(RC_MAP_OFFB_SW, 0); @@ -2405,7 +2384,6 @@ PARAM_DEFINE_INT32(RC_MAP_OFFB_SW, 0);
/**
* Kill switch channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2434,7 +2412,6 @@ PARAM_DEFINE_INT32(RC_MAP_KILL_SW, 0); @@ -2434,7 +2412,6 @@ PARAM_DEFINE_INT32(RC_MAP_KILL_SW, 0);
/**
* Flaps channel
*
* @unit enum
* @min 0
* @max 18
* @group Radio Switches
@ -2465,7 +2442,6 @@ PARAM_DEFINE_INT32(RC_MAP_FLAPS, 0); @@ -2465,7 +2442,6 @@ PARAM_DEFINE_INT32(RC_MAP_FLAPS, 0);
*
* Default function: Camera pitch
*
* @unit enum
* @min 0
* @max 18
* @group Radio Calibration
@ -2496,7 +2472,6 @@ PARAM_DEFINE_INT32(RC_MAP_AUX1, 0); @@ -2496,7 +2472,6 @@ PARAM_DEFINE_INT32(RC_MAP_AUX1, 0);
*
* Default function: Camera roll
*
* @unit enum
* @min 0
* @max 18
* @group Radio Calibration
@ -2527,7 +2502,6 @@ PARAM_DEFINE_INT32(RC_MAP_AUX2, 0); @@ -2527,7 +2502,6 @@ PARAM_DEFINE_INT32(RC_MAP_AUX2, 0);
*
* Default function: Camera azimuth / yaw
*
* @unit enum
* @min 0
* @max 18
* @group Radio Calibration
@ -2559,7 +2533,6 @@ PARAM_DEFINE_INT32(RC_MAP_AUX3, 0); @@ -2559,7 +2533,6 @@ PARAM_DEFINE_INT32(RC_MAP_AUX3, 0);
* Can be used for parameter tuning with the RC. This one is further referenced as the 1st parameter channel.
* Set to 0 to deactivate *
*
* @unit enum
* @min 0
* @max 18
* @group Radio Calibration
@ -2591,7 +2564,6 @@ PARAM_DEFINE_INT32(RC_MAP_PARAM1, 0); @@ -2591,7 +2564,6 @@ PARAM_DEFINE_INT32(RC_MAP_PARAM1, 0);
* Can be used for parameter tuning with the RC. This one is further referenced as the 2nd parameter channel.
* Set to 0 to deactivate *
*
* @unit enum
* @min 0
* @max 18
* @group Radio Calibration
@ -2623,7 +2595,6 @@ PARAM_DEFINE_INT32(RC_MAP_PARAM2, 0); @@ -2623,7 +2595,6 @@ PARAM_DEFINE_INT32(RC_MAP_PARAM2, 0);
* Can be used for parameter tuning with the RC. This one is further referenced as the 3th parameter channel.
* Set to 0 to deactivate *
*
* @unit enum
* @min 0
* @max 18
* @group Radio Calibration
@ -2832,7 +2803,6 @@ PARAM_DEFINE_FLOAT(RC_KILLSWITCH_TH, 0.25f); @@ -2832,7 +2803,6 @@ PARAM_DEFINE_FLOAT(RC_KILLSWITCH_TH, 0.25f);
*
* Specify the range for RSSI input with RC_RSSI_PWM_MIN and RC_RSSI_PWM_MAX parameters.
*
* @unit enum
* @min 0
* @max 18
* @value 0 Unassigned

1
src/modules/systemlib/system_params.c

@ -90,7 +90,6 @@ PARAM_DEFINE_INT32(SYS_RESTART_TYPE, 2); @@ -90,7 +90,6 @@ PARAM_DEFINE_INT32(SYS_RESTART_TYPE, 2);
* 921600: enables onboard mode at 921600 baud, 8N1. 57600: enables onboard mode at 57600 baud, 8N1.
* 157600: enables OSD mode at 57600 baud, 8N1.
*
* @unit enum
* @value 921600 Companion Link (921600 baud, 8N1)
* @value 57600 Companion Link (57600 baud, 8N1)
* @value 157600 OSD (57600 baud, 8N1)

1
src/modules/uavcan/uavcan_params.c

@ -47,7 +47,6 @@ @@ -47,7 +47,6 @@
* 2 - Enabled support for dynamic node ID allocation and firmware update.
* 3 - Sets the motor control outputs to UAVCAN and enables support for dynamic node ID allocation and firmware update.
*
* @unit enum
* @min 0
* @max 3
* @value 0 disabled

1
src/modules/vtol_att_control/vtol_att_control_params.c

@ -172,7 +172,6 @@ PARAM_DEFINE_FLOAT(VT_ARSP_LP_GAIN, 0.3f); @@ -172,7 +172,6 @@ PARAM_DEFINE_FLOAT(VT_ARSP_LP_GAIN, 0.3f);
/**
* VTOL Type (Tailsitter=0, Tiltrotor=1, Standard=2)
*
* @unit enum
* @value 0 Tailsitter
* @value 1 Tiltrotor
* @value 2 Standard

Loading…
Cancel
Save