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

AC 3.6.9 Crash with IR-Lock and PLND_EST_TYPE enabled

$
0
0

@mtbsteve wrote:

After 2 years this defect was initially reported, it is still open with Arducopter 3.6.9 along with the IR-Lock sensor for precision landing.
When PLND_EST_TYPE is set to 1, the copter gets out of control and goes into a uncontrollable spiral when Precision Loiter is enabled once the IR beacon gets in sight. Unlike during Land mode where you can abort the spiraling by switching into another flight mode, disabling precision loiter does not bring back control.
As long as this defect has not been fixed, please do not enable the kalman filter and keep PLND_EST_TYPE set to 0.

Link to the issue and latest log:

Posts: 2

Participants: 2

Read full topic


Omnibus F4 nano V 6 Chibios plane has no Channel 4/Rudder PWM output

$
0
0

@rmbassembly wrote:

I am attempting to fly Chibios on a Small 4 channel powered glider using the Omnibus F4 nano V6.

Motor/servo 1-3 function as expected, Motor/Servo 4 doesn’t function as a servo for rudder. Servo 04 function is set to 21, On the servo tab rudder moves as expected. Just no output to a servo though.

I would like , but not really need stabilized rudder/yaw.
But I do want at least Pass through rudder which is easy enough if connected to the receiver directly.

I worry though that in stabilized flight modes that the flight controller will resist yaw and the yaw the rudder produces.

Ok this is what I found that may shed light.

All motor/servo outputs are Dshot and PWM capable. However, mixing Dshot and normal PWM operation for outputs is restricted into groups, ie. enabling Dshot for an output in a group requires that ALL outputs in that group be configured and used as Dshot, rather than PWM outputs. The output group that must be the same (PWM or Dshot, when configured as a normal servo/motor output) is: 1/2

Ok then how and where are the outputs configured?

Posts: 1

Participants: 1

Read full topic

V2450gps unhooking from gps

$
0
0

@Brad wrote:

I have a V2450gps and whenever I use the right joystick it disengages GPS and goes to the manual mode … I don’t recall this happening till just a couple weeks ago… I’ve had more than one of these and have decided that it is not the remote…

Posts: 2

Participants: 1

Read full topic

Multiple geo views-Need to change them

UWB fake gps(GPS_INPUT) can not hold position in loiter mode

$
0
0

@Huibean wrote:

Currently I am testing uwb system with ArduCopter, using sky viper fly indoor, I am inputing the pos value with mavlink (GPS_INPUT), params change with GPS_TYPE to 14(MAV), the uwb pos error is ±15cm and fresh rate is 5Hz, below is the mavlink input code with DroneKit

                            fix_type        = 4
                            sat_visible     = 20
                            epoch           = 315964782
                            cur             = datetime.datetime.utcnow()
                            ts              = cur - datetime.datetime(1970,1,1)
                            epoch_sec       = ts.total_seconds() - epoch
                            time_week       = epoch_sec / 604800.0
                            time_week_ms    = (epoch_sec % 604800) * 1000.0 + ts.microseconds*0.001

                            time_us = current
                            #  ignore_flags = mavutil.mavlink.GPS_INPUT_IGNORE_FLAG_VEL_HORIZ

                            ignore_flags = 0

                            res = get_location_metres(22.9514009, 113.8685862, pos[1], pos[0])
                            lat, lon = res[0], res[1]

                            alt_amsl = pos[2]

                            hdop = np.linalg.norm(np.array([eop[1], eop[0]]))
                            vdop = 2.0 

                            vn = vel[1]
                            ve = vel[0]
                            vd = vel[2]

                            spd_acc = 0.1
                            hor_acc = 0.1
                            vert_acc = 0.02


                            print(lat, lon, alt_amsl, vn, ve, vd)

                            msg = vehicle.message_factory.gps_input_encode(
                                                 time_us,       # time_boot_ms (not used)
                                                 0,                 # gps_id
                                                 ignore_flags,      # gps_flag
                                                 int(time_week_ms),
                                                 int(time_week),
                                                 fix_type, 
                                                 int(lat*1e7),
                                                 int(lon*1e7),
                                                 alt_amsl,  
                                                 hdop,
                                                 vdop,
                                                 vn,
                                                 ve,
                                                 vd,
                                                 spd_acc,
                                                 hor_acc,
                                                 vert_acc,
                                                 sat_visible)                # Satellites visible
                            
                            vehicle.send_mavlink(msg)

The problem is when I take off the drone in ALT_HOLD, the switch to loiter mode, the drone just fly away in one direction, which value should I look after in data flash log to figure out what’s wrong
dataflash log is here https://drive.google.com/open?id=1-TVg_3DwVpq1Z2DHzt9YvCD3P_PxmC4k
params is here https://drive.google.com/open?id=1myIlEHI8MG23_qE1BoSvtzp3GO44jJl4

Posts: 1

Participants: 1

Read full topic

How to display custom data on HUD

$
0
0

@11119 wrote:

I hope to display my Pixhawk backhaul custom information on Hud. What should i do?
Thanks.
rain

Posts: 1

Participants: 1

Read full topic

Ardurover on Kakute F4 v2 Telemetrie problems

$
0
0

@OldRaven wrote:

Hi,

I’m setting up a rover project with a kakute F4 V2, but I cannot get Telemetrie 1 to connect.

I’ve looked at the documentation of the latest firmware of the Kakute F4, and cannot really find good information about the pinout of the board.

I got the latest rover firmware loaded on the board.
The GPS is working and connected to pins R4 and T4
The RX Reciever is connected to R3

For telemetry I wanted to use an ESP8266 but could not get that to work, so got a 3DR v2 Sik now.
It’s connected to pins R6 and T6…

When I power the 3Dr air unit seperatly (so no connections to RX and TX) the unit connects to the groundunit.
When I connect R6 to TX on the air unit and T6 to RX on the airunit… the 3DR does not want to connect to the ground unit anymore (blinking blue light) and the red light is flashing indicating there is some serial cummunication flowing there.

I somehow have the feeling that I dont understand the pinouts of the Kakute F4’.
Can anyone confirm that pins R6 and T6 supposed the be Telemetry 1? and if this is supposed to be uart 6 or is it remapped to uart 1?

Posts: 1

Participants: 1

Read full topic

SRXL Spektrum AR8010T support, SRXL2

$
0
0

@Zadrob wrote:

Hello, I would like to ask if there would be support for different SRXL protocol by Spektrum.
I know they use different version of SRXL.
I have successfully tried AR7700 receiver connected via SRXL port - it works. SPM4649T also works, but I know, this is something different regarding SRXL implementation. When I try to connect AR8010T via SRXL port - i don´t have any input. I asked Spektrum support about SRXL protocol compatibility - and I paste what they replied:
There are checksum differences between the AR7700 and the AR8010T, yes.

You should reverse the bytes of the CRC to accommodate the revised endian of the AR8010T.

You may also want to consider integrating the new SRXL2 protocol, as this is what Spektrum will be using for future products. You can find information at our websites:

The first product supporting SRXL2 is the new SPM4650 drone receiver. This is a short-range telemetry version. A long-range telemetry version is in the works.

Engineers supporting the SRXL2 products will answer questions here:

https://www.rcgroups.com/forums/showthread.php?3351271

Any plans for supporting SRXL of AR8010T, or even SRXL2 in the future?

Thank you
Karel

Posts: 1

Participants: 1

Read full topic


How can i detect if " Motor emergency stop" switch was used from flight log

$
0
0

@zabbie wrote:

Hi, recently I have been facing problems in disarming of motors on landing, so for that, I have been using motor emergency stop function to stop the motor from spinning.

Out of 10 flight sequence of take-off and landing, 2 times motor won’t disarm automatically and for that, I used the kill switch to stop the motors so I want to check in which of the log the motor emergency stop switch was used?
Is there a way to check this from a log file?

Posts: 1

Participants: 1

Read full topic

Crashed Log Analysis

$
0
0

@AnnieME wrote:

Hi,
We faced with a crash of our quadcopter which uses a Cube (ArduCopter 3.6.9). These are the details:

  1. First flight was conducted for about 5 minutes, which went fine.
  2. Second flight was of 6 minutes. There was a communication failsafe issue, after which the vehicle showed erratic behaviour ultimately leading to a crash.
    The log is available here.
    AUTO Analysis showed this:

    We don’t understand some of the information given by the AUTO Analyser.
    Can anyone help us with this, so that we can identify the issue?

Posts: 1

Participants: 1

Read full topic

One question about mission planner:the fltmode

Camera switch on/off using relay pin

$
0
0

@Mallikarjun_SE wrote:

Hello guys,
I have been using 2 relays on cube autopilot for a while now. One to trigger shutter and one to switch camera on/off (DIY Multiport cable for Sony camera). The issue is, I’m able to use relay on my ch7 to switch on/off, but can’t use it as a mission command. I have tried using it as mission command but it only switches on the camera and doesn’t switch off. It’s vice versa sometimes and it’s inconsistent.
I really want feature on Mission planner & QGC to test relay pins on ground before launch of aircraft. Even the CLI is pulled out in latest arducopter versions.
Thank you!
Sorry for posting this topic both on cubepilot and ardupilot.
@tridge @tridge2 Any suggestions?

Posts: 1

Participants: 1

Read full topic

Flight time display

$
0
0

@JeanPhilippeHell wrote:

Hi,

I noticed that the flight time value in the widget is not reliable (to me).
In QGC 3.5.3 for Android the flight time is lost if we disconnect / reconnect the telemetry link.
It seems that the value is extrapolated from the last TAKEOFF or ARM event seen by QGC, not from the Ardupilot.

I’ve seen that there is a mavlink packet where we can request the takeoff timestamp from the autopilot but it is not recommended for use in stable releases :
https://mavlink.io/en/messages/common.html#FLIGHT_INFORMATION

Is there another way to have more reliable flight time ?

Thanks

Posts: 3

Participants: 2

Read full topic

Help in analyzing the log file,arducopter v 3.6.9 -copter crash

$
0
0

@Sudiptabir wrote:

This was second flight, copter crashes after take off within minutes, 2 17-07-2019 16-57-44.bin (313.3 KB)
here is the .bin file.
Pixhawk 2.4.8
Ublox M8N gps+compass, external compass used only
Compass mot test - interference - 11% at 60% throttle.

Posts: 7

Participants: 3

Read full topic

FPV Helicopter recommendations / tipps

$
0
0

@Pakman wrote:

I am looking for a helicopter kit, which has more endurance than my usual Electric Platforms (550 to 700 classes). Most probably this should be a nitro powered Helicopter…

It should also carry FPV equipment. I still have a Fatshark (standard first version) which could be reused.

if you could recommend:
RC Helicopter Kit ( maximum 2000 euro/USD)
FPV Equipment ( maximum 1000 euro/USD)
(preferably also available in europe)
– this would be fine.

Posts: 3

Participants: 2

Read full topic


Reading accelerometer data from Here2

$
0
0

@dannyslade wrote:

Hello,

I’m trying to read raw sensor data from the Here2, but the parameters in Mission Planner doesn’t appear to have readings from the Here2 sensor besides the mag.I tried reading it both through I2C and CAN. The Here2 is being read by a Pixhawk2 with the Cube from ProfiCNC and Hex. Anyone deal with reading the values from that sensor?

Thanks!
Dan

Posts: 1

Participants: 1

Read full topic

AC3.6.9 unable to calibrate ESC

$
0
0

@NiharikaPatel wrote:

@rmackay9,
We have an Iris+ with a pixhawk which had the AC3.2.1 firmware that we updated to AC3.6.9. On updating we found that we were unable to calibrate the ESC. We tried two methods, 1) Calibrating ESC from Mission Planner 2)All at one Calibration. When the throttle was up, and battery connected, it would go into the ESC calibration mode(red,blue,green LEDs ina cyclical pattern) and then we disconnected , reconnected and pressed the safety switch on. It would still be in the calibration mode but none of the calibration beeps would be heard. On pulling the throttle down nothing would happen either. The motors would not start either.

We went back to AC3.2.1 and were able to calibrate the ESC. Do we need to calibrate the ESC every time there is a firmware upgrade or only the Accel and Compass need to be Calibrated ?

P.S we updated to AC3.6.9(v3) in order to get the GRIP_ENABLE parameter ref this. However we were not able to calibrate the ESC in AC3.6.9(v2) or AC3.6.9(v3)

Right now we are calibrating the ESC on 3.2.1 and then updating to 3.6.9 to enable the rest of the features. Is this an expected outcome and do you recommend a better way to tackle this? Since we are not sure if the ECS would need re calibration when the firmware updates

Thanks,
Niharika

Posts: 1

Participants: 1

Read full topic

SBUS Output Not Working

$
0
0

@rge99 wrote:

I am assuming and trying to use the SBUS output to daisy chain the SBUS between my flight controller and gimbal but, I am seeing no output on the SBUS out port. I set BRD_SBUS_OUT parameter wit no effect. Any ideas would be greatly appreciated.

Posts: 1

Participants: 1

Read full topic

MISSION Continuation in AUTO mode

$
0
0

@charles_linquist wrote:

If I am flying a Mission, and all waypoints are set to 100M, then, between waypoints 2 & 3, switch to loiter and manually climb vertically to 200M, then switch back to AUTO.

Will the copter-

  1. Descend at an angle toward the 100M altitude at waypoint 3?
  2. Fly at 200M until it gets to waypoint 3, at which point it will descend to 100M?
  3. Immediately decend to 100M before proceeding to waypoint 3?
  4. Something else?

Will it do the same thing in the horizontal plane? That is, if I am flying a mission and switch to Loiter at waypoint 2, move 500M sideways, and then switch back to Auto, will it simply fly a straight line from where it is to waypoint 3? Or will it go back to waypoint two (where I changed the mode) and then go to waypoint 3?

I have the FC programmed to ‘continue with mission’ not restart it.

Posts: 1

Participants: 1

Read full topic

Problems with Setting up Fail Safe

$
0
0

@intrepid wrote:

Hello,

I am just completed a diy drone using Pixhawk 4 as the flight controller. I have been successful in configuring the Pixhawk 4, with the exception of setting up the fail safe. I am using a Flysky FSi6x. I followed instructions for setting up the transmitter to have channel 3 fail safe on at -102%. However, when I attempt to arm the flight controller, with radio fail safe set to RTL this is a sample of the messages I get:

PreArm: Yaw radio min too high
PreArm: Pitch radio max too low
PreArm: Pitch radio min too high
PreArm: Yaw radio min too high
PreArm: Pitch radio max too low
PreArm: Pitch radio min too high
PreArm: Check FS_THR_VALUE

In the radio fail safe section there are instructions for setting up the fail safe either by using the low-throttle method or the signal-loss method. I have tried following both instructions. When I try the low-throttle method, I am unable to arm the drone and have the accompanying messages listed above. When I disable the radio fail safe, I am able to arm the drone.

I would appreciate any advice or help that you can provide.

-David

Posts: 1

Participants: 1

Read full topic

Viewing all 46418 articles
Browse latest View live


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