%% ArduCopter.cpp %% ArduCopter.o In file included from /root/apm/ardupilot-mega/ArduCopter/ArduCopter.pde:53: /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 autogenerated:34: warning: 'int alt_hold_velocity()' declared 'static' but never defined autogenerated:86: warning: 'void acknowledge(byte, byte, byte)' declared 'static' but never defined autogenerated:87: warning: 'void send_message(byte)' declared 'static' but never defined autogenerated:88: warning: 'void send_message(byte, long int)' declared 'static' but never defined autogenerated:82: warning: 'void send_message(byte, const char*)' declared 'static' but never defined autogenerated:91: warning: 'void print_current_waypoints()' declared 'static' but never defined autogenerated:94: warning: 'void print_attitude()' declared 'static' but never defined autogenerated:90: warning: 'void print_control_mode()' declared 'static' but never defined autogenerated:92: warning: 'void print_position()' declared 'static' but never defined autogenerated:96: warning: 'void print_waypoint(Location*, byte)' declared 'static' but never defined autogenerated:97: warning: 'void print_waypoints()' declared 'static' but never defined autogenerated:70: warning: 'long int convert_to_dec(float)' declared 'static' but never defined autogenerated:139: warning: 'void Log_Write_Optflow()' declared 'static' but never defined autogenerated:150: warning: 'void decrement_WP_index()' declared 'static' but never defined /root/apm/ardupilot-mega/ArduCopter/commands.pde:149: warning: 'Location get_LOITER_home_wp()' defined but not used /root/apm/ardupilot-mega/ArduCopter/commands_logic.pde:301: warning: 'void do_loiter_turns()' defined but not used /root/apm/ardupilot-mega/ArduCopter/commands_logic.pde:427: warning: 'bool verify_loiter_unlim()' defined but not used /root/apm/ardupilot-mega/ArduCopter/events.pde:46: warning: 'void low_battery_event()' defined but not used autogenerated:210: warning: 'void heli_init_swash()' declared 'static' but never defined autogenerated:211: warning: 'void heli_move_servos_to_mid()' declared 'static' but never defined autogenerated:212: warning: 'void heli_move_swash(int, int, int, int)' declared 'static' but never defined autogenerated:235: warning: 'void debug_motors()' declared 'static' but never defined autogenerated:250: warning: 'void calc_altitude_smoothing_error()' declared 'static' but never defined /root/apm/ardupilot-mega/ArduCopter/navigation.pde:159: warning: 'int get_loiter_angle()' defined but not used /root/apm/ardupilot-mega/ArduCopter/navigation.pde:217: warning: 'void reset_crosstrack()' defined but not used /root/apm/ardupilot-mega/ArduCopter/navigation.pde:222: warning: 'long int get_altitude_above_home()' defined but not used /root/apm/ardupilot-mega/ArduCopter/navigation.pde:243: warning: 'long int get_alt_distance(Location*, Location*)' defined but not used /root/apm/ardupilot-mega/ArduCopter/radio.pde:131: warning: 'void throttle_failsafe(uint16_t)' defined but not used /root/apm/ardupilot-mega/ArduCopter/radio.pde:188: warning: 'void trim_yaw()' defined but not used autogenerated:268: warning: 'void readCommands()' declared 'static' but never defined autogenerated:269: warning: 'void parseCommand(char*)' declared 'static' but never defined /root/apm/ardupilot-mega/ArduCopter/sensors.pde:6: warning: 'void ReadSCP1000()' defined but not used autogenerated:272: warning: 'long int read_baro_filtered()' declared 'static' but never defined /root/apm/ardupilot-mega/ArduCopter/sensors.pde:95: warning: 'void read_airspeed()' defined but not used /root/apm/ardupilot-mega/ArduCopter/sensors.pde:100: warning: 'void zero_airspeed()' defined but not used autogenerated:286: warning: 'void report_heli()' declared 'static' but never defined autogenerated:287: warning: 'void report_gyro()' declared 'static' but never defined autogenerated:295: warning: 'RC_Channel* heli_get_servo(int)' declared 'static' but never defined autogenerated:296: warning: 'int read_num_from_serial()' declared 'static' but never defined /root/apm/ardupilot-mega/ArduCopter/system.pde:465: warning: 'void set_failsafe(boolean)' defined but not used autogenerated:311: warning: 'void init_optflow()' declared 'static' but never defined autogenerated:319: warning: 'void fake_out_gps()' declared 'static' but never defined /root/apm/ardupilot-mega/ArduCopter/test.pde:991: warning: 'void print_motor_out()' defined but not used /root/apm/ardupilot-mega/ArduCopter/ArduCopter.pde:443: warning: 'undo_event' defined but not used /root/apm/ardupilot-mega/ArduCopter/ArduCopter.pde:449: warning: 'condition_rate' defined but not used /root/apm/ardupilot-mega/ArduCopter/ArduCopter.pde:463: warning: 'simple_WP' defined but not used /root/apm/ardupilot-mega/ArduCopter/ArduCopter.pde:468: warning: 'optflow_offset' defined but not used /root/apm/ardupilot-mega/ArduCopter/ArduCopter.pde:469: warning: 'new_location' defined but not used %% libraries/APM_BMP085/APM_BMP085.o %% libraries/APM_PI/APM_PI.o %% libraries/APM_RC/APM_RC.o %% libraries/AP_ADC/AP_ADC_ADS7844.o %% libraries/AP_ADC/AP_ADC.o %% libraries/AP_ADC/AP_ADC_HIL.o %% libraries/AP_Common/AP_Common.o %% libraries/AP_Common/AP_Loop.o %% libraries/AP_Common/AP_MetaClass.o %% libraries/AP_Common/AP_Var.o %% libraries/AP_Common/AP_Var_menufuncs.o %% libraries/AP_Common/c++.o %% libraries/AP_Common/menu.o %% libraries/AP_Compass/AP_Compass_HIL.o %% libraries/AP_Compass/AP_Compass_HMC5843.o %% libraries/AP_Compass/Compass.o %% libraries/AP_DCM/AP_DCM.o %% libraries/AP_DCM/AP_DCM_HIL.o %% libraries/AP_GPS/AP_GPS_406.o %% libraries/AP_GPS/AP_GPS_Auto.o %% libraries/AP_GPS/AP_GPS_HIL.o %% libraries/AP_GPS/AP_GPS_IMU.o %% libraries/AP_GPS/AP_GPS_MTK16.o %% libraries/AP_GPS/AP_GPS_MTK.o %% libraries/AP_GPS/AP_GPS_NMEA.o %% libraries/AP_GPS/AP_GPS_SIRF.o %% libraries/AP_GPS/AP_GPS_UBLOX.o %% libraries/AP_GPS/GPS.o %% libraries/AP_IMU/AP_IMU_Oilpan.o %% libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.o In file included from /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:28: /usr/local/share/arduino/libraries/SPI/../SPI/SPI.h:25:1: warning: "SPI_CLOCK_DIV64" redefined /usr/local/share/arduino/libraries/SPI/../SPI/SPI.h:20:1: warning: this is the location of the previous definition /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp: In member function 'void AP_OpticalFlow_ADNS3080::set_led_always_on(bool)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:221: warning: suggest parentheses around arithmetic in operand of | /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp: In member function 'bool AP_OpticalFlow_ADNS3080::get_frame_rate_auto()': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:257: warning: suggest parentheses around comparison in operand of & /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp: In member function 'void AP_OpticalFlow_ADNS3080::set_shutter_speed_auto(bool)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:361: warning: suggest parentheses around arithmetic in operand of | /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp: In member function 'unsigned int AP_OpticalFlow_ADNS3080::set_shutter_speed(unsigned int)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:408: warning: no return statement in function returning non-void /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp: In member function 'int AP_OpticalFlow_ADNS3080::print_pixel_data(Stream*)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:441: warning: suggest parentheses around comparison in operand of & /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:456: warning: no return statement in function returning non-void /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:456: warning: control reaches end of non-void function /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp: In member function 'unsigned int AP_OpticalFlow_ADNS3080::set_shutter_speed(unsigned int)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:408: warning: control reaches end of non-void function /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp: In member function 'virtual bool AP_OpticalFlow_ADNS3080::init(bool)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow_ADNS3080.cpp:80: warning: control reaches end of non-void function %% libraries/AP_OpticalFlow/AP_OpticalFlow.o /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp: In member function 'virtual int AP_OpticalFlow::read()': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp:38: warning: no return statement in function returning non-void /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp: In member function 'virtual byte AP_OpticalFlow::read_register(byte)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp:44: warning: no return statement in function returning non-void /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp: In member function 'virtual void AP_OpticalFlow::get_position(float, float, float, float)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp:88: warning: unused variable 'i' /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp: In member function 'virtual byte AP_OpticalFlow::read_register(byte)': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp:44: warning: control reaches end of non-void function /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp: In member function 'virtual int AP_OpticalFlow::read()': /root/apm/ardupilot-mega/libraries/AP_OpticalFlow/AP_OpticalFlow.cpp:38: warning: control reaches end of non-void function %% libraries/AP_RangeFinder/AP_RangeFinder_MaxsonarXL.o %% libraries/AP_RangeFinder/AP_RangeFinder_SharpGP2Y.o %% libraries/AP_RangeFinder/RangeFinder.o %% libraries/DataFlash/DataFlash.o In file included from /root/apm/ardupilot-mega/libraries/DataFlash/DataFlash.cpp:35: /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 %% libraries/FastSerial/BetterStream.o %% libraries/FastSerial/FastSerial.o %% libraries/FastSerial/vprintf.o %% libraries/GCS_MAVLink/GCS_MAVLink.o %% libraries/ModeFilter/ModeFilter.o %% libraries/RC_Channel/RC_Channel.o %% libraries/memcheck/memcheck.o %% libraries/FastSerial/ftoa_engine.o %% libraries/FastSerial/ultoa_invert.o %% libraries/SPI/SPI.o In file included from /usr/local/share/arduino/libraries/SPI/SPI.cpp:12: /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 %% libraries/Wire/Wire.o %% libraries/Wire/utility/twi.o cc1: warning: command line option "-Wno-reorder" is valid for C++/ObjC++ but not for C %% arduino/HardwareSerial.o In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/HardwareSerial.cpp:28: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." %% arduino/main.o %% arduino/Print.o %% arduino/Tone.o /usr/local/share/arduino/hardware/arduino/cores/arduino/Tone.cpp:93: warning: only initialized variables can be placed into program memory area %% arduino/WMath.o %% arduino/WString.o In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:26: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:84: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:85: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:86: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:87: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:88: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:89: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:90: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:91: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:93: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:94: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:95: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:100: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:101: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:102: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:103: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:104: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:105: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:106: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:107: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:109: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:110: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:111: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:116: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:117: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:118: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:119: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:120: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:121: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:122: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:123: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:125: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:126: warning: initialization makes integer from pointer without a cast /usr/local/share/arduino/hardware/arduino/cores/arduino/pins_arduino.c:127: warning: initialization makes integer from pointer without a cast In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/WInterrupts.c:34: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_analog.c:27: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring.c:25: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_digital.c:27: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_pulse.c:25: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." In file included from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_private.h:30, from /usr/local/share/arduino/hardware/arduino/cores/arduino/wiring_shift.c:25: /usr/lib/gcc/avr/4.3.5/../../../avr/include/avr/delay.h:36:2: warning: #warning "This file has been moved to ." %% arduino/core.a %% ArduCopter.elf %% ArduCopter.eep %% ArduCopter.hex