Quantcast
Channel: ArduPilot Discourse - Latest topics
Viewing all 46064 articles
Browse latest View live

Throttle not not reach max setting in autotakeoff


Low Battery warning to stay on screen

$
0
0

@RobMor wrote:

Hello,
is there a way to make the “low battery” warning to remain on the screen (for example of the Mission Planner HUD) permanently, once triggered once ?
It currently disappears after a few seconds:it is very easy to miss it, which might be dangerous …

See laso my post on Misison Planner with some pictures:

Thanks !

Posts: 1

Participants: 1

Read full topic

Cannot pass --osd parameter in sim_vehicle.py

$
0
0

@Marc_Dornan wrote:

This is my error (and I cannot find how to install libsfml-dev. It does not seem to be a cygwin64 package.)

$ sim_vehicle.py -v ArduPlane -f plane-vtail -b omnibusF4pro -l 42.221875,-87.907888,0,90 --console --map --osd
SIM_VEHICLE: Start
SIM_VEHICLE: Killing tasks
SIM_VEHICLE: Starting up at 42.221875,-87.907888,0,90
SIM_VEHICLE: WAF build
SIM_VEHICLE: Configure waf
SIM_VEHICLE: “/home/marc/ardupilot/modules/waf/waf-light” “configure” “–board” “sitl” “–enable-sfml” “–sitl-osd”
Setting top to : /home/marc/ardupilot
Setting out to : /home/marc/ardupilot/build
Autoconfiguration : enabled
Setting board to : sitl
Using toolchain : native
Checking for ‘g++’ (C++ compiler) : /usr/bin/g++
Checking for ‘gcc’ (C compiler) : /usr/bin/gcc
Checking for c flags ‘-MMD’ : yes
Checking for cxx flags ‘-MMD’ : yes
Checking for need to link with librt : not necessary
Checking for feenableexcept : no
Checking for library sfml-graphics : not found
Missing SFML libraries - please install libsfml-dev
(complete log in /home/marc/ardupilot/build/config.log)
SIM_VEHICLE: (Configure waf) exited with code 256
SIM_VEHICLE: Killing tasks

Posts: 1

Participants: 1

Read full topic

SITL and Mavproxy: Cannot pass a build target in sim_vehicle.py

$
0
0

@Marc_Dornan wrote:

I am trying to pass a build target (-b omnibusF4pro) in a sim_vehicle.py call in cygwin64 and this is the error I am getting. I do successfully compile for this target using Eclipse and Cygwin64. Anyone got any pointers?

marc@DESKTOP-M2HFP4E ~
$ sim_vehicle.py -v ArduPlane -f plane-vtail -b omnibusF4pro -l 42.221875,-87.907888,0,90 --console --map
SIM_VEHICLE: Start
SIM_VEHICLE: Killing tasks
SIM_VEHICLE: Starting up at 42.221875,-87.907888,0,90
SIM_VEHICLE: WAF build
SIM_VEHICLE: Configure waf
SIM_VEHICLE: “/home/marc/ardupilot/modules/waf/waf-light” “configure” “–board” “sitl”
Setting top to : /home/marc/ardupilot
Setting out to : /home/marc/ardupilot/build
Autoconfiguration : enabled
Setting board to : sitl
Using toolchain : native
Checking for ‘g++’ (C++ compiler) : /usr/bin/g++
Checking for ‘gcc’ (C compiler) : /usr/bin/gcc
Checking for c flags ‘-MMD’ : yes
Checking for cxx flags ‘-MMD’ : yes
Checking for need to link with librt : not necessary
Checking for feenableexcept : no
Checking for HAVE_CMATH_ISFINITE : yes
Checking for HAVE_CMATH_ISINF : yes
Checking for HAVE_CMATH_ISNAN : yes
Checking for NEED_CMATH_ISFINITE_STD_NAMESPACE : yes
Checking for NEED_CMATH_ISINF_STD_NAMESPACE : yes
Checking for NEED_CMATH_ISNAN_STD_NAMESPACE : yes
Checking for header endian.h : yes
Checking for header byteswap.h : yes
Checking for HAVE_MEMRCHR : no
Checking for program ‘python’ : /usr/bin/python
Checking for python version >= 2.7.0 : 2.7.16
Checking for program ‘python’ : /usr/bin/python
Checking for python version >= 2.7.0 : 2.7.16
Source is git repository : yes
Update submodules : yes
Checking for program ‘git’ : /usr/bin/git
Checking for program ‘size’ : /usr/bin/size
Benchmarks : disabled
Unit tests : enabled
Scripting : enabled
Scripting runtime checks : enabled
Checking for program ‘rsync’ : /usr/bin/rsync
‘configure’ finished successfully (6.278s)
SIM_VEHICLE: Building
SIM_VEHICLE: “/home/marc/ardupilot/modules/waf/waf-light” “build” “–target” “omnibusF4pro”
Waf: Entering directory /home/marc/ardupilot/build/sitl' Embedding file sandbox.lua:libraries/AP_Scripting/scripts/sandbox.lua Waf: Leaving directory /home/marc/ardupilot/build/sitl’
Could not find a task generator for the name ‘omnibusF4pro’
SIM_VEHICLE: Build failed
SIM_VEHICLE: Killing tasks

Posts: 1

Participants: 1

Read full topic

Companion Computer Precision Landing Oscillations

$
0
0

@Zak5254 wrote:

Hey everyone,

So I’m currently setting up a companion computer precision landing setup using fiducial markers and I’m getting mixed success and I’m wondering if anyone can help me make that into a non-mixed success.

The basic description of what I’m trying to do is land a drone from an altitude of roughly 50ft using a large fiducial marker (~1m x 1m.) The marker is large enough that the camera is able to see the tag at these high altitudes and give accurate positioning data.

I’ll start with the success… It works! but only in the last 10-15 feet of the landing. The non successful part happens at above 10-15 feet. You can observe wild oscillations when the drone (Tarot x6) sees the marker and is trying to position itself above the marker.

I have scrubbed through all of my code to assure that I am passing all of the data the firmware is expecting correctly and in the correct axis frames. I am sending the firmware angle.x angle.y and distance (magnitude of xyz to the tag.)

My initial thoughts at this point is that this could be a tuning problem but honestly I’m not positive at this point and would like some input from the experts (that’s you guys.)

Any thoughts would be greatly appreciated. Params are attachedTarot_PrecLand.param (14.9 KB)
Logs: https://www.dropbox.com/s/iu0ch7gxnnchwx0/2020-05-20%2015-32-16.bin?dl=0

Posts: 1

Participants: 1

Read full topic

Adding a duplicate Auto Mode

$
0
0

@Alex_Kim wrote:

Hello all,

Hope everyone is doing well. I just have a question on whether creating a duplicate of Auto Mode is possible in ArduCopter. I am trying to implement a new autopilot mode using mission waypoints from the GCS.

When I created a new_auto_mode, which is essentially a duplicate of Auto Mode, launching SITL returns “Mission must be singleton” panic error and exits.

I would like to use the same mission waypoints from the GCS and use that info but in new_auto_mode instead of the existing Auto Mode.

Thank you in advance for your help.

Regards,

AK

Posts: 3

Participants: 2

Read full topic

Uncommon motor behavior changing mode

$
0
0

@juvinski wrote:

Hi,

I upgraded my vtol from arduplane 3.9 to V4.1.0dev and after reconfiguring everything I found this uncommon behavior.
After arming in FBWA or QSTABILIZE everything os working as expected, but when I change to manual mode the tilt motors are upforwarding but just the left motor are ok, the right motor is just off as you can see on this video: https://youtu.be/P9zjcS-c47Q
With arduplane 3.9 evevething was working fine.

Thanks for help.

Posts: 1

Participants: 1

Read full topic

Copter 4 autotune problem

$
0
0

@hosein_gh wrote:

i’m stuck on autotune with my new build
i completed tuning process instruction and copter was sable enough to run autotune
but after autotune copter is completely unstable , i faced bad takeoff and wobble after applying roll and pitch

config :
CUAV Pixhawk 2.4.6 with copter 4.0.3 firmware
T-motor AirGear 450 with 1045 propellers
Emax BLHeli oneshot 125 20A
F450 frame
copter weight is 1600g

autotune log
bad takeoff and wobbling log
another wobbling log

@Leonardthall

Posts: 2

Participants: 2

Read full topic


Taranis Inputs/Mixer and Mission Planner settings [Solved]

$
0
0

@UAVSkies wrote:

@smartdave @dkemxr @Marc_Dornan

I am sort of new to Open Tx and Taranis and trying to get a better understanding on few things how they work together.

The above diagram and setup works, however a number of things are very confusing.

  1. Main-out Pin 1 has left servo connected to it.
  2. Main-out Pin 2 has right servo connected to it.
  3. Main-out Pin 4 has ESC for thrust motor.

No matter what you do, if I want Thrust motor to be connected to main Out -3, FC will not allow you to do that. Is it hard coded in the Plane firmware that one must use main Out 4?

What also confuses me is the servo output section inside mission planner.

How it correlates to what you set inside Taranis radio inputs and Mixer? “Or” the servo out section in MP is actually a mixer itself and you don’t need to do any mixing inside the Taranis radio?

if that is the case why in Ardupilot documentation is says, for wing plane you must use Pins 1,2, 4 and set;

SERVO1_FUNCTION = 77
SERVO2_FUNCTION = 78
SERVO3_FUNCTION =70

But the motor only works off Main out Pin 4, so then why the documentation is suggesting using SERVO3_FUNCTION for motor?

Very confusing. Does anyone update these documentation with easy to follow instructions…

Posts: 28

Participants: 4

Read full topic

Plane 4.0 关于光流支持qloit

$
0
0

@sheyao wrote:

Whether to support CXOF optical flow in vlto mode, I want to use optical flow hover in QLOIT mode

I have a rangefinder
RNGFND1_TYPE = 16 VL53L0X

Posts: 1

Participants: 1

Read full topic

Airmode not keeping quad stable for flips/rolls w/throttle low

$
0
0

@BillyLaniakea wrote:

hello! I am having an issue with Acro mode on a 5 inch quadcopter running Arducopter. I have arm/disarm set to a switch so airmode should be enabled, however when I am flying in Acro mode and pitch or roll over 90 degrees or fully inverted (flip or roll) AND I drop the throttle all the way down momentarily, the quad looses all of its authority and starts flopping around uncontrollably until throttle goes back up to around mid stick. I am used to airmode in Betaflight that keeps the quad controllable and stable at any attitude even with the throttle completely lowered. does airmode in Arducopter work the same or is this normal?

Posts: 3

Participants: 2

Read full topic

Problem with tandem yaw tunning

$
0
0

@moluav wrote:

i am tunning a tandem helicopter.Now it is good to fly in the stabilize mode. The roll and pitch flight is also good in the alihod mode and loiter mode, but the problem of yaw adjustment.
in althold mode and loiter mode,When using the joystick to adjust the yaw, the pitch of the drone will shake up and down.
here is some pic of my log.



These two pictures show that my aircraft follows the pitch and roll attitudes. The pitch feels okay to follow, and the roll following effect does not feel very good.I think this may have something to do with the adjustment of my VFF parameters. Roll RATE.RDES is smaller than RATE.R. I think the VFF of the ROLL axis should be reduced. There is no adjustment yet.


The above picture shows the change of PITCH and ROLL when the aircraft is hovering in loiter mode. It seems that the change of one or two degrees has been adjusted. I don’t know if this is normal.

The picture above shows the curve of the yaw adjustment when the aircraft is in the loiter.

This picture can show that when using the joystick to adjust the row direction, the pitch is shaking up and down.

The way to adjust the yaw is. Swipe left or right and return to center.This can be seen from the light green curve of the figure.


The picture above is related parameters.

can anybody give me some tunning points?
Thanks in advance.

Posts: 1

Participants: 1

Read full topic

Pixhawk Cube changing GPS altitude to barometer altitude without indication

$
0
0

@Darad wrote:

Hi all,

I’m having challenges with Pixhawk altitude sensor. I have set GPS altitude as primary altitude sensor. reason to that is that I’m flying quite long flights, like 2 hours and barometric altitude is not reliable because air pressure can change during the flight time.

The problem is that sometimes Pixhawk changes itself primary altitude sensor from GPS to barometer and the reason might be that there is bad GPS signal for some reason. Anyway, I dont know this primary altitude sensor change at all and I cant see any indication about it from the Missionplanner screen or parameters or anywhere. So plane is flying smoothly and I am happy. Well… then sometimes plane suddenly crashes in the trees even the altitude seems to be high enough in the MP screen. And then I’m saying wtf … no, no not again ???

I have few MP logs where this situation is happening, so if anyone is interested to help with this issue.

Currently I’m using only barometric altitude and during the flight I’m monitoring the air pressure changes and update the altitude offset based on that. This altitude offset updating could be also autonomous but I’m doing it manually so far.

Posts: 1

Participants: 1

Read full topic

Arducopter 3.6.12 Hexa swings up on landing

$
0
0

@webmotions wrote:

attached is a log of a flight that was mostly normal. But when the Copter was in a descent (PosHold) it started to swing up for no apparent reason and could only be stabilized by changing the mode to AltHold. I see in the logfile at the appropriate place big differences between DesRoll and Roll, but no error messages and can’t explain this to me. Maybe someone of you can have a look at it, thank you very much!

Hard- and Software:
CubeBlack with Copter 3.6.12
SF11 Lidar
Slamtec A3 Lidar (not activ for communication reasons)
Tigermotor MN701 with 24" Folding-Props and Alpha ESCs

Posts: 1

Participants: 1

Read full topic

Inverting WP lists, also combined with SPIRAL patterns

$
0
0

@RobMor wrote:

Hello,

is it possible to flip (invert) the sequence of an existing waypoint file, as those geenated by Auto WP >> Survey (Grid) ? So that the first WP becomes the last, and the last the first ?

It would be useful when used in combination with SPIRAL type of patterns, so that given a fixed perimeter, one could choose if to navigate inside-out or outside-in the spiral.
Actually, there are also two more options, i.e. clockwise or counterclockwise, but I’m not sure the planner supports this choices…

Any advice ?

Thanks

Posts: 1

Participants: 1

Read full topic


Rover 4.0 upload firmware on Cube failed

$
0
0

@fabono wrote:

Hi there,

I am new here so sorry if I ask a trivial question. Actually I am trying to upload the rover 4.0 firmware on the a black Cube and, it connects, erase, then upload the firmware. But what happen is, when I got a panel telling me to click OK when I heard a tune, the cube switch off. Then when I replugged the USB on the computer, the black cube is blinking orange - which is always a bad sign…
Can you tell me how to do from there?
Thank you

Posts: 1

Participants: 1

Read full topic

How to Set RSSI in Copter V4.0.3

$
0
0

@rdanielk wrote:

There is so many RSSI parameters in the full parameters list
https://ardupilot.org/copter/docs/parameters-Copter-stable-V4.0.3.html?highlight=rssi
But I cannot see it in Mission Planner full parameters list

Is it only me or it was removed? the only one that shows for me is RSSI_TYPE

I want to setup the rssi using the RSSI function in my Taranis radio… I just updated from version 3.5 where it was possible…
Any help will be much appreciated

Posts: 1

Participants: 1

Read full topic

Tilt-rotor VTOL Bicopter

$
0
0

@BorjaB wrote:

Hi i’m trying to build a bicopter tiltrotor for a fixed wing, i built this simple table with 2 tilt motors for test,

but i’m confused about the configuration, my goal is to get something like this

  • Vtol take off with 2 motors tilting.
  • Transition to plane .
  • Flight like a plane.
  • Transition back to vtol.
  • Vtol land with 2 motors tilting.

I’ve been looking at many topics, but I don’t get anything useful.
Can someone help me?
Thank you very much in advance.

Posts: 1

Participants: 1

Read full topic

THR_DZ doesn't work in Loiter

$
0
0

@hassani wrote:

Hi,
I have large octa, I set THR_DZ and it works correctly on PosHold and AltHold, but it doesn’t work in Loiter mode. I set the throttle linear.

Thanks for your answers.

Posts: 1

Participants: 1

Read full topic

Cygwin64 build fails under Windows10

$
0
0

@qcskltj wrote:

I have strictly followed the steps of Docs on ‘Downloading the code/using Git’ and ‘Building the code – Setting up the waf Build Environment on Windows using Cygwin’. The configure build also succeed. However, ./waf copter fails. I don’t know where the problem is. Below is the build information of the Cygwin64 Terminal.

$ ./waf configure --board fmuv3
Setting top to : /cygdrive/c/ardupilot
Setting out to : /cygdrive/c/ardupilot/build
Autoconfiguration : enabled
Setting board to : fmuv3
Using toolchain : arm-none-eabi
Checking for ‘g++’ (C++ compiler) : /cygdrive/c/Program Files (x86)/GNU Tools ARM Embedded/6 2017-q2-update/bin/arm-none-eabi-g++
Checking for ‘gcc’ (C compiler) : /cygdrive/c/Program Files (x86)/GNU Tools ARM Embedded/6 2017-q2-update/bin/arm-none-eabi-gcc
Checking for c flags ‘-MMD’ : yes
Checking for cxx flags ‘-MMD’ : yes
Checking for program ‘make’ : /usr/bin/make
Checking for program ‘arm-none-eabi-objcopy’ : /cygdrive/c/Program Files (x86)/GNU Tools ARM Embedded/6 2017-q2-update/bin/arm-none-eabi-objcopy
Setup for MCU STM32F427xx
Writing hwdef setup in /cygdrive/c/ardupilot/build/fmuv3/hwdef.h
Writing DMA map
Generating ldscript.ld
No default parameter file found
Checking for env.py
env set HAL_WITH_UAVCAN=1
env set PROCESS_STACK=0x2000
env set MAIN_STACK=0x400
env set IOMCU_FW=0
env set PERIPH_FW=0
env set BOARD_FLASH_SIZE=2048
env set CPU_FLAGS=[’-mcpu=cortex-m4’, ‘-mfpu=fpv4-sp-d16’, ‘-mfloat-abi=hard’, ‘-DARM_MATH_CM4’, ‘-u_printf_float’]
env set CORTEX=cortex-m4
env set APJ_BOARD_ID=9
env set APJ_BOARD_TYPE=STM32F427xx
env set USBID=0x1209/0x5741
env set FLASH_RESERVE_START_KB=16
env set CHIBIOS_BUILD_FLAGS=USE_FATFS=yes CHIBIOS_STARTUP_MK=os/common/startup/ARMCMx/compilers/GCC/mk/startup_stm32f4xx.mk CHIBIOS_PLATFORM_MK=os/hal/ports/STM32/STM32F4xx/platform.mk MCU=cortex-m4 ENV_UDEFS=-DCHPRINTF_USE_FLOAT=1
Enabling ChibiOS asserts : no
Checking for intelhex module: : disabled
Checking for HAVE_CMATH_ISFINITE : no
Checking for HAVE_CMATH_ISINF : no
Checking for HAVE_CMATH_ISNAN : no
Checking for NEED_CMATH_ISFINITE_STD_NAMESPACE : no
Checking for NEED_CMATH_ISINF_STD_NAMESPACE : no
Checking for NEED_CMATH_ISNAN_STD_NAMESPACE : no
Checking for header endian.h : not found
Checking for header byteswap.h : not found
Checking for HAVE_MEMRCHR : no
Checking for program ‘python’ : /usr/bin/python
Checking for python version >= 2.7.0 : 3.6.9
Checking for program ‘python’ : /usr/bin/python
Checking for python version >= 2.7.0 : 3.6.9
Source is git repository : yes
Update submodules : yes
Checking for program ‘git’ : /usr/bin/git
Gtest : STM32 boards currently don’t support compiling gtest
Checking for program ‘arm-none-eabi-size’ : /cygdrive/c/Program Files (x86)/GNU Tools ARM Embedded/6 2017-q2-update/bin/arm-none-eabi-size
Benchmarks : disabled
Unit tests : disabled
Scripting : enabled
Scripting runtime checks : enabled
Checking for program ‘rsync’ : /usr/bin/rsync
‘configure’ finished successfully (2.526s)

$ ./waf copter
Waf: Entering directory `/cygdrive/c/ardupilot/build/fmuv3’
Checking for env.py
env added HAL_WITH_UAVCAN=1
env added PROCESS_STACK=0x2000
env added MAIN_STACK=0x400
env added IOMCU_FW=0
env added PERIPH_FW=0
env added BOARD_FLASH_SIZE=2048
env appended CPU_FLAGS=[’-mcpu=cortex-m4’, ‘-mfpu=fpv4-sp-d16’, ‘-mfloat-abi=hard’, ‘-DARM_MATH_CM4’, ‘-u_printf_float’]
env added CORTEX=cortex-m4
env added APJ_BOARD_ID=9
env added APJ_BOARD_TYPE=STM32F427xx
env added USBID=0x1209/0x5741
env added FLASH_RESERVE_START_KB=16
env added CHIBIOS_BUILD_FLAGS=USE_FATFS=yes CHIBIOS_STARTUP_MK=os/common/startup/ARMCMx/compilers/GCC/mk/startup_stm32f4xx.mk CHIBIOS_PLATFORM_MK=os/hal/ports/STM32/STM32F4xx/platform.mk MCU=cortex-m4 ENV_UDEFS=-DCHPRINTF_USE_FLOAT=1
Embedding file bootloader.bin:/cygdrive/c/ardupilot/Tools/bootloaders/fmuv3_bl.bin
Embedding file hwdef.dat:/cygdrive/c/ardupilot/build/fmuv3/hw.dat
Embedding file io_firmware.bin:Tools/IO_Firmware/iofirmware_lowpolh.bin
[ 3/10] Creating build/fmuv3/hwdef.h
[ 4/10] Creating build/fmuv3/modules/ChibiOS/include_dirs
[ 5/10] Compiling libraries/AP_Scripting/generator/src/main.c
[ 6/10] Processing modules/mavlink/message_definitions/v1.0/ardupilotmega.xml
[ 7/10] Processing uavcangen: libraries/AP_UAVCAN/dsdl/ardupilot libraries/AP_UAVCAN/dsdl/com modules/uavcan/dsdl/uavcan
[ 8/10] Creating build/fmuv3/ap_version.h
Validation skipped for /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/ardupilotmega.xml.
Parsing /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/ardupilotmega.xml
MAV_CMD
MAV_CMD_DO_GRIPPER
MAV_CMD_DO_AUTOTUNE_ENABLE
MAV_CMD_DO_SET_RESUME_REPEAT_DIST
MAV_CMD_NAV_ALTITUDE_WAIT
MAV_CMD_POWER_OFF_INITIATED
MAV_CMD_SOLO_BTN_FLY_CLICK
MAV_CMD_SOLO_BTN_FLY_HOLD
MAV_CMD_SOLO_BTN_PAUSE_CLICK
MAV_CMD_FIXED_MAG_CAL
MAV_CMD_FIXED_MAG_CAL_FIELD
MAV_CMD_FIXED_MAG_CAL_YAW
MAV_CMD_DO_START_MAG_CAL
MAV_CMD_DO_ACCEPT_MAG_CAL
MAV_CMD_DO_CANCEL_MAG_CAL
MAV_CMD_ACCELCAL_VEHICLE_POS
MAV_CMD_DO_SEND_BANNER
MAV_CMD_SET_FACTORY_TEST_MODE
MAV_CMD_GIMBAL_RESET
MAV_CMD_GIMBAL_AXIS_CALIBRATION_STATUS
MAV_CMD_GIMBAL_REQUEST_AXIS_CALIBRATION
MAV_CMD_GIMBAL_FULL_RESET
MAV_CMD_DO_WINCH
MAV_CMD_FLASH_BOOTLOADER
MAV_CMD_BATTERY_RESET
MAV_CMD_DEBUG_TRAP
MAV_CMD_SCRIPTING
MAV_CMD_GUIDED_CHANGE_SPEED
MAV_CMD_GUIDED_CHANGE_ALTITUDE
MAV_CMD_GUIDED_CHANGE_HEADING
Note: message DATA64 is longer than 64 bytes long (74 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message DATA96 is longer than 64 bytes long (106 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message REMOTE_LOG_DATA_BLOCK is longer than 64 bytes long (214 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message EFI_STATUS is longer than 64 bytes long (73 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message DEVICE_OP_READ_REPLY is longer than 64 bytes long (143 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message DEVICE_OP_WRITE is longer than 64 bytes long (187 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Validation skipped for /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/common.xml.
Parsing /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/common.xml
MAV_CMD
MAV_CMD_NAV_WAYPOINT
MAV_CMD_NAV_LOITER_UNLIM
MAV_CMD_NAV_LOITER_TURNS
MAV_CMD_NAV_LOITER_TIME
MAV_CMD_NAV_RETURN_TO_LAUNCH
MAV_CMD_NAV_LAND
MAV_CMD_NAV_TAKEOFF
MAV_CMD_NAV_LAND_LOCAL
MAV_CMD_NAV_TAKEOFF_LOCAL
MAV_CMD_NAV_FOLLOW
MAV_CMD_NAV_CONTINUE_AND_CHANGE_ALT
MAV_CMD_NAV_LOITER_TO_ALT
MAV_CMD_DO_FOLLOW
MAV_CMD_DO_FOLLOW_REPOSITION
MAV_CMD_NAV_ROI
MAV_CMD_NAV_PATHPLANNING
MAV_CMD_NAV_SPLINE_WAYPOINT
MAV_CMD_NAV_VTOL_TAKEOFF
MAV_CMD_NAV_VTOL_LAND
MAV_CMD_NAV_GUIDED_ENABLE
MAV_CMD_NAV_DELAY
MAV_CMD_NAV_PAYLOAD_PLACE
MAV_CMD_NAV_LAST
MAV_CMD_CONDITION_DELAY
MAV_CMD_CONDITION_CHANGE_ALT
MAV_CMD_CONDITION_DISTANCE
MAV_CMD_CONDITION_YAW
MAV_CMD_CONDITION_LAST
MAV_CMD_DO_SET_MODE
MAV_CMD_DO_JUMP
MAV_CMD_DO_CHANGE_SPEED
MAV_CMD_DO_SET_HOME
MAV_CMD_DO_SET_PARAMETER
MAV_CMD_DO_SET_RELAY
MAV_CMD_DO_REPEAT_RELAY
MAV_CMD_DO_SET_SERVO
MAV_CMD_DO_REPEAT_SERVO
MAV_CMD_DO_FLIGHTTERMINATION
MAV_CMD_DO_CHANGE_ALTITUDE
MAV_CMD_DO_LAND_START
MAV_CMD_DO_RALLY_LAND
MAV_CMD_DO_GO_AROUND
MAV_CMD_DO_REPOSITION
MAV_CMD_DO_PAUSE_CONTINUE
MAV_CMD_DO_SET_REVERSE
MAV_CMD_DO_SET_ROI_LOCATION
MAV_CMD_DO_SET_ROI_WPNEXT_OFFSET
MAV_CMD_DO_SET_ROI_NONE
MAV_CMD_DO_SET_ROI_SYSID
MAV_CMD_DO_CONTROL_VIDEO
MAV_CMD_DO_SET_ROI
MAV_CMD_DO_DIGICAM_CONFIGURE
MAV_CMD_DO_DIGICAM_CONTROL
MAV_CMD_DO_MOUNT_CONFIGURE
MAV_CMD_DO_MOUNT_CONTROL
MAV_CMD_DO_SET_CAM_TRIGG_DIST
MAV_CMD_DO_FENCE_ENABLE
MAV_CMD_DO_PARACHUTE
MAV_CMD_DO_MOTOR_TEST
MAV_CMD_DO_INVERTED_FLIGHT
MAV_CMD_NAV_SET_YAW_SPEED
MAV_CMD_DO_SET_CAM_TRIGG_INTERVAL
MAV_CMD_DO_MOUNT_CONTROL_QUAT
MAV_CMD_DO_GUIDED_MASTER
MAV_CMD_DO_GUIDED_LIMITS
MAV_CMD_DO_ENGINE_CONTROL
MAV_CMD_DO_SET_MISSION_CURRENT
MAV_CMD_DO_LAST
MAV_CMD_PREFLIGHT_CALIBRATION
MAV_CMD_PREFLIGHT_SET_SENSOR_OFFSETS
MAV_CMD_PREFLIGHT_UAVCAN
MAV_CMD_PREFLIGHT_STORAGE
MAV_CMD_PREFLIGHT_REBOOT_SHUTDOWN
MAV_CMD_OVERRIDE_GOTO
MAV_CMD_MISSION_START
MAV_CMD_COMPONENT_ARM_DISARM
MAV_CMD_GET_HOME_POSITION
MAV_CMD_START_RX_PAIR
MAV_CMD_GET_MESSAGE_INTERVAL
MAV_CMD_SET_MESSAGE_INTERVAL
MAV_CMD_REQUEST_MESSAGE
MAV_CMD_REQUEST_AUTOPILOT_CAPABILITIES
MAV_CMD_REQUEST_CAMERA_INFORMATION
MAV_CMD_REQUEST_CAMERA_SETTINGS
MAV_CMD_REQUEST_STORAGE_INFORMATION
MAV_CMD_STORAGE_FORMAT
MAV_CMD_REQUEST_CAMERA_CAPTURE_STATUS
MAV_CMD_REQUEST_FLIGHT_INFORMATION
MAV_CMD_RESET_CAMERA_SETTINGS
MAV_CMD_SET_CAMERA_MODE
MAV_CMD_JUMP_TAG
MAV_CMD_DO_JUMP_TAG
MAV_CMD_IMAGE_START_CAPTURE
MAV_CMD_IMAGE_STOP_CAPTURE
MAV_CMD_DO_TRIGGER_CONTROL
MAV_CMD_VIDEO_START_CAPTURE
MAV_CMD_VIDEO_STOP_CAPTURE
MAV_CMD_LOGGING_START
MAV_CMD_LOGGING_STOP
MAV_CMD_AIRFRAME_CONFIGURATION
MAV_CMD_CONTROL_HIGH_LATENCY
MAV_CMD_PANORAMA_CREATE
MAV_CMD_DO_VTOL_TRANSITION
MAV_CMD_ARM_AUTHORIZATION_REQUEST
MAV_CMD_SET_GUIDED_SUBMODE_STANDARD
MAV_CMD_SET_GUIDED_SUBMODE_CIRCLE
MAV_CMD_NAV_FENCE_RETURN_POINT
MAV_CMD_NAV_FENCE_POLYGON_VERTEX_INCLUSION
MAV_CMD_NAV_FENCE_POLYGON_VERTEX_EXCLUSION
MAV_CMD_NAV_FENCE_CIRCLE_INCLUSION
MAV_CMD_NAV_FENCE_CIRCLE_EXCLUSION
MAV_CMD_NAV_RALLY_POINT
MAV_CMD_UAVCAN_GET_NODE_INFO
MAV_CMD_PAYLOAD_PREPARE_DEPLOY
MAV_CMD_PAYLOAD_CONTROL_DEPLOY
MAV_CMD_WAYPOINT_USER_1
MAV_CMD_WAYPOINT_USER_2
MAV_CMD_WAYPOINT_USER_3
MAV_CMD_WAYPOINT_USER_4
MAV_CMD_WAYPOINT_USER_5
MAV_CMD_SPATIAL_USER_1
MAV_CMD_SPATIAL_USER_2
MAV_CMD_SPATIAL_USER_3
MAV_CMD_SPATIAL_USER_4
MAV_CMD_SPATIAL_USER_5
MAV_CMD_USER_1
MAV_CMD_USER_2
MAV_CMD_USER_3
MAV_CMD_USER_4
MAV_CMD_USER_5
MAV_CMD_ACK
MAV_CMD_ACK_OK
MAV_CMD_ACK_ERR_FAIL
MAV_CMD_ACK_ERR_ACCESS_DENIED
MAV_CMD_ACK_ERR_NOT_SUPPORTED
MAV_CMD_ACK_ERR_COORDINATE_FRAME_NOT_SUPPORTED
MAV_CMD_ACK_ERR_COORDINATES_OUT_OF_RANGE
MAV_CMD_ACK_ERR_X_LAT_OUT_OF_RANGE
MAV_CMD_ACK_ERR_Y_LON_OUT_OF_RANGE
MAV_CMD_ACK_ERR_Z_ALT_OUT_OF_RANGE
Note: message GPS_STATUS is longer than 64 bytes long (109 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message ATTITUDE_QUATERNION_COV is longer than 64 bytes long (80 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message GLOBAL_POSITION_INT_COV is longer than 64 bytes long (189 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message LOCAL_POSITION_NED_COV is longer than 64 bytes long (233 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message HIL_ACTUATOR_CONTROLS is longer than 64 bytes long (89 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message GLOBAL_VISION_POSITION_ESTIMATE is longer than 64 bytes long (125 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message VISION_POSITION_ESTIMATE is longer than 64 bytes long (125 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message VISION_SPEED_ESTIMATE is longer than 64 bytes long (65 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message VICON_POSITION_ESTIMATE is longer than 64 bytes long (124 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message HIGHRES_IMU is longer than 64 bytes long (71 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message HIL_SENSOR is longer than 64 bytes long (72 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message SIM_STATE is longer than 64 bytes long (92 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message FILE_TRANSFER_PROTOCOL is longer than 64 bytes long (262 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message HIL_STATE_QUATERNION is longer than 64 bytes long (72 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message LOG_DATA is longer than 64 bytes long (105 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message GPS_INJECT_DATA is longer than 64 bytes long (121 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message SERIAL_CONTROL is longer than 64 bytes long (87 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message ENCAPSULATED_DATA is longer than 64 bytes long (263 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message ATT_POS_MOCAP is longer than 64 bytes long (128 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message RESOURCE_REQUEST is longer than 64 bytes long (251 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message FOLLOW_TARGET is longer than 64 bytes long (101 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message CONTROL_SYSTEM_STATE is longer than 64 bytes long (108 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message AUTOPILOT_VERSION is longer than 64 bytes long (86 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message LANDING_TARGET is longer than 64 bytes long (68 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message GPS_INPUT is longer than 64 bytes long (73 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message GPS_RTCM_DATA is longer than 64 bytes long (190 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message HOME_POSITION is longer than 64 bytes long (68 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message SET_HOME_POSITION is longer than 64 bytes long (69 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message V2_EXTENSION is longer than 64 bytes long (262 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message PLAY_TUNE is longer than 64 bytes long (240 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Setup for MCU STM32F427xx
Writing hwdef setup in /cygdrive/c/ardupilot/build/fmuv3/hwdef.h
Writing DMA map
Generating ldscript.ld
No default parameter file found
Note: message CAMERA_INFORMATION is longer than 64 bytes long (243 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.

Note: message CAMERA_IMAGE_CAPTURED is longer than 64 bytes long (263 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message LOGGING_DATA is longer than 64 bytes long (263 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message LOGGING_DATA_ACKED is longer than 64 bytes long (263 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message WIFI_CONFIG_AP is longer than 64 bytes long (104 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message AIS_VESSEL is longer than 64 bytes long (66 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message UAVCAN_NODE_INFO is longer than 64 bytes long (124 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message OBSTACLE_DISTANCE is longer than 64 bytes long (175 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message ODOMETRY is longer than 64 bytes long (240 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message DEBUG_FLOAT_ARRAY is longer than 64 bytes long (260 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message STATUSTEXT_LONG is longer than 64 bytes long (263 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message ACTUATOR_OUTPUT_STATUS is longer than 64 bytes long (148 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Note: message WHEEL_DISTANCE is longer than 64 bytes long (145 bytes), which can cause fragmentation since many radio modems use 64 bytes as maximum air transfer unit.
Validation skipped for /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/uAvionix.xml.
Parsing /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/uAvionix.xml
Validation skipped for /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/icarous.xml.
Parsing /cygdrive/c/ardupilot/modules/mavlink/message_definitions/v1.0/icarous.xml
Merged enum MAV_CMD
Found 226 MAVLink message types in 4 XML files
Generating C implementation in directory /cygdrive/c/ardupilot/build/fmuv3/libraries/GCS_MAVLink/include/mavlink/v2.0/ardupilotmega
Generating C implementation in directory /cygdrive/c/ardupilot/build/fmuv3/libraries/GCS_MAVLink/include/mavlink/v2.0/common
[ 9/10] Processing /cygdrive/c/ardupilot/build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.cpp,/cygdrive/c/ardupilot/build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.h: libraries/AP_Scripting/generator/description/bindings.desc build/fmuv3/gen-bindings -> build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.cpp build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.h
Error (line 2): Expected a keyword, got:

Generating C implementation in directory /cygdrive/c/ardupilot/build/fmuv3/libraries/GCS_MAVLink/include/mavlink/v2.0/uAvionix
Generating C implementation in directory /cygdrive/c/ardupilot/build/fmuv3/libraries/GCS_MAVLink/include/mavlink/v2.0/icarous
Copying fixed headers for protocol 2.0 to /cygdrive/c/ardupilot/build/fmuv3/libraries/GCS_MAVLink/include/mavlink/v2.0
Waf: Leaving directory `/cygdrive/c/ardupilot/build/fmuv3’
Build failed
-> task in ‘/cygdrive/c/ardupilot/build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.cpp,/cygdrive/c/ardupilot/build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.h’ failed (exit status 3):
{task 123145247031704: /cygdrive/c/ardupilot/build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.cpp,/cygdrive/c/ardupilot/build/fmuv3/libraries/AP_Scripting/lua_generated_bindings.h bindings.desc,gen-bindings -> lua_generated_bindings.cpp,lua_generated_bindings.h}
(run with -v to display more information)

Posts: 1

Participants: 1

Read full topic

Viewing all 46064 articles
Browse latest View live


<script src="https://jsc.adskeeper.com/r/s/rssing.com.1596347.js" async> </script>