Browse Source

White space fixes

sbg
David Sidrane 8 years ago committed by Lorenz Meier
parent
commit
dc8c6ea5e5
  1. 6
      README.md
  2. 1
      Tools/scp_upload.sh
  3. 3
      cmake/configs/posix_sitl_inav.cmake
  4. 4
      launch/posix_sitl.launch
  5. 4
      msg/vehicle_command.msg
  6. 2
      src/modules/navigator/mission.h
  7. 2
      src/modules/sdlog2/sdlog2.c
  8. 2
      src/modules/systemlib/flashparams/flashfs.c
  9. 1
      src/modules/systemlib/flashparams/flashparams.c
  10. 2
      src/modules/uORB/uORBDevices.hpp

6
README.md

@ -57,9 +57,9 @@ This repository contains code supporting these boards:
* FMUv5.x (ARM Cortex M7, future Pixhawk) * FMUv5.x (ARM Cortex M7, future Pixhawk)
* AeroCore (v1 and v2) * AeroCore (v1 and v2)
* STM32F4Discovery (basic support) [Tutorial](https://pixhawk.org/modules/stm32f4discovery) * STM32F4Discovery (basic support) [Tutorial](https://pixhawk.org/modules/stm32f4discovery)
* MindPX V2.8 [Tutorial] (http://www.mindpx.net/assets/accessories/UserGuide_MindPX.pdf) * MindPX V2.8 [Tutorial](http://www.mindpx.net/assets/accessories/UserGuide_MindPX.pdf)
* MindRacer V1.2 [Tutorial] (http://mindpx.net/assets/accessories/mindracer_user_guide_v1.2.pdf) * MindRacer V1.2 [Tutorial](http://mindpx.net/assets/accessories/mindracer_user_guide_v1.2.pdf)
## Project Milestones ## Project Milestones
The PX4 software and Pixhawk hardware (which has been designed for it) has been created in 2011 by Lorenz Meier. The PX4 software and Pixhawk hardware (which has been designed for it) has been created in 2011 by Lorenz Meier.

1
Tools/scp_upload.sh

@ -30,4 +30,3 @@ echo "Uploading $src_files..."
# Upload files # Upload files
scp -r $src_files ${user}@${host}:$last scp -r $src_files ${user}@${host}:$last

3
cmake/configs/posix_sitl_inav.cmake

@ -2,5 +2,4 @@ include(cmake/configs/posix_sitl_default.cmake)
set(config_sitl_rcS_dir set(config_sitl_rcS_dir
posix-configs/SITL/init/inav posix-configs/SITL/init/inav
) )

4
launch/posix_sitl.launch

@ -6,7 +6,7 @@
<arg name="z" default="0"/> <arg name="z" default="0"/>
<arg name="R" default="0"/> <arg name="R" default="0"/>
<arg name="P" default="0"/> <arg name="P" default="0"/>
<arg name="Y" default="0"/> <arg name="Y" default="0"/>
<arg name="est" default="lpe"/> <arg name="est" default="lpe"/>
<arg name="vehicle" default="iris"/> <arg name="vehicle" default="iris"/>
<arg name="world" default="$(find mavlink_sitl_gazebo)/worlds/empty.world"/> <arg name="world" default="$(find mavlink_sitl_gazebo)/worlds/empty.world"/>
@ -40,4 +40,4 @@
</launch> </launch>
<!-- vim: set et ft=xml fenc=utf-8 ff=unix sts=0 sw=4 ts=4 : --> <!-- vim: set et ft=xml fenc=utf-8 ff=unix sts=0 sw=4 ts=4 : -->

4
msg/vehicle_command.msg

@ -32,8 +32,8 @@ uint32 VEHICLE_CMD_DO_REPEAT_RELAY = 182 # Cycle a relay on and off for a desir
uint32 VEHICLE_CMD_DO_SET_SERVO = 183 # Set a servo to a desired PWM value. |Servo number| PWM (microseconds, 1000 to 2000 typical)| Empty| Empty| Empty| Empty| Empty| uint32 VEHICLE_CMD_DO_SET_SERVO = 183 # Set a servo to a desired PWM value. |Servo number| PWM (microseconds, 1000 to 2000 typical)| Empty| Empty| Empty| Empty| Empty|
uint32 VEHICLE_CMD_DO_REPEAT_SERVO = 184 # Cycle a between its nominal setting and a desired PWM for a desired number of cycles with a desired period. |Servo number| PWM (microseconds, 1000 to 2000 typical)| Cycle count| Cycle time (seconds)| Empty| Empty| Empty| uint32 VEHICLE_CMD_DO_REPEAT_SERVO = 184 # Cycle a between its nominal setting and a desired PWM for a desired number of cycles with a desired period. |Servo number| PWM (microseconds, 1000 to 2000 typical)| Cycle count| Cycle time (seconds)| Empty| Empty| Empty|
uint32 VEHICLE_CMD_DO_FLIGHTTERMINATION = 185 # Terminate flight immediately |Flight termination activated if > 0.5| Empty| Empty| Empty| Empty| Empty| Empty| uint32 VEHICLE_CMD_DO_FLIGHTTERMINATION = 185 # Terminate flight immediately |Flight termination activated if > 0.5| Empty| Empty| Empty| Empty| Empty| Empty|
uint32 VEHICLE_CMD_DO_LAND_START = 189 # Mission command to perform a landing. This is used as a marker in a mission to tell the autopilot where a sequence of mission items that represents a landing starts. It may also be sent via a COMMAND_LONG to trigger a landing, in which case the nearest (geographically) landing sequence in the mission will be used. The Latitude/Longitude is optional, and may be set to 0/0 if not needed. If specified then it will be used to help find the closest landing sequence. |Empty| Empty| Empty| Empty| Latitude| Longitude| Empty| */ uint32 VEHICLE_CMD_DO_LAND_START = 189 # Mission command to perform a landing. This is used as a marker in a mission to tell the autopilot where a sequence of mission items that represents a landing starts. It may also be sent via a COMMAND_LONG to trigger a landing, in which case the nearest (geographically) landing sequence in the mission will be used. The Latitude/Longitude is optional, and may be set to 0/0 if not needed. If specified then it will be used to help find the closest landing sequence. |Empty| Empty| Empty| Empty| Latitude| Longitude| Empty| */
uint32 VEHICLE_CMD_DO_GO_AROUND = 191 # Mission command to safely abort an autonmous landing. |Altitude (meters)| Empty| Empty| Empty| Empty| Empty| Empty| */ uint32 VEHICLE_CMD_DO_GO_AROUND = 191 # Mission command to safely abort an autonmous landing. |Altitude (meters)| Empty| Empty| Empty| Empty| Empty| Empty| */
uint32 VEHICLE_CMD_DO_REPOSITION = 192 uint32 VEHICLE_CMD_DO_REPOSITION = 192
uint32 VEHICLE_CMD_DO_PAUSE_CONTINUE = 193 uint32 VEHICLE_CMD_DO_PAUSE_CONTINUE = 193
uint32 VEHICLE_CMD_DO_CONTROL_VIDEO = 200 # Control onboard camera system. |Camera ID (-1 for all)| Transmission: 0: disabled, 1: enabled compressed, 2: enabled raw| Transmission mode: 0: video stream, >0: single images every n seconds (decimal)| Recording: 0: disabled, 1: enabled compressed, 2: enabled raw| Empty| Empty| Empty| uint32 VEHICLE_CMD_DO_CONTROL_VIDEO = 200 # Control onboard camera system. |Camera ID (-1 for all)| Transmission: 0: disabled, 1: enabled compressed, 2: enabled raw| Transmission mode: 0: video stream, >0: single images every n seconds (decimal)| Recording: 0: disabled, 1: enabled compressed, 2: enabled raw| Empty| Empty| Empty|

2
src/modules/navigator/mission.h

@ -91,7 +91,7 @@ public:
MISSION_YAWMODE_BACK_TO_HOME = 3, MISSION_YAWMODE_BACK_TO_HOME = 3,
MISSION_YAWMODE_MAX = 4 MISSION_YAWMODE_MAX = 4
}; };
bool set_current_offboard_mission_index(unsigned index); bool set_current_offboard_mission_index(unsigned index);
unsigned find_offboard_land_start(); unsigned find_offboard_land_start();

2
src/modules/sdlog2/sdlog2.c

@ -2209,7 +2209,7 @@ int sdlog2_thread_main(int argc, char *argv[])
log_msg.body.log_INO2.s[8] = buf.innovations.airspeed_innov; log_msg.body.log_INO2.s[8] = buf.innovations.airspeed_innov;
log_msg.body.log_INO2.s[9] = buf.innovations.airspeed_innov_var; log_msg.body.log_INO2.s[9] = buf.innovations.airspeed_innov_var;
log_msg.body.log_INO2.s[10] = buf.innovations.beta_innov; log_msg.body.log_INO2.s[10] = buf.innovations.beta_innov;
log_msg.body.log_INO2.s[11] = buf.innovations.beta_innov_var; log_msg.body.log_INO2.s[11] = buf.innovations.beta_innov_var;
LOGBUFFER_WRITE_AND_COUNT(EST5); LOGBUFFER_WRITE_AND_COUNT(EST5);
log_msg.msg_type = LOG_EST6_MSG; log_msg.msg_type = LOG_EST6_MSG;

2
src/modules/systemlib/flashparams/flashfs.c

@ -55,7 +55,6 @@
#include <nuttx/compiler.h> #include <nuttx/compiler.h>
#include <nuttx/progmem.h> #include <nuttx/progmem.h>
/**************************************************************************** /****************************************************************************
* Pre-processor Definitions * Pre-processor Definitions
****************************************************************************/ ****************************************************************************/
@ -943,7 +942,6 @@ int parameter_flashfs_alloc(flash_file_token_t token, uint8_t **buffer, size_t *
rv = 0; rv = 0;
} }
} }
return rv; return rv;

1
src/modules/systemlib/flashparams/flashparams.c

@ -30,6 +30,7 @@
* POSSIBILITY OF SUCH DAMAGE. * POSSIBILITY OF SUCH DAMAGE.
* *
****************************************************************************/ ****************************************************************************/
/** /**
* @file flashparam.c * @file flashparam.c
* *

2
src/modules/uORB/uORBDevices.hpp

@ -335,5 +335,3 @@ private:
#endif #endif
hrt_abstime _last_statistics_output; hrt_abstime _last_statistics_output;
}; };

Loading…
Cancel
Save