firmware build

This commit is contained in:
Michael Oborne 2011-11-20 07:46:05 +08:00
parent b3716d988f
commit 202c0663cd
14 changed files with 205 additions and 170 deletions

View File

@ -3,10 +3,21 @@
In file included from /root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:32:
/usr/local/share/arduino/libraries/SPI/SPI.h:25:1: warning: "SPI_CLOCK_DIV64" redefined
/usr/local/share/arduino/libraries/SPI/SPI.h:20:1: warning: this is the location of the previous definition
/root/apm/ardupilot-mega/ArduPlane/Log.pde: In function 'int find_last_log_page(uint16_t)':
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:340: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:352: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:362: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:385: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:295: warning: unused variable 'look_page_file'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:296: warning: unused variable 'look_page_filepage'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:297: warning: unused variable 'check'
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde: At global scope:
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde:2057: warning: 'void gcs_send_text(gcs_severity, const char*)' defined but not used
autogenerated:87: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
autogenerated:89: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/commands.pde:128: warning: 'void increment_cmd_index()' defined but not used
autogenerated:144: warning: 'void low_battery_event()' declared 'static' but never defined
autogenerated:146: warning: 'void low_battery_event()' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:270: warning: 'command_index' defined but not used
%% libraries/APM_BMP085/APM_BMP085.o
%% libraries/APM_BMP085/APM_BMP085_hil.o

View File

@ -219,6 +219,7 @@
0000000a r init_home()::__c
0000000a r test_relay(unsigned char, Menu::arg const*)::__c
0000000a r verify_nav_wp()::__c
0000000a r print_log_menu()::__c
0000000a r report_compass()::__c
0000000a r report_throttle()::__c
0000000a r test_mag(unsigned char, Menu::arg const*)::__c
@ -283,6 +284,7 @@
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d B sonar_mode_filter
0000000e t global destructors keyed to Serial
0000000e t global constructors keyed to Serial
@ -343,6 +345,7 @@
0000000f V AP_IMU_Oilpan::AP_IMU_Oilpan(AP_ADC*, unsigned int)::__c
00000010 b rc_override
00000010 r planner_menu_commands
00000010 r __menu_name__main_menu
00000010 T GCS_MAVLINK::send_message(ap_message)
00000010 W AP_VarT<float>::cast_to_float() const
00000010 W AP_VarT<long>::cast_to_float() const
@ -351,7 +354,6 @@
00000010 r Log_Read_Startup()::__c
00000010 r test_wp(unsigned char, Menu::arg const*)::__c
00000010 r dump_log(unsigned char, Menu::arg const*)::__c
00000011 r __menu_name__main_menu
00000011 r erase_logs(unsigned char, Menu::arg const*)::__c
00000011 r zero_eeprom()::__c
00000011 r test_airspeed(unsigned char, Menu::arg const*)::__c
@ -420,10 +422,11 @@
00000019 r handle_process_do_command()::__c
00000019 r handle_process_condition_command()::__c
00000019 r do_jump()::__c
0000001a r print_log_menu()::__c
0000001a r Log_Read_Process(int, int)::__c
0000001a r failsafe_short_on_event()::__c
0000001a r do_jump()::__c
0000001a r do_jump()::__c
0000001a r Log_Read(int, int)::__c
0000001b r failsafe_short_off_event()::__c
0000001c W AP_VarA<float, (unsigned char)6>::unserialize(void*, unsigned int)
0000001c W AP_VarS<Matrix3<float> >::unserialize(void*, unsigned int)
@ -433,25 +436,25 @@
0000001c W AP_VarS<Matrix3<float> >::serialize(void*, unsigned int) const
0000001c W AP_VarS<Vector3<float> >::serialize(void*, unsigned int) const
0000001c r Log_Read_Current()::__c
0000001c r Log_Read(int, int)::__c
0000001c r Log_Read_Process(int, int)::__c
0000001c r Log_Read(int, int)::__c
0000001d r setup_radio(unsigned char, Menu::arg const*)::__c
0000001d r startup_ground()::__c
0000001d r report_batt_monitor()::__c
0000001e t update_commands()
0000001e r flight_mode_strings
0000001e r test_failsafe(unsigned char, Menu::arg const*)::__c
0000001e r startup_ground()::__c
0000001f r setup_compass(unsigned char, Menu::arg const*)::__c
0000001f r init_ardupilot()::__c
0000001f r print_log_menu()::__c
0000001f r Log_Read(int, int)::__c
0000001f r test_mag(unsigned char, Menu::arg const*)::__c
00000020 t gcs_send_message(ap_message)
00000020 r test_current(unsigned char, Menu::arg const*)::__c
00000020 r report_xtrack()::__c
00000020 r init_barometer()::__c
00000020 r Log_Read(int, int)::__c
00000020 t byte_swap_4
00000021 r print_log_menu()::__c
00000021 r print_log_menu()::__c
00000021 r verify_loiter_time()::__c
00000021 r process_next_command()::__c
00000022 t print_blanks(int)
@ -478,12 +481,11 @@
00000026 t print_done()
00000026 t print_hit_enter()
00000026 r init_ardupilot()::__c
00000026 r init_ardupilot()::__c
00000026 r print_PID(PID*)::__c
00000027 r change_command(unsigned char)::__c
00000027 r init_ardupilot()::__c
00000027 r test_xbee(unsigned char, Menu::arg const*)::__c
00000028 t main_menu_help(unsigned char, Menu::arg const*)
00000028 t help_log(unsigned char, Menu::arg const*)
00000028 W AP_VarT<float>::unserialize(void*, unsigned int)
00000028 W AP_VarT<long>::unserialize(void*, unsigned int)
00000028 W AP_VarT<float>::serialize(void*, unsigned int) const
@ -504,8 +506,6 @@
00000030 t planner_mode(unsigned char, Menu::arg const*)
00000030 t send_heartbeat(mavlink_channel_t)
00000030 t test_mode(unsigned char, Menu::arg const*)
00000030 r print_log_menu()::__c
00000031 r start_new_log(unsigned char)::__c
00000032 T GCS_MAVLINK::init(FastSerial*)
00000032 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000033 b pending_status
@ -516,10 +516,10 @@
00000035 r Log_Read_Nav_Tuning()::__c
00000035 r verify_condition_command()::__c
00000036 t report_radio()
00000036 t find_last()
00000036 r test_failsafe(unsigned char, Menu::arg const*)::__c
00000037 r setup_factory(unsigned char, Menu::arg const*)::__c
00000038 t send_current_waypoint(mavlink_channel_t)
00000038 b barometer
00000038 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000038 r dump_log(unsigned char, Menu::arg const*)::__c
00000039 r setup_radio(unsigned char, Menu::arg const*)::__c
@ -530,11 +530,13 @@
0000003a W PID::~PID()
0000003c t verify_RTL()
0000003c t Log_Write_Mode(unsigned char)
0000003c b barometer
0000003c r test_wp_print(Location*, unsigned char)::__c
0000003c r test_mag(unsigned char, Menu::arg const*)::__c
0000003d B g_gps_driver
0000003e T GCS_MAVLINK::send_text(gcs_severity, prog_char_t const*)
0000003e W AP_VarT<signed char>::AP_VarT(signed char, unsigned int, prog_char_t const*, unsigned char)
00000040 r log_menu_commands
00000040 b adc
00000040 W AP_Float16::unserialize(void*, unsigned int)
00000040 t byte_swap_8
@ -552,7 +554,6 @@
0000004c t Log_Read_Mode()
0000004e t setup_batt_monitor(unsigned char, Menu::arg const*)
00000050 b mavlink_queue
00000050 r log_menu_commands
00000050 r main_menu_commands
00000050 T GCS_MAVLINK::_find_parameter(unsigned int)
00000050 B imu
@ -566,7 +567,6 @@
0000005a W AP_VarT<float>::AP_VarT(float, unsigned int, prog_char_t const*, unsigned char)
0000005b r setup_erase(unsigned char, Menu::arg const*)::__c
0000005c t readSwitch()
0000005c t get_num_logs()
0000005e T GCS_MAVLINK::_count_parameters()
00000060 W AP_Float16::AP_Float16(AP_Var_group*, unsigned int, float, prog_char_t const*, unsigned char)
00000062 t print_switch(unsigned char, unsigned char)
@ -575,7 +575,6 @@
00000064 t test_xbee(unsigned char, Menu::arg const*)
00000064 W RC_Channel_aux::~RC_Channel_aux()
00000068 t zero_eeprom()
00000068 t find_last_log_page(int)
0000006a T mavlink_send_text(mavlink_channel_t, gcs_severity, char const*)
0000006a t demo_servos(unsigned char)
0000006a t startup_IMU_ground()
@ -609,6 +608,7 @@
0000009c t print_PID(PID*)
0000009c B gcs0
0000009c B gcs3
0000009e t get_num_logs()
000000a0 t report_xtrack()
000000a2 t verify_nav_wp()
000000a4 t Log_Read_Cmd()
@ -619,15 +619,16 @@
000000ac t Log_Read_Performance()
000000b0 t test_relay(unsigned char, Menu::arg const*)
000000b2 t Log_Read_Startup()
000000b6 t get_log_boundaries(unsigned char, int&, int&)
000000b7 b compass
000000bc t Log_Read_Control_Tuning()
000000be t update_events()
000000c0 t report_throttle()
000000c0 t calc_bearing_error()
000000c4 t Log_Read(int, int)
000000c6 t test_eedump(unsigned char, Menu::arg const*)
000000c6 t zero_airspeed()
000000c6 t startup_ground()
000000c6 t get_log_boundaries(unsigned char, int&, int&)
000000c7 B dcm
000000ca t send_radio_out(mavlink_channel_t)
000000ca t test_modeswitch(unsigned char, Menu::arg const*)
@ -635,15 +636,15 @@
000000ce t send_radio_in(mavlink_channel_t)
000000ce W PID::PID(unsigned int, prog_char_t const*, float const&, float const&, float const&, int const&)
000000ce r setup_mode(unsigned char, Menu::arg const*)::__c
000000ce r help_log(unsigned char, Menu::arg const*)::__c
000000d0 t get_bearing(Location*, Location*)
000000d4 t trim_radio()
000000e4 t test_radio_pwm(unsigned char, Menu::arg const*)
000000e7 r init_ardupilot()::__c
000000ec t dump_log(unsigned char, Menu::arg const*)
000000f0 t throttle_slew_limit()
000000f2 t test_adc(unsigned char, Menu::arg const*)
000000f6 t erase_logs(unsigned char, Menu::arg const*)
000000fa t Log_Read_Current()
000000fc t dump_log(unsigned char, Menu::arg const*)
00000102 t setup_compass(unsigned char, Menu::arg const*)
00000106 t test_current(unsigned char, Menu::arg const*)
00000106 t calc_nav_pitch()
@ -658,7 +659,6 @@
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000114 t read_barometer()
00000116 t erase_logs(unsigned char, Menu::arg const*)
00000118 t test_gps(unsigned char, Menu::arg const*)
00000120 t test_pressure(unsigned char, Menu::arg const*)
00000130 t test_dipswitches(unsigned char, Menu::arg const*)
@ -674,6 +674,7 @@
00000152 t verify_condition_command()
0000015a t test_airspeed(unsigned char, Menu::arg const*)
0000015e t set_guided_WP()
0000015e t Log_Read_Process(int, int)
0000015e t handle_process_nav_cmd()
0000015e t test_gyro(unsigned char, Menu::arg const*)
0000016c t navigate()
@ -682,12 +683,11 @@
00000174 t mavlink_send_message(mavlink_channel_t, ap_message, unsigned int)
0000017c t send_location(mavlink_channel_t)
0000017e t Log_Read_Nav_Tuning()
00000180 t send_extended_status1(mavlink_channel_t, unsigned int)
0000017e t send_extended_status1(mavlink_channel_t, unsigned int)
0000018c T GCS_MAVLINK::data_stream_send(unsigned int, unsigned int)
00000192 T init_home()
00000192 t test_imu(unsigned char, Menu::arg const*)
0000019c t do_jump()
000001ae t start_new_log(unsigned char)
000001b2 t update_crosstrack()
000001b2 t set_mode(unsigned char)
000001bc t set_next_WP(Location*)
@ -700,7 +700,6 @@
000001ea t init_barometer()
00000202 t test_failsafe(unsigned char, Menu::arg const*)
00000208 t calc_throttle()
00000216 t Log_Read(int, int)
0000021a t send_raw_imu1(mavlink_channel_t)
0000022a t send_gps_raw(mavlink_channel_t)
0000022c t process_next_command()
@ -710,16 +709,17 @@
0000024c t update_loiter()
0000025c t setup_radio(unsigned char, Menu::arg const*)
00000268 t send_raw_imu3(mavlink_channel_t)
00000268 t find_last_log_page(unsigned int)
000002d4 t handle_process_do_command()
000002e4 t read_radio()
0000031e t test_mag(unsigned char, Menu::arg const*)
0000033a W Parameters::~Parameters()
00000344 W Parameters::~Parameters()
000003e6 t read_battery()
0000044c t print_log_menu()
00000462 t print_log_menu()
000004de t set_servos()
0000059c t __static_initialization_and_destruction_0(int, int)
0000064a t init_ardupilot()
00000920 W Parameters::Parameters()
0000092b b g
00000694 t init_ardupilot()
00000936 W Parameters::Parameters()
00000938 b g
0000149a T GCS_MAVLINK::handleMessage(__mavlink_message*)
00001cbe T loop
00001caa T loop

View File

@ -3,10 +3,21 @@
In file included from /root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:32:
/usr/local/share/arduino/libraries/SPI/SPI.h:25:1: warning: "SPI_CLOCK_DIV64" redefined
/usr/local/share/arduino/libraries/SPI/SPI.h:20:1: warning: this is the location of the previous definition
/root/apm/ardupilot-mega/ArduPlane/Log.pde: In function 'int find_last_log_page(uint16_t)':
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:340: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:352: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:362: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:385: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:295: warning: unused variable 'look_page_file'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:296: warning: unused variable 'look_page_filepage'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:297: warning: unused variable 'check'
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde: At global scope:
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde:2057: warning: 'void gcs_send_text(gcs_severity, const char*)' defined but not used
autogenerated:87: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
autogenerated:89: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/commands.pde:128: warning: 'void increment_cmd_index()' defined but not used
autogenerated:144: warning: 'void low_battery_event()' declared 'static' but never defined
autogenerated:146: warning: 'void low_battery_event()' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:270: warning: 'command_index' defined but not used
%% libraries/APM_BMP085/APM_BMP085.o
%% libraries/APM_BMP085/APM_BMP085_hil.o

View File

@ -219,6 +219,7 @@
0000000a r init_home()::__c
0000000a r test_relay(unsigned char, Menu::arg const*)::__c
0000000a r verify_nav_wp()::__c
0000000a r print_log_menu()::__c
0000000a r report_compass()::__c
0000000a r report_throttle()::__c
0000000a r test_mag(unsigned char, Menu::arg const*)::__c
@ -283,6 +284,7 @@
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d B sonar_mode_filter
0000000e t global destructors keyed to Serial
0000000e t global constructors keyed to Serial
@ -343,6 +345,7 @@
0000000f V AP_IMU_Oilpan::AP_IMU_Oilpan(AP_ADC*, unsigned int)::__c
00000010 b rc_override
00000010 r planner_menu_commands
00000010 r __menu_name__main_menu
00000010 T GCS_MAVLINK::send_message(ap_message)
00000010 W AP_VarT<float>::cast_to_float() const
00000010 W AP_VarT<long>::cast_to_float() const
@ -351,7 +354,6 @@
00000010 r Log_Read_Startup()::__c
00000010 r test_wp(unsigned char, Menu::arg const*)::__c
00000010 r dump_log(unsigned char, Menu::arg const*)::__c
00000011 r __menu_name__main_menu
00000011 r erase_logs(unsigned char, Menu::arg const*)::__c
00000011 r zero_eeprom()::__c
00000011 r test_airspeed(unsigned char, Menu::arg const*)::__c
@ -420,10 +422,11 @@
00000019 r handle_process_do_command()::__c
00000019 r handle_process_condition_command()::__c
00000019 r do_jump()::__c
0000001a r print_log_menu()::__c
0000001a r Log_Read_Process(int, int)::__c
0000001a r failsafe_short_on_event()::__c
0000001a r do_jump()::__c
0000001a r do_jump()::__c
0000001a r Log_Read(int, int)::__c
0000001b r failsafe_short_off_event()::__c
0000001c W AP_VarA<float, (unsigned char)6>::unserialize(void*, unsigned int)
0000001c W AP_VarS<Matrix3<float> >::unserialize(void*, unsigned int)
@ -433,25 +436,25 @@
0000001c W AP_VarS<Matrix3<float> >::serialize(void*, unsigned int) const
0000001c W AP_VarS<Vector3<float> >::serialize(void*, unsigned int) const
0000001c r Log_Read_Current()::__c
0000001c r Log_Read(int, int)::__c
0000001c r Log_Read_Process(int, int)::__c
0000001c r Log_Read(int, int)::__c
0000001d r setup_radio(unsigned char, Menu::arg const*)::__c
0000001d r startup_ground()::__c
0000001d r report_batt_monitor()::__c
0000001e t update_commands()
0000001e r flight_mode_strings
0000001e r test_failsafe(unsigned char, Menu::arg const*)::__c
0000001e r startup_ground()::__c
0000001f r setup_compass(unsigned char, Menu::arg const*)::__c
0000001f r init_ardupilot()::__c
0000001f r print_log_menu()::__c
0000001f r Log_Read(int, int)::__c
0000001f r test_mag(unsigned char, Menu::arg const*)::__c
00000020 t gcs_send_message(ap_message)
00000020 r test_current(unsigned char, Menu::arg const*)::__c
00000020 r report_xtrack()::__c
00000020 r init_barometer()::__c
00000020 r Log_Read(int, int)::__c
00000020 t byte_swap_4
00000021 r print_log_menu()::__c
00000021 r print_log_menu()::__c
00000021 r verify_loiter_time()::__c
00000021 r process_next_command()::__c
00000022 t print_blanks(int)
@ -478,12 +481,11 @@
00000026 t print_done()
00000026 t print_hit_enter()
00000026 r init_ardupilot()::__c
00000026 r init_ardupilot()::__c
00000026 r print_PID(PID*)::__c
00000027 r change_command(unsigned char)::__c
00000027 r init_ardupilot()::__c
00000027 r test_xbee(unsigned char, Menu::arg const*)::__c
00000028 t main_menu_help(unsigned char, Menu::arg const*)
00000028 t help_log(unsigned char, Menu::arg const*)
00000028 W AP_VarT<float>::unserialize(void*, unsigned int)
00000028 W AP_VarT<long>::unserialize(void*, unsigned int)
00000028 W AP_VarT<float>::serialize(void*, unsigned int) const
@ -504,8 +506,6 @@
00000030 t planner_mode(unsigned char, Menu::arg const*)
00000030 t send_heartbeat(mavlink_channel_t)
00000030 t test_mode(unsigned char, Menu::arg const*)
00000030 r print_log_menu()::__c
00000031 r start_new_log(unsigned char)::__c
00000032 T GCS_MAVLINK::init(FastSerial*)
00000032 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000033 b pending_status
@ -516,10 +516,10 @@
00000035 r Log_Read_Nav_Tuning()::__c
00000035 r verify_condition_command()::__c
00000036 t report_radio()
00000036 t find_last()
00000036 r test_failsafe(unsigned char, Menu::arg const*)::__c
00000037 r setup_factory(unsigned char, Menu::arg const*)::__c
00000038 t send_current_waypoint(mavlink_channel_t)
00000038 b barometer
00000038 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000038 r dump_log(unsigned char, Menu::arg const*)::__c
00000039 r setup_radio(unsigned char, Menu::arg const*)::__c
@ -530,11 +530,13 @@
0000003a W PID::~PID()
0000003c t verify_RTL()
0000003c t Log_Write_Mode(unsigned char)
0000003c b barometer
0000003c r test_wp_print(Location*, unsigned char)::__c
0000003c r test_mag(unsigned char, Menu::arg const*)::__c
0000003d B g_gps_driver
0000003e T GCS_MAVLINK::send_text(gcs_severity, prog_char_t const*)
0000003e W AP_VarT<signed char>::AP_VarT(signed char, unsigned int, prog_char_t const*, unsigned char)
00000040 r log_menu_commands
00000040 b adc
00000040 W AP_Float16::unserialize(void*, unsigned int)
00000040 t byte_swap_8
@ -552,7 +554,6 @@
0000004c t Log_Read_Mode()
0000004e t setup_batt_monitor(unsigned char, Menu::arg const*)
00000050 b mavlink_queue
00000050 r log_menu_commands
00000050 r main_menu_commands
00000050 T GCS_MAVLINK::_find_parameter(unsigned int)
00000050 B imu
@ -566,7 +567,6 @@
0000005a W AP_VarT<float>::AP_VarT(float, unsigned int, prog_char_t const*, unsigned char)
0000005b r setup_erase(unsigned char, Menu::arg const*)::__c
0000005c t readSwitch()
0000005c t get_num_logs()
0000005e T GCS_MAVLINK::_count_parameters()
00000060 t print_switch(unsigned char, unsigned char)
00000060 W AP_Float16::AP_Float16(AP_Var_group*, unsigned int, float, prog_char_t const*, unsigned char)
@ -575,7 +575,6 @@
00000064 t test_xbee(unsigned char, Menu::arg const*)
00000064 W RC_Channel_aux::~RC_Channel_aux()
00000068 t zero_eeprom()
00000068 t find_last_log_page(int)
0000006a T mavlink_send_text(mavlink_channel_t, gcs_severity, char const*)
0000006a t demo_servos(unsigned char)
0000006a t startup_IMU_ground()
@ -609,6 +608,7 @@
0000009c t print_PID(PID*)
0000009c B gcs0
0000009c B gcs3
0000009e t get_num_logs()
000000a0 t report_xtrack()
000000a2 t verify_nav_wp()
000000a4 t Log_Read_Cmd()
@ -619,31 +619,32 @@
000000ac t Log_Read_Performance()
000000b0 t test_relay(unsigned char, Menu::arg const*)
000000b0 t Log_Read_Startup()
000000b6 t get_log_boundaries(unsigned char, int&, int&)
000000b7 b compass
000000bc t Log_Read_Control_Tuning()
000000be t update_events()
000000c0 t report_throttle()
000000c0 t calc_bearing_error()
000000c0 t Log_Read(int, int)
000000c2 t test_eedump(unsigned char, Menu::arg const*)
000000c6 t zero_airspeed()
000000c6 t startup_ground()
000000c7 B dcm
000000c8 t test_modeswitch(unsigned char, Menu::arg const*)
000000c8 t get_log_boundaries(unsigned char, int&, int&)
000000ca t send_radio_out(mavlink_channel_t)
000000ca t control_failsafe(unsigned int)
000000ce t send_radio_in(mavlink_channel_t)
000000ce W PID::PID(unsigned int, prog_char_t const*, float const&, float const&, float const&, int const&)
000000ce r setup_mode(unsigned char, Menu::arg const*)::__c
000000ce r help_log(unsigned char, Menu::arg const*)::__c
000000d0 t get_bearing(Location*, Location*)
000000d4 t trim_radio()
000000e4 t test_radio_pwm(unsigned char, Menu::arg const*)
000000e7 r init_ardupilot()::__c
000000ec t dump_log(unsigned char, Menu::arg const*)
000000f0 t throttle_slew_limit()
000000f0 t test_adc(unsigned char, Menu::arg const*)
000000f4 t erase_logs(unsigned char, Menu::arg const*)
000000fa t Log_Read_Current()
000000fc t dump_log(unsigned char, Menu::arg const*)
00000102 t setup_compass(unsigned char, Menu::arg const*)
00000106 t test_current(unsigned char, Menu::arg const*)
00000106 t calc_nav_pitch()
@ -657,7 +658,6 @@
00000112 t report_batt_monitor()
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000114 t erase_logs(unsigned char, Menu::arg const*)
00000114 t read_barometer()
00000118 t test_gps(unsigned char, Menu::arg const*)
00000120 t test_pressure(unsigned char, Menu::arg const*)
@ -673,6 +673,7 @@
00000152 t report_gains()
00000152 t verify_condition_command()
00000158 t test_airspeed(unsigned char, Menu::arg const*)
0000015a t Log_Read_Process(int, int)
0000015e t set_guided_WP()
0000015e t handle_process_nav_cmd()
0000015e t test_gyro(unsigned char, Menu::arg const*)
@ -682,12 +683,11 @@
00000174 t mavlink_send_message(mavlink_channel_t, ap_message, unsigned int)
0000017c t send_location(mavlink_channel_t)
0000017e t Log_Read_Nav_Tuning()
00000180 t send_extended_status1(mavlink_channel_t, unsigned int)
0000017e t send_extended_status1(mavlink_channel_t, unsigned int)
0000018c T GCS_MAVLINK::data_stream_send(unsigned int, unsigned int)
00000190 T init_home()
00000192 t test_imu(unsigned char, Menu::arg const*)
0000019a t do_jump()
000001ae t start_new_log(unsigned char)
000001b2 t update_crosstrack()
000001b2 t set_mode(unsigned char)
000001bc t set_next_WP(Location*)
@ -700,7 +700,6 @@
000001ea t init_barometer()
000001fe t test_failsafe(unsigned char, Menu::arg const*)
00000208 t calc_throttle()
00000210 t Log_Read(int, int)
0000021a t send_raw_imu1(mavlink_channel_t)
00000228 t test_wp(unsigned char, Menu::arg const*)
0000022a t send_gps_raw(mavlink_channel_t)
@ -710,16 +709,17 @@
0000024c t update_loiter()
0000025c t setup_radio(unsigned char, Menu::arg const*)
00000268 t send_raw_imu3(mavlink_channel_t)
00000268 t find_last_log_page(unsigned int)
000002d4 t handle_process_do_command()
000002e4 t read_radio()
0000031e t test_mag(unsigned char, Menu::arg const*)
0000033a W Parameters::~Parameters()
00000344 W Parameters::~Parameters()
000003e6 t read_battery()
00000436 t print_log_menu()
0000044c t print_log_menu()
000004de t set_servos()
0000059c t __static_initialization_and_destruction_0(int, int)
00000648 t init_ardupilot()
00000920 W Parameters::Parameters()
0000092b b g
00000692 t init_ardupilot()
00000936 W Parameters::Parameters()
00000938 b g
0000149a T GCS_MAVLINK::handleMessage(__mavlink_message*)
00001cbe T loop
00001caa T loop

View File

@ -3,10 +3,21 @@
In file included from /root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:32:
/usr/local/share/arduino/libraries/SPI/SPI.h:25:1: warning: "SPI_CLOCK_DIV64" redefined
/usr/local/share/arduino/libraries/SPI/SPI.h:20:1: warning: this is the location of the previous definition
/root/apm/ardupilot-mega/ArduPlane/Log.pde: In function 'int find_last_log_page(uint16_t)':
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:340: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:352: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:362: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:385: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:295: warning: unused variable 'look_page_file'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:296: warning: unused variable 'look_page_filepage'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:297: warning: unused variable 'check'
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde: At global scope:
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde:2057: warning: 'void gcs_send_text(gcs_severity, const char*)' defined but not used
autogenerated:87: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
autogenerated:89: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/commands.pde:128: warning: 'void increment_cmd_index()' defined but not used
autogenerated:144: warning: 'void low_battery_event()' declared 'static' but never defined
autogenerated:146: warning: 'void low_battery_event()' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:270: warning: 'command_index' defined but not used
%% libraries/APM_BMP085/APM_BMP085.o
%% libraries/APM_BMP085/APM_BMP085_hil.o

View File

@ -219,6 +219,7 @@
0000000a r init_home()::__c
0000000a r test_relay(unsigned char, Menu::arg const*)::__c
0000000a r verify_nav_wp()::__c
0000000a r print_log_menu()::__c
0000000a r report_compass()::__c
0000000a r report_throttle()::__c
0000000a r test_mag(unsigned char, Menu::arg const*)::__c
@ -283,6 +284,7 @@
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d B sonar_mode_filter
0000000e t global destructors keyed to Serial
0000000e t global constructors keyed to Serial
@ -343,6 +345,7 @@
0000000f V AP_IMU_Oilpan::AP_IMU_Oilpan(AP_ADC*, unsigned int)::__c
00000010 b rc_override
00000010 r planner_menu_commands
00000010 r __menu_name__main_menu
00000010 T GCS_MAVLINK::send_message(ap_message)
00000010 W AP_VarT<float>::cast_to_float() const
00000010 W AP_VarT<long>::cast_to_float() const
@ -351,7 +354,6 @@
00000010 r Log_Read_Startup()::__c
00000010 r test_wp(unsigned char, Menu::arg const*)::__c
00000010 r dump_log(unsigned char, Menu::arg const*)::__c
00000011 r __menu_name__main_menu
00000011 r erase_logs(unsigned char, Menu::arg const*)::__c
00000011 r zero_eeprom()::__c
00000011 r test_airspeed(unsigned char, Menu::arg const*)::__c
@ -420,10 +422,11 @@
00000019 r handle_process_do_command()::__c
00000019 r handle_process_condition_command()::__c
00000019 r do_jump()::__c
0000001a r print_log_menu()::__c
0000001a r Log_Read_Process(int, int)::__c
0000001a r failsafe_short_on_event()::__c
0000001a r do_jump()::__c
0000001a r do_jump()::__c
0000001a r Log_Read(int, int)::__c
0000001b r failsafe_short_off_event()::__c
0000001c W AP_VarA<float, (unsigned char)6>::unserialize(void*, unsigned int)
0000001c W AP_VarS<Matrix3<float> >::unserialize(void*, unsigned int)
@ -433,25 +436,25 @@
0000001c W AP_VarS<Matrix3<float> >::serialize(void*, unsigned int) const
0000001c W AP_VarS<Vector3<float> >::serialize(void*, unsigned int) const
0000001c r Log_Read_Current()::__c
0000001c r Log_Read(int, int)::__c
0000001c r Log_Read_Process(int, int)::__c
0000001c r Log_Read(int, int)::__c
0000001d r setup_radio(unsigned char, Menu::arg const*)::__c
0000001d r startup_ground()::__c
0000001d r report_batt_monitor()::__c
0000001e t update_commands()
0000001e r flight_mode_strings
0000001e r test_failsafe(unsigned char, Menu::arg const*)::__c
0000001e r startup_ground()::__c
0000001f r setup_compass(unsigned char, Menu::arg const*)::__c
0000001f r init_ardupilot()::__c
0000001f r print_log_menu()::__c
0000001f r Log_Read(int, int)::__c
0000001f r test_mag(unsigned char, Menu::arg const*)::__c
00000020 t gcs_send_message(ap_message)
00000020 r test_current(unsigned char, Menu::arg const*)::__c
00000020 r report_xtrack()::__c
00000020 r init_barometer()::__c
00000020 r Log_Read(int, int)::__c
00000020 t byte_swap_4
00000021 r print_log_menu()::__c
00000021 r print_log_menu()::__c
00000021 r verify_loiter_time()::__c
00000021 r process_next_command()::__c
00000022 t print_blanks(int)
@ -478,12 +481,11 @@
00000026 t print_done()
00000026 t print_hit_enter()
00000026 r init_ardupilot()::__c
00000026 r init_ardupilot()::__c
00000026 r print_PID(PID*)::__c
00000027 r change_command(unsigned char)::__c
00000027 r init_ardupilot()::__c
00000027 r test_xbee(unsigned char, Menu::arg const*)::__c
00000028 t main_menu_help(unsigned char, Menu::arg const*)
00000028 t help_log(unsigned char, Menu::arg const*)
00000028 W AP_VarT<float>::unserialize(void*, unsigned int)
00000028 W AP_VarT<long>::unserialize(void*, unsigned int)
00000028 W AP_VarT<float>::serialize(void*, unsigned int) const
@ -504,8 +506,6 @@
00000030 t planner_mode(unsigned char, Menu::arg const*)
00000030 t send_heartbeat(mavlink_channel_t)
00000030 t test_mode(unsigned char, Menu::arg const*)
00000030 r print_log_menu()::__c
00000031 r start_new_log(unsigned char)::__c
00000032 T GCS_MAVLINK::init(FastSerial*)
00000032 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000033 b pending_status
@ -516,10 +516,10 @@
00000035 r Log_Read_Nav_Tuning()::__c
00000035 r verify_condition_command()::__c
00000036 t report_radio()
00000036 t find_last()
00000036 r test_failsafe(unsigned char, Menu::arg const*)::__c
00000037 r setup_factory(unsigned char, Menu::arg const*)::__c
00000038 t send_current_waypoint(mavlink_channel_t)
00000038 b barometer
00000038 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000038 r dump_log(unsigned char, Menu::arg const*)::__c
00000039 r setup_radio(unsigned char, Menu::arg const*)::__c
@ -530,11 +530,13 @@
0000003a W PID::~PID()
0000003c t verify_RTL()
0000003c t Log_Write_Mode(unsigned char)
0000003c b barometer
0000003c r test_wp_print(Location*, unsigned char)::__c
0000003c r test_mag(unsigned char, Menu::arg const*)::__c
0000003d B g_gps_driver
0000003e T GCS_MAVLINK::send_text(gcs_severity, prog_char_t const*)
0000003e W AP_VarT<signed char>::AP_VarT(signed char, unsigned int, prog_char_t const*, unsigned char)
00000040 r log_menu_commands
00000040 b adc
00000040 W AP_Float16::unserialize(void*, unsigned int)
00000040 t byte_swap_8
@ -552,7 +554,6 @@
0000004c t Log_Read_Mode()
0000004e t setup_batt_monitor(unsigned char, Menu::arg const*)
00000050 b mavlink_queue
00000050 r log_menu_commands
00000050 r main_menu_commands
00000050 T GCS_MAVLINK::_find_parameter(unsigned int)
00000050 B imu
@ -566,7 +567,6 @@
0000005a W AP_VarT<float>::AP_VarT(float, unsigned int, prog_char_t const*, unsigned char)
0000005b r setup_erase(unsigned char, Menu::arg const*)::__c
0000005c t readSwitch()
0000005c t get_num_logs()
0000005e T GCS_MAVLINK::_count_parameters()
00000060 W AP_Float16::AP_Float16(AP_Var_group*, unsigned int, float, prog_char_t const*, unsigned char)
00000062 t print_switch(unsigned char, unsigned char)
@ -575,7 +575,6 @@
00000064 t test_xbee(unsigned char, Menu::arg const*)
00000064 W RC_Channel_aux::~RC_Channel_aux()
00000068 t zero_eeprom()
00000068 t find_last_log_page(int)
0000006a T mavlink_send_text(mavlink_channel_t, gcs_severity, char const*)
0000006a t demo_servos(unsigned char)
0000006a t startup_IMU_ground()
@ -609,6 +608,7 @@
0000009c t print_PID(PID*)
0000009c B gcs0
0000009c B gcs3
0000009e t get_num_logs()
000000a0 t report_xtrack()
000000a2 t verify_nav_wp()
000000a4 t Log_Read_Cmd()
@ -619,15 +619,16 @@
000000ac t Log_Read_Performance()
000000b0 t test_relay(unsigned char, Menu::arg const*)
000000b2 t Log_Read_Startup()
000000b6 t get_log_boundaries(unsigned char, int&, int&)
000000b7 b compass
000000bc t Log_Read_Control_Tuning()
000000be t update_events()
000000c0 t report_throttle()
000000c0 t calc_bearing_error()
000000c4 t Log_Read(int, int)
000000c6 t test_eedump(unsigned char, Menu::arg const*)
000000c6 t zero_airspeed()
000000c6 t startup_ground()
000000c6 t get_log_boundaries(unsigned char, int&, int&)
000000c7 B dcm
000000ca t send_radio_out(mavlink_channel_t)
000000ca t test_modeswitch(unsigned char, Menu::arg const*)
@ -635,15 +636,15 @@
000000ce t send_radio_in(mavlink_channel_t)
000000ce W PID::PID(unsigned int, prog_char_t const*, float const&, float const&, float const&, int const&)
000000ce r setup_mode(unsigned char, Menu::arg const*)::__c
000000ce r help_log(unsigned char, Menu::arg const*)::__c
000000d0 t get_bearing(Location*, Location*)
000000d4 t trim_radio()
000000e4 t test_radio_pwm(unsigned char, Menu::arg const*)
000000e7 r init_ardupilot()::__c
000000ec t dump_log(unsigned char, Menu::arg const*)
000000f0 t throttle_slew_limit()
000000f2 t test_adc(unsigned char, Menu::arg const*)
000000f6 t erase_logs(unsigned char, Menu::arg const*)
000000fa t Log_Read_Current()
000000fc t dump_log(unsigned char, Menu::arg const*)
00000102 t setup_compass(unsigned char, Menu::arg const*)
00000106 t test_current(unsigned char, Menu::arg const*)
00000106 t calc_nav_pitch()
@ -658,7 +659,6 @@
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000114 t read_barometer()
00000116 t erase_logs(unsigned char, Menu::arg const*)
00000118 t test_gps(unsigned char, Menu::arg const*)
00000120 t test_pressure(unsigned char, Menu::arg const*)
00000130 t test_dipswitches(unsigned char, Menu::arg const*)
@ -674,6 +674,7 @@
00000152 t verify_condition_command()
0000015a t test_airspeed(unsigned char, Menu::arg const*)
0000015e t set_guided_WP()
0000015e t Log_Read_Process(int, int)
0000015e t handle_process_nav_cmd()
0000015e t test_gyro(unsigned char, Menu::arg const*)
0000016c t navigate()
@ -682,12 +683,11 @@
00000174 t mavlink_send_message(mavlink_channel_t, ap_message, unsigned int)
0000017c t send_location(mavlink_channel_t)
0000017e t Log_Read_Nav_Tuning()
00000180 t send_extended_status1(mavlink_channel_t, unsigned int)
0000017e t send_extended_status1(mavlink_channel_t, unsigned int)
0000018c T GCS_MAVLINK::data_stream_send(unsigned int, unsigned int)
00000192 T init_home()
00000192 t test_imu(unsigned char, Menu::arg const*)
0000019c t do_jump()
000001ae t start_new_log(unsigned char)
000001b2 t update_crosstrack()
000001b2 t set_mode(unsigned char)
000001bc t set_next_WP(Location*)
@ -700,7 +700,6 @@
000001ea t init_barometer()
00000202 t test_failsafe(unsigned char, Menu::arg const*)
00000208 t calc_throttle()
00000216 t Log_Read(int, int)
0000021a t send_raw_imu1(mavlink_channel_t)
0000022a t send_gps_raw(mavlink_channel_t)
0000022c t process_next_command()
@ -710,16 +709,17 @@
0000024c t update_loiter()
0000025c t setup_radio(unsigned char, Menu::arg const*)
00000268 t send_raw_imu3(mavlink_channel_t)
00000268 t find_last_log_page(unsigned int)
000002d4 t handle_process_do_command()
000002e4 t read_radio()
0000031e t test_mag(unsigned char, Menu::arg const*)
0000033a W Parameters::~Parameters()
00000344 W Parameters::~Parameters()
000003e6 t read_battery()
0000044c t print_log_menu()
00000462 t print_log_menu()
000004de t set_servos()
0000059c t __static_initialization_and_destruction_0(int, int)
0000064a t init_ardupilot()
00000920 W Parameters::Parameters()
0000092b b g
00000694 t init_ardupilot()
00000936 W Parameters::Parameters()
00000938 b g
0000149a T GCS_MAVLINK::handleMessage(__mavlink_message*)
00001cbe T loop
00001caa T loop

View File

@ -3,10 +3,21 @@
In file included from /root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:32:
/usr/local/share/arduino/libraries/SPI/SPI.h:25:1: warning: "SPI_CLOCK_DIV64" redefined
/usr/local/share/arduino/libraries/SPI/SPI.h:20:1: warning: this is the location of the previous definition
/root/apm/ardupilot-mega/ArduPlane/Log.pde: In function 'int find_last_log_page(uint16_t)':
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:335: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:340: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:352: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:362: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:385: warning: comparison between signed and unsigned integer expressions
/root/apm/ardupilot-mega/ArduPlane/Log.pde:295: warning: unused variable 'look_page_file'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:296: warning: unused variable 'look_page_filepage'
/root/apm/ardupilot-mega/ArduPlane/Log.pde:297: warning: unused variable 'check'
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde: At global scope:
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde:2057: warning: 'void gcs_send_text(gcs_severity, const char*)' defined but not used
autogenerated:87: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
autogenerated:89: warning: 'void add_altitude_data(long unsigned int, long int)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/commands.pde:128: warning: 'void increment_cmd_index()' defined but not used
autogenerated:144: warning: 'void low_battery_event()' declared 'static' but never defined
autogenerated:146: warning: 'void low_battery_event()' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:270: warning: 'command_index' defined but not used
%% libraries/APM_BMP085/APM_BMP085.o
%% libraries/APM_BMP085/APM_BMP085_hil.o

View File

@ -219,6 +219,7 @@
0000000a r init_home()::__c
0000000a r test_relay(unsigned char, Menu::arg const*)::__c
0000000a r verify_nav_wp()::__c
0000000a r print_log_menu()::__c
0000000a r report_compass()::__c
0000000a r report_throttle()::__c
0000000a r test_mag(unsigned char, Menu::arg const*)::__c
@ -283,6 +284,7 @@
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d V Parameters::Parameters()::__c
0000000d B sonar_mode_filter
0000000e t global destructors keyed to Serial
0000000e t global constructors keyed to Serial
@ -343,6 +345,7 @@
0000000f V AP_IMU_Oilpan::AP_IMU_Oilpan(AP_ADC*, unsigned int)::__c
00000010 b rc_override
00000010 r planner_menu_commands
00000010 r __menu_name__main_menu
00000010 T GCS_MAVLINK::send_message(ap_message)
00000010 W AP_VarT<float>::cast_to_float() const
00000010 W AP_VarT<long>::cast_to_float() const
@ -351,7 +354,6 @@
00000010 r Log_Read_Startup()::__c
00000010 r test_wp(unsigned char, Menu::arg const*)::__c
00000010 r dump_log(unsigned char, Menu::arg const*)::__c
00000011 r __menu_name__main_menu
00000011 r erase_logs(unsigned char, Menu::arg const*)::__c
00000011 r zero_eeprom()::__c
00000011 r test_airspeed(unsigned char, Menu::arg const*)::__c
@ -420,10 +422,11 @@
00000019 r handle_process_do_command()::__c
00000019 r handle_process_condition_command()::__c
00000019 r do_jump()::__c
0000001a r print_log_menu()::__c
0000001a r Log_Read_Process(int, int)::__c
0000001a r failsafe_short_on_event()::__c
0000001a r do_jump()::__c
0000001a r do_jump()::__c
0000001a r Log_Read(int, int)::__c
0000001b r failsafe_short_off_event()::__c
0000001c W AP_VarA<float, (unsigned char)6>::unserialize(void*, unsigned int)
0000001c W AP_VarS<Matrix3<float> >::unserialize(void*, unsigned int)
@ -433,25 +436,25 @@
0000001c W AP_VarS<Matrix3<float> >::serialize(void*, unsigned int) const
0000001c W AP_VarS<Vector3<float> >::serialize(void*, unsigned int) const
0000001c r Log_Read_Current()::__c
0000001c r Log_Read(int, int)::__c
0000001c r Log_Read_Process(int, int)::__c
0000001c r Log_Read(int, int)::__c
0000001d r setup_radio(unsigned char, Menu::arg const*)::__c
0000001d r startup_ground()::__c
0000001d r report_batt_monitor()::__c
0000001e t update_commands()
0000001e r flight_mode_strings
0000001e r test_failsafe(unsigned char, Menu::arg const*)::__c
0000001e r startup_ground()::__c
0000001f r setup_compass(unsigned char, Menu::arg const*)::__c
0000001f r init_ardupilot()::__c
0000001f r print_log_menu()::__c
0000001f r Log_Read(int, int)::__c
0000001f r test_mag(unsigned char, Menu::arg const*)::__c
00000020 t gcs_send_message(ap_message)
00000020 r test_current(unsigned char, Menu::arg const*)::__c
00000020 r report_xtrack()::__c
00000020 r init_barometer()::__c
00000020 r Log_Read(int, int)::__c
00000020 t byte_swap_4
00000021 r print_log_menu()::__c
00000021 r print_log_menu()::__c
00000021 r verify_loiter_time()::__c
00000021 r process_next_command()::__c
00000022 t print_blanks(int)
@ -478,12 +481,11 @@
00000026 t print_done()
00000026 t print_hit_enter()
00000026 r init_ardupilot()::__c
00000026 r init_ardupilot()::__c
00000026 r print_PID(PID*)::__c
00000027 r change_command(unsigned char)::__c
00000027 r init_ardupilot()::__c
00000027 r test_xbee(unsigned char, Menu::arg const*)::__c
00000028 t main_menu_help(unsigned char, Menu::arg const*)
00000028 t help_log(unsigned char, Menu::arg const*)
00000028 W AP_VarT<float>::unserialize(void*, unsigned int)
00000028 W AP_VarT<long>::unserialize(void*, unsigned int)
00000028 W AP_VarT<float>::serialize(void*, unsigned int) const
@ -504,8 +506,6 @@
00000030 t planner_mode(unsigned char, Menu::arg const*)
00000030 t send_heartbeat(mavlink_channel_t)
00000030 t test_mode(unsigned char, Menu::arg const*)
00000030 r print_log_menu()::__c
00000031 r start_new_log(unsigned char)::__c
00000032 T GCS_MAVLINK::init(FastSerial*)
00000032 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000033 b pending_status
@ -516,10 +516,10 @@
00000035 r Log_Read_Nav_Tuning()::__c
00000035 r verify_condition_command()::__c
00000036 t report_radio()
00000036 t find_last()
00000036 r test_failsafe(unsigned char, Menu::arg const*)::__c
00000037 r setup_factory(unsigned char, Menu::arg const*)::__c
00000038 t send_current_waypoint(mavlink_channel_t)
00000038 b barometer
00000038 r test_dipswitches(unsigned char, Menu::arg const*)::__c
00000038 r dump_log(unsigned char, Menu::arg const*)::__c
00000039 r setup_radio(unsigned char, Menu::arg const*)::__c
@ -530,11 +530,13 @@
0000003a W PID::~PID()
0000003c t verify_RTL()
0000003c t Log_Write_Mode(unsigned char)
0000003c b barometer
0000003c r test_wp_print(Location*, unsigned char)::__c
0000003c r test_mag(unsigned char, Menu::arg const*)::__c
0000003d B g_gps_driver
0000003e T GCS_MAVLINK::send_text(gcs_severity, prog_char_t const*)
0000003e W AP_VarT<signed char>::AP_VarT(signed char, unsigned int, prog_char_t const*, unsigned char)
00000040 r log_menu_commands
00000040 b adc
00000040 W AP_Float16::unserialize(void*, unsigned int)
00000040 t byte_swap_8
@ -552,7 +554,6 @@
0000004c t Log_Read_Mode()
0000004e t setup_batt_monitor(unsigned char, Menu::arg const*)
00000050 b mavlink_queue
00000050 r log_menu_commands
00000050 r main_menu_commands
00000050 T GCS_MAVLINK::_find_parameter(unsigned int)
00000050 B imu
@ -566,7 +567,6 @@
0000005a W AP_VarT<float>::AP_VarT(float, unsigned int, prog_char_t const*, unsigned char)
0000005b r setup_erase(unsigned char, Menu::arg const*)::__c
0000005c t readSwitch()
0000005c t get_num_logs()
0000005e T GCS_MAVLINK::_count_parameters()
00000060 t print_switch(unsigned char, unsigned char)
00000060 W AP_Float16::AP_Float16(AP_Var_group*, unsigned int, float, prog_char_t const*, unsigned char)
@ -575,7 +575,6 @@
00000064 t test_xbee(unsigned char, Menu::arg const*)
00000064 W RC_Channel_aux::~RC_Channel_aux()
00000068 t zero_eeprom()
00000068 t find_last_log_page(int)
0000006a T mavlink_send_text(mavlink_channel_t, gcs_severity, char const*)
0000006a t demo_servos(unsigned char)
0000006a t startup_IMU_ground()
@ -609,6 +608,7 @@
0000009c t print_PID(PID*)
0000009c B gcs0
0000009c B gcs3
0000009e t get_num_logs()
000000a0 t report_xtrack()
000000a2 t verify_nav_wp()
000000a4 t Log_Read_Cmd()
@ -619,31 +619,32 @@
000000ac t Log_Read_Performance()
000000b0 t test_relay(unsigned char, Menu::arg const*)
000000b0 t Log_Read_Startup()
000000b6 t get_log_boundaries(unsigned char, int&, int&)
000000b7 b compass
000000bc t Log_Read_Control_Tuning()
000000be t update_events()
000000c0 t report_throttle()
000000c0 t calc_bearing_error()
000000c0 t Log_Read(int, int)
000000c2 t test_eedump(unsigned char, Menu::arg const*)
000000c6 t zero_airspeed()
000000c6 t startup_ground()
000000c7 B dcm
000000c8 t test_modeswitch(unsigned char, Menu::arg const*)
000000c8 t get_log_boundaries(unsigned char, int&, int&)
000000ca t send_radio_out(mavlink_channel_t)
000000ca t control_failsafe(unsigned int)
000000ce t send_radio_in(mavlink_channel_t)
000000ce W PID::PID(unsigned int, prog_char_t const*, float const&, float const&, float const&, int const&)
000000ce r setup_mode(unsigned char, Menu::arg const*)::__c
000000ce r help_log(unsigned char, Menu::arg const*)::__c
000000d0 t get_bearing(Location*, Location*)
000000d4 t trim_radio()
000000e4 t test_radio_pwm(unsigned char, Menu::arg const*)
000000e7 r init_ardupilot()::__c
000000ec t dump_log(unsigned char, Menu::arg const*)
000000f0 t throttle_slew_limit()
000000f0 t test_adc(unsigned char, Menu::arg const*)
000000f4 t erase_logs(unsigned char, Menu::arg const*)
000000fa t Log_Read_Current()
000000fc t dump_log(unsigned char, Menu::arg const*)
00000102 t setup_compass(unsigned char, Menu::arg const*)
00000106 t test_current(unsigned char, Menu::arg const*)
00000106 t calc_nav_pitch()
@ -657,7 +658,6 @@
00000112 t report_batt_monitor()
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000112 T GCS_MAVLINK::GCS_MAVLINK(unsigned int)
00000114 t erase_logs(unsigned char, Menu::arg const*)
00000114 t read_barometer()
00000118 t test_gps(unsigned char, Menu::arg const*)
00000120 t test_pressure(unsigned char, Menu::arg const*)
@ -673,6 +673,7 @@
00000152 t report_gains()
00000152 t verify_condition_command()
00000158 t test_airspeed(unsigned char, Menu::arg const*)
0000015a t Log_Read_Process(int, int)
0000015e t set_guided_WP()
0000015e t handle_process_nav_cmd()
0000015e t test_gyro(unsigned char, Menu::arg const*)
@ -682,12 +683,11 @@
00000174 t mavlink_send_message(mavlink_channel_t, ap_message, unsigned int)
0000017c t send_location(mavlink_channel_t)
0000017e t Log_Read_Nav_Tuning()
00000180 t send_extended_status1(mavlink_channel_t, unsigned int)
0000017e t send_extended_status1(mavlink_channel_t, unsigned int)
0000018c T GCS_MAVLINK::data_stream_send(unsigned int, unsigned int)
00000190 T init_home()
00000192 t test_imu(unsigned char, Menu::arg const*)
0000019a t do_jump()
000001ae t start_new_log(unsigned char)
000001b2 t update_crosstrack()
000001b2 t set_mode(unsigned char)
000001bc t set_next_WP(Location*)
@ -700,7 +700,6 @@
000001ea t init_barometer()
000001fe t test_failsafe(unsigned char, Menu::arg const*)
00000208 t calc_throttle()
00000210 t Log_Read(int, int)
0000021a t send_raw_imu1(mavlink_channel_t)
00000228 t test_wp(unsigned char, Menu::arg const*)
0000022a t send_gps_raw(mavlink_channel_t)
@ -710,16 +709,17 @@
0000024c t update_loiter()
0000025c t setup_radio(unsigned char, Menu::arg const*)
00000268 t send_raw_imu3(mavlink_channel_t)
00000268 t find_last_log_page(unsigned int)
000002d4 t handle_process_do_command()
000002e4 t read_radio()
0000031e t test_mag(unsigned char, Menu::arg const*)
0000033a W Parameters::~Parameters()
00000344 W Parameters::~Parameters()
000003e6 t read_battery()
00000436 t print_log_menu()
0000044c t print_log_menu()
000004de t set_servos()
0000059c t __static_initialization_and_destruction_0(int, int)
00000648 t init_ardupilot()
00000920 W Parameters::Parameters()
0000092b b g
00000692 t init_ardupilot()
00000936 W Parameters::Parameters()
00000938 b g
0000149a T GCS_MAVLINK::handleMessage(__mavlink_message*)
00001cbe T loop
00001caa T loop

View File

@ -13,14 +13,14 @@ autogenerated:35: warning: 'void send_raw_imu2(mavlink_channel_t)' declared 'sta
autogenerated:36: warning: 'void send_raw_imu3(mavlink_channel_t)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde:2057: warning: 'void gcs_send_text(gcs_severity, const char*)' defined but not used
autogenerated:49: warning: 'bool print_log_menu()' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/Log.pde:841: warning: 'byte get_num_logs()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:842: warning: 'byte get_num_logs()' defined but not used
autogenerated:52: warning: 'void get_log_boundaries(byte, int&, int&)' declared 'static' but never defined
autogenerated:53: warning: 'int find_last()' declared 'static' but never defined
autogenerated:54: warning: 'int find_last_log_page(uint16_t)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/Log.pde:843: warning: 'void Log_Write_Attitude(int, int, uint16_t)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:839: warning: 'void Log_Write_Performance()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:844: warning: 'void Log_Write_Control_Tuning()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:845: warning: 'void Log_Write_Raw()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:844: warning: 'void Log_Write_Attitude(int, int, uint16_t)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:840: warning: 'void Log_Write_Performance()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:845: warning: 'void Log_Write_Control_Tuning()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:846: warning: 'void Log_Write_Raw()' defined but not used
autogenerated:65: warning: 'void Log_Read_Current()' declared 'static' but never defined
autogenerated:66: warning: 'void Log_Read_Control_Tuning()' declared 'static' but never defined
autogenerated:67: warning: 'void Log_Read_Nav_Tuning()' declared 'static' but never defined
@ -68,7 +68,7 @@ autogenerated:201: warning: 'void test_wp_print(Location*, byte)' declared 'stat
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:304: warning: 'airspeed_raw' defined but not used
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:305: warning: 'airspeed_pressure' defined but not used
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:309: warning: 'abs_pressure' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:840: warning: 'int8_t process_logs(uint8_t, const Menu::arg*)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:841: warning: 'int8_t process_logs(uint8_t, const Menu::arg*)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/planner.pde:19: warning: 'int8_t planner_mode(uint8_t, const Menu::arg*)' defined but not used
%% libraries/APM_BMP085/APM_BMP085.o
%% libraries/APM_BMP085/APM_BMP085_hil.o

View File

@ -311,8 +311,8 @@
00000023 r verify_loiter_turns()::__c
00000023 r navigate()::__c
00000026 r init_ardupilot()::__c
00000026 r init_ardupilot()::__c
00000027 r change_command(unsigned char)::__c
00000027 r init_ardupilot()::__c
00000028 t demo_servos(unsigned char)
00000028 W AP_VarT<float>::unserialize(void*, unsigned int)
00000028 W AP_VarT<long>::unserialize(void*, unsigned int)

View File

@ -13,14 +13,14 @@ autogenerated:35: warning: 'void send_raw_imu2(mavlink_channel_t)' declared 'sta
autogenerated:36: warning: 'void send_raw_imu3(mavlink_channel_t)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/GCS_Mavlink.pde:2057: warning: 'void gcs_send_text(gcs_severity, const char*)' defined but not used
autogenerated:49: warning: 'bool print_log_menu()' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/Log.pde:841: warning: 'byte get_num_logs()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:842: warning: 'byte get_num_logs()' defined but not used
autogenerated:52: warning: 'void get_log_boundaries(byte, int&, int&)' declared 'static' but never defined
autogenerated:53: warning: 'int find_last()' declared 'static' but never defined
autogenerated:54: warning: 'int find_last_log_page(uint16_t)' declared 'static' but never defined
/root/apm/ardupilot-mega/ArduPlane/Log.pde:843: warning: 'void Log_Write_Attitude(int, int, uint16_t)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:839: warning: 'void Log_Write_Performance()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:844: warning: 'void Log_Write_Control_Tuning()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:845: warning: 'void Log_Write_Raw()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:844: warning: 'void Log_Write_Attitude(int, int, uint16_t)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:840: warning: 'void Log_Write_Performance()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:845: warning: 'void Log_Write_Control_Tuning()' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:846: warning: 'void Log_Write_Raw()' defined but not used
autogenerated:65: warning: 'void Log_Read_Current()' declared 'static' but never defined
autogenerated:66: warning: 'void Log_Read_Control_Tuning()' declared 'static' but never defined
autogenerated:67: warning: 'void Log_Read_Nav_Tuning()' declared 'static' but never defined
@ -68,7 +68,7 @@ autogenerated:201: warning: 'void test_wp_print(Location*, byte)' declared 'stat
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:304: warning: 'airspeed_raw' defined but not used
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:305: warning: 'airspeed_pressure' defined but not used
/root/apm/ardupilot-mega/ArduPlane/ArduPlane.pde:309: warning: 'abs_pressure' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:840: warning: 'int8_t process_logs(uint8_t, const Menu::arg*)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/Log.pde:841: warning: 'int8_t process_logs(uint8_t, const Menu::arg*)' defined but not used
/root/apm/ardupilot-mega/ArduPlane/planner.pde:19: warning: 'int8_t planner_mode(uint8_t, const Menu::arg*)' defined but not used
%% libraries/APM_BMP085/APM_BMP085.o
%% libraries/APM_BMP085/APM_BMP085_hil.o

View File

@ -311,8 +311,8 @@
00000023 r verify_loiter_turns()::__c
00000023 r navigate()::__c
00000026 r init_ardupilot()::__c
00000026 r init_ardupilot()::__c
00000027 r change_command(unsigned char)::__c
00000027 r init_ardupilot()::__c
00000028 t demo_servos(unsigned char)
00000028 W AP_VarT<float>::unserialize(void*, unsigned int)
00000028 W AP_VarT<long>::unserialize(void*, unsigned int)

View File

@ -3,14 +3,14 @@
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AP-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AP-2560.hex</url2560>
<name>ArduPlane V2.251 </name>
<name>ArduPlane V2.26 </name>
<desc></desc>
<format_version>12</format_version>
</Firmware>
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/APHIL-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/APHIL-2560.hex</url2560>
<name>ArduPlane V2.251 HIL</name>
<name>ArduPlane V2.26 HIL</name>
<desc>
#define FLIGHT_MODE_CHANNEL 8
#define FLIGHT_MODE_1 AUTO
@ -44,53 +44,53 @@
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AP-trunk-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AP-trunk-2560.hex</url2560>
<name>ArduPlane V2.251 APM trunk</name>
<name>ArduPlane V2.26 APM trunk</name>
<desc></desc>
<format_version>12</format_version>
</Firmware>
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Quad-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Quad-2560.hex</url2560>
<name>ArduCopter V2.0.49 Beta Quad</name>
<name>ArduCopter V2.0.50 Beta Quad</name>
<desc>
#define FRAME_CONFIG QUAD_FRAME
#define FRAME_ORIENTATION X_FRAME
</desc>
<format_version>111</format_version>
<format_version>112</format_version>
</Firmware>
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Tri-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Tri-2560.hex</url2560>
<name>ArduCopter V2.0.49 Beta Tri</name>
<name>ArduCopter V2.0.50 Beta Tri</name>
<desc>
#define FRAME_CONFIG TRI_FRAME
#define FRAME_ORIENTATION X_FRAME
</desc>
<format_version>111</format_version>
<format_version>112</format_version>
</Firmware>
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Hexa-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Hexa-2560.hex</url2560>
<name>ArduCopter V2.0.49 Beta Hexa</name>
<name>ArduCopter V2.0.50 Beta Hexa</name>
<desc>
#define FRAME_CONFIG HEXA_FRAME
#define FRAME_ORIENTATION X_FRAME
</desc>
<format_version>111</format_version>
<format_version>112</format_version>
</Firmware>
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Y6-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Y6-2560.hex</url2560>
<name>ArduCopter V2.0.49 Beta Y6</name>
<name>ArduCopter V2.0.50 Beta Y6</name>
<desc>
#define FRAME_CONFIG Y6_FRAME
#define FRAME_ORIENTATION X_FRAME
</desc>
<format_version>111</format_version>
<format_version>112</format_version>
</Firmware>
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-Heli-1280.hex</url>
@ -142,7 +142,7 @@
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-QUADHIL-1280.hex</url>
<url2560>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-QUADHIL-2560.hex</url2560>
<name>ArduCopter V2.0.49 Beta Quad Hil</name>
<name>ArduCopter V2.0.50 Beta Quad Hil</name>
<desc>
#define FRAME_CONFIG QUAD_FRAME
#define FRAME_ORIENTATION PLUS_FRAME
@ -152,7 +152,7 @@
</desc>
<format_version>111</format_version>
<format_version>112</format_version>
</Firmware>
<Firmware>
<url>http://ardupilot-mega.googlecode.com/git/Tools/ArdupilotMegaPlanner/Firmware/AC2-HELHIL-1280.hex</url>

View File

@ -1,29 +1,20 @@
From https://code.google.com/p/ardupilot-mega
66cc8dd..6f4e7ec master -> origin/master
Updating 66cc8dd..6f4e7ec
6aeabd0..833acbd master -> origin/master
Updating 6aeabd0..833acbd
Fast-forward
ArduCopter/APM_Config.h | 2 +-
ArduCopter/ArduCopter.pde | 18 ++-
ArduCopter/commands.pde | 8 +-
ArduCopter/commands_process.pde | 3 +-
ArduCopter/motors_hexa.pde | 2 +-
ArduCopter/motors_octa.pde | 2 +-
ArduCopter/motors_octa_quad.pde | 2 +-
ArduCopter/motors_y6.pde | 3 +-
ArduPlane/ArduPlane.pde | 2 +-
ArduPlane/Log.pde | 5 +-
ArduPlane/commands_logic.pde | 13 ++-
Tools/ArdupilotMegaPlanner/CurrentState.cs | 1 -
Tools/ArdupilotMegaPlanner/GCSViews/FlightData.cs | 27 +++-
.../ArdupilotMegaPlanner/GCSViews/FlightPlanner.cs | 149 +++++++++++++++++---
Tools/ArdupilotMegaPlanner/HIL/QuadCopter.cs | 14 ++-
.../Properties/AssemblyInfo.cs | 2 +-
.../bin/Release/ArdupilotMegaPlanner.application | 2 +-
.../bin/Release/ArdupilotMegaPlanner.exe | Bin 2194432 -> 2195456 bytes
Tools/ArdupilotMegaPlanner/bin/Release/Updater.exe | Bin 8192 -> 8192 bytes
Tools/ArdupilotMegaPlanner/bin/Release/resedit.exe | Bin 20480 -> 20480 bytes
.../ru-RU/ArdupilotMegaPlanner.resources.dll | Bin 53248 -> 53248 bytes
.../zh-Hans/ArdupilotMegaPlanner.resources.dll | Bin 380928 -> 380928 bytes
Tools/autotest/arducopter.py | 58 ++++++---
Tools/autotest/common.py | 16 ++-
24 files changed, 251 insertions(+), 78 deletions(-)
ArduCopter/ArduCopter.pde | 11 ++++-
ArduCopter/Attitude.pde | 1 -
ArduCopter/Log.pde | 28 ++++++------
ArduCopter/Parameters.h | 50 +++++++++--------------
ArduCopter/config.h | 20 +--------
ArduCopter/defines.h | 2 +
ArduCopter/navigation.pde | 17 ++++++--
ArduCopter/radio.pde | 9 +----
ArduCopter/setup.pde | 52 ++++++++++++------------
ArduCopter/system.pde | 22 ++++++----
ArduCopter/test.pde | 63 +++++++++++++++--------------
ArduPlane/ArduPlane.pde | 2 +-
ArduPlane/Log.pde | 91 +++++++++++++++++++++---------------------
Tools/autotest/arducopter.py | 10 ++--
Tools/autotest/common.py | 8 +++-
15 files changed, 193 insertions(+), 193 deletions(-)