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

Auto Survey and Heading Hold option

$
0
0

@Prototype3a wrote:

Seems that the Auto Survey code does some strange things with respect to the heading hold option. If you rotate your grid, the heading hold option retains the original calculated heading. Also, if you enable the cross grid option, it again, uses the same originally calculated heading for all portions of the mission.

I really like the heading hold option when flying survey grids as the aircraft seems to have better flight dynamics and waypoint execution since it doesn't have to turn around at each end of the grid.

Posts: 1

Participants: 1

Read full topic


Battery voltage value sent to radio/GCS via Telemetry?

$
0
0

@rsilk wrote:

I have a FLVSS voltage sensor setup with the C&T cable. The FLVSS shows on it’s little LED screen, the individual cell voltages and the total of all the cells.
I have a Mauch power module too.

What value is sent via telemetry to the radio and/or GCS for the total pack voltage — the voltage calculated by the Mauch/Pixhawk or the voltage displayed on the FLVSS?
Does the total voltage value sent to the radio include 1 or 2 decimal places?

Posts: 1

Participants: 1

Read full topic

Aux Servos via DroneKit

$
0
0

@weliwarmer wrote:

Hi

I'm trying to debug a dronekit script which should move Aux Servo 1 but has no effect. Would someone help me out please?

python 3.4 on the latest apsync. dronekit-python is cloned from github today. Running on an Edison inside a Pixhawk 2.1.

The test script looks like this:

import sys
sys.path.append("/home/apsync/dronekit-python/")
print(sys.path)

import time 
from dronekit import connect, VehicleMode, mavutil


connection_string = '0.0.0.0:9000'

def set_servo(vehicle, servo_number, pwm_value):
	pwm_value_int = int(pwm_value)
	msg = vehicle.message_factory.command_long_encode(
		0, 0, 
		mavutil.mavlink.MAV_CMD_DO_SET_SERVO,
		0,
		servo_number,
		pwm_value_int,
		0,0,0,0,0
		)
	vehicle.send_mavlink(msg)

print("Connecting to plane on %s" % (connection_string,))
vehicle = connect(connection_string)

print(" GPS: %s" % vehicle.gps_0)
print(" Battery: %s" % vehicle.battery)
print(" Last Heartbeat: %s" % vehicle.last_heartbeat)
print(" Is Armable?: %s" % vehicle.is_armable)
print(" System status: %s" % vehicle.system_status.state)
print(" Mode: %s" % vehicle.mode.name)

for x in range(1, 60):
	set_servo(vehicle, 1, 1100)
	time.sleep(1)
	set_servo(vehicle, 1, 1500)
	time.sleep(1)
	set_servo(vehicle, 1, 1100)

vehicle.close()    
print("Completed")

and the output looks like this

apsync@apsync:~$ python3 servo.py 
['/home/apsync', '/usr/lib/python3.4', '/usr/lib/python3.4/plat-i386-linux-gnu', '/usr/lib/python3.4/lib-dynload', '/usr/local/lib/python3.4/dist-packages', '/usr/lib/python3/dist-packages', '/home/apsync/dronekit-python/']
Connecting to plane on 0.0.0.0:9000
>>> Exception in message handler for HEARTBEAT
>>> mode (0, 0) not available on mavlink definition
>>> ArduPlane V3.8.0beta5 (708b483d)
>>> PX4: 8d505a02 NuttX: 1a99ba58
>>> PX4v2 0038002F 30365111 35323931
 GPS: GPSInfo:fix=1,num_sat=0
 Battery: Battery:voltage=0.0,current=None,level=None
 Last Heartbeat: 0.05578364600000896
 Is Armable?: False
 System status: CRITICAL
 Mode: RTL
>>> Exception in message handler for HEARTBEAT
>>> mode (0, 0) not available on mavlink definition
>>> Exception in message handler for HEARTBEAT
>>> mode (0, 0) not available on mavlink definition
>>> Exception in message handler for HEARTBEAT
>>> mode (0, 0) not available on mavlink definition
>>> Exception in message handler for HEARTBEAT
>>> mode (0, 0) not available on mavlink definition
...
Completed

None of the aux servos move.

Any ideas what I've missed and where more logging could be?

Thanks.

Posts: 1

Participants: 1

Read full topic

Bug with EK2_RNG_USE_HGT parameter and sonar

$
0
0

@Thomasss wrote:

Hi,

I've played around with a sonar and have encountered what seems like a software issue.
When the EK2_RNG_USE_HGT parameter is different than 0, the drone tries to use the sonar even though RNGFND_TYPE for sonar 1 and 2 is equal to 0 (i.e. None).
This leads of course to a drone that isn't able to fly and maintain its altitude in Loiter mode (and probably other modes that use altitude).

I've looked into the source code and and don't see where this behaviour is coming from.
In the function selectHeightForFusion() (in AP_NavEKF2_PosVelFusion.cpp ) the code is as follow :

if (((frontend->useRngSwHgt > 0) || (frontend->altSource == 1)) && (imuSampleTime_ms - rngValidMeaTime_ms < 500)) {
[...]
} else if ((frontend->altSource == 2) && ((imuSampleTimems - lastTimeGpsReceived_ms) < 500) && validOrigin && gpsAccuracyGood) {
activeHgtSource = HGT_SOURCE_GPS;
} else if ((frontend->_altSource == 3) && validOrigin && rngBcnGoodToAlign) {
activeHgtSource = HGT_SOURCE_BCN;
} else {
activeHgtSource = HGT_SOURCE_BARO;
}

Since my primary alt source is set to 0, and I have no sonars connected I would suspect the drone to ignore the 3 first "if" statements and use the BARO but this does not seem the case.

Am I doing something wrong ? If not, it might be interesting to correct this issue.

I've attached the logs of my last flight. The first half is when EK2_RNG_USE_HGT = -1 and the second half is with EK2_RNG_USE_HGT = 60. In red is the altitude as estimated by the EKF and in green is the altitude measured by the baro. In both cases there is no sonar connected and the RNGFND_TYPE are set to 0.

Thanks a lot for your help,

Thomas

2017-06-23 18-39-39.bin (669.4 KB)

Posts: 1

Participants: 1

Read full topic

Negative value for flight mode?

$
0
0

@Inae wrote:

I have a strange question:
I fly gliders equipped with APM 2.5 for several years and I'm very happy about it.
Recently I made a mistake with Mission Planner by defining "Flight mode 4".
Instead of 12 for Loiter, I taped -12 (négative value).
And surprisingly in this mode the plane was flying very well, like with circle, but with a very strong
bank angle (my value of LIM_ROLL_CD = 6000), but without GPS correction of the center of the circle.
That is exactly what I was looking for: a high bank angle and a short loiter or circle radius, but I would be happy if the glider could correct the drift due to the wind with the GPS.
Therefore, I don't understand why the software accepts a negative parameter value, and what is exactly happening with this value.
Could somebody help me and explain me what happens withe a negative value of the flight mode number ?

Gerard

Thank you for all the work you have done.

Gérard Schumacher

Posts: 1

Participants: 1

Read full topic

Injection of UBlox RTK corrections don't appear at Reach GPS, but RTCM3 do appear

$
0
0

@rrr6399 wrote:

I am using the Reach RTK GPS connected to my Pixhawk as a secondary GPS. (Its not used for navigation just for reference.) With Copter 3.4, I could send the UBlox formatted corrections to the Reach via the MAVLINK telemetry from the base station and they were routed correctly to the Reach. With Copter 3.5 RC8, the corrections don't seem to be routed correctly since the Copter's Reach never registers that the corrections arrived. It did work as expected with RTCM3 formatted messages in both 3.4 and 3.5. I'd like to continue to use the UBlox formatted messages since they provide quicker RTK fixes and contain other useful information for the RTK algorithms.

I know there was a lot of work done on the GPS code for Copter 3.5. Were there any changes that would've affected the routing of the UBlox formatted messages? (They get encapsulated in the MAVLINK msg_gps_rtcm_data_dynamic messsage.) One difference in the UBlox vs. RTCM3 messages is that the UBlox messages are larger and have to be broken up into multiple MAVLINK messages.

Posts: 1

Participants: 1

Read full topic

Osd with HKPilot 500mW Transceiver Telemetry Radio Set V2 (433Mhz)

$
0
0

@nomisreltub wrote:

Hi, I have a HKPilot 500mW Transceiver Telemetry Radio Set V2 (433Mhz) and would like to add OSD. I have Apm 2.8 and the telem port is occupied by the HK unit (above)
Is it possible to to use the one port for both? i.e. splice in to wires? any help would be greatly appreciated. Feel free to answer as though talking to a child.

Posts: 2

Participants: 2

Read full topic

Join us for ArduPilot After Hours at Interdrone on Sept 6th

$
0
0

@CraigElder wrote:


Come join Tom, Jaime, Robert, me, and as many of the other developers as we can gather for InterDrone

This will be my fourth InterDrone and the third year that ArduPilot will have a booth. There are lots of interesting presentations and we'll have another After Hours session too.
We would love to see you there.

Posts: 3

Participants: 1

Read full topic


Good sites to learn ardupilot coding

$
0
0

@aditya wrote:

I am new to the ardupilot. Can anyone pls tell me some gud sites to learn coding for ardupilot

Posts: 1

Participants: 1

Read full topic

No Heartbeat only for ArduPlane V3.7.1 Firmware

$
0
0

@ypsonar wrote:

I am regularly use Mission Planner, but today I am facing problem to install firmware for Arduplane V3.7.1.
Arduplane V3.7.1. Installed properly, but not connecting, shows error as "No Heartbeat Package Received" , at this condition Flash light of PX4 in red.
To check pixhawk PX4, usb cable, pc, Mission Planner soft etc. I install other firmware like APM:Copter V3.4.6 Quad and some other also. In that installation everything working properly, and connect normally.
I have to point out that the problem of connecting is only for Arduplane V3.7.1. And other firmware working properly.
Please guide in details to resolve this problem.

Posts: 1

Participants: 1

Read full topic

MAVLink fastest output

$
0
0

@bendead wrote:

Hi guys,

I am wondering, with faster processors, on Pixhawk 2.1 and Pixhawk 3 Pro from Drotek.

Is a telemetry refresh rate of 30Hz or more currently possible or will it in the future? What about MAVLink 2.0?

Also, is it possible to output coordinates as a mix of GPS and IMU at a fast rate or do I need to use a GPS unit like the UBLOX NEO-M8L?

Thanks

Posts: 1

Participants: 1

Read full topic

Arducopter Firmware on Boat.(Apm2.8)

$
0
0

@civicoulas15 wrote:

Hello to all of you,

As we know arduboat firmware is outdated.
Can I use the latest arducopter firmware for simple use of my rc boat?
One motor one rudder and RTL function.
Or ist it going to be trouble as copter firmwares are developed for more motors , esc's etc?
I ask because the abillities of the copter firmwares are more developed in all settings

Best regards

Posts: 1

Participants: 1

Read full topic

Alt-hold motor pulsing

$
0
0

@juzzle1 wrote:

When the rangefinder is enabled (Lightware SF11/C) I can hear the motors start pulsing at around 2 Hz (very pronounced sound) and the attitude stability 'feels' reduced.

It seems that the rangefinder makes this problem more pronounced, rather than being the root cause.

I have CH11 set to enable / disable rangefinder (high is enabled) and you can see the motor outputs oscillating when it's enabled quite cleary:

Alt-hold seems overly aggressive to me and is not doing the system efficiency any favours.

(see below alt-hold vs stabilise)

I have reduced ACCEL_Z_P and ACCEL_Z_P by 50% (the mimimum Misson Planner allows) as recommended in the docs without much noticeable effect.

There is also ACCEL_Z_D (default 0) and ACCEL_Z_FILT (default 20)... which I'm tempted to change but I'm not sure of their effects.

Is there anything I can do to smooth this out?

Thanks in advance,

Justin
2017-06-24 13-41-06.bin (2.4 MB)

Posts: 3

Participants: 1

Read full topic

Need Advice on using very little negative pitch setting

$
0
0

@rfine7666 wrote:

Thanks in advance for any help
I am pretty new to AMP helicopter and like to have very little negative pitch because I have not taught my thumb not to pull all the way down on the throttle when I panic.
I am having some trouble with the helicopter wanting to float quite a bit and maybe my negative pitch setting of -2 to -3 degrees in mission planner is part of the problem?
I read this in one of the traditional helicopter setup in mission planner post.
The FC needs the range to cope with gusts etc. You can set +/-12° for the FC and -2° to +10° for you and 'everybody' is happy.
Am I correct that this advice means to use mission planner heli setup and set the APM values to +12 and -12 and then save? Then use a pitch curve in your transmitter to setup a +10 and -2 for easier hover beginner flying?
If there is a better way to do this please tell me.
Thanks

Posts: 3

Participants: 1

Read full topic

Will Arducopter use DISTANCE_SENSOR downwards message?

$
0
0

@FabricioSilva wrote:

If Arducopter (3.4 or 3.5) receives a MavLink DISTANCE_SENSOR message, with orientation=25 (downwards), will it use to enhance landing (as when using supported sonars) and to enhance AltHold/Loiter height control?

And what about orientation=24 (upwards)? Will it use for obstacle avoiding?

Posts: 2

Participants: 2

Read full topic


Bad gyro health on Pixhawk 2.1

$
0
0

@allanm84 wrote:

I consistently get "Bad Gyro Health" messages on Pixhawk 2.1s with Copter 3.4. According to Philip Rowse, this is due to “comparing imu1 after compensation to imu3 without compensation”, and should be relatively easy to remedy. I've attached a dataflash log when the issue occurs (LOG_DISARMED enabled).57.log (204 KB)

Posts: 1

Participants: 1

Read full topic

Trying to get started with Dronekit on Edison with APSync

$
0
0

@Professor_Jones wrote:

I setup my Edison board in the Pixhawk 2 with the APSync image as described on the Companion Computer wiki and everything is working well. Now I'm trying to get started with Dronekit. I saw that all the components are installed including STIL by running pip freeze so I put a copy of the examples in the apsync home folder and tried to run one. No luck. Since I didn't do the setup I'm not sure what's wrong. Any help would be appreciated.

Posts: 1

Participants: 1

Read full topic

Motor Prop Setup 3kg

$
0
0

@loeni wrote:

I look for a new engine Setup
today it flew with:

Emax MT2213-935KV,
1038 Prop, Simonk 30A, 4S 5000mAh
it pull 2000g.

now i try to pull save 3500g.
any idea ?

sunnysky
EMAX
DYR
not to expensive...

Posts: 1

Participants: 1

Read full topic

Hard correction in the waypoint

$
0
0

@Agridroni wrote:

I have a little problem, when my x8 reach the 1° waypoint (ex 58) it turn very gentle to the waypoint 60 in red, but when reach the waypoint stop so hard that the nose point up of 25° and it's not nice to see.
There is a parameter to change for correct this problem?

Posts: 1

Participants: 1

Read full topic

Bitmask settings for Log Analser on Quads firmware- just never bothered to ask untill now

$
0
0

@JoeBreznai wrote:

What Bitmask setting do I use to get the LOG Analyzer to report all results for Quad ?
Using setting of 419838, I am missing the following when using the Auto Analyzer:
Autotune =N/A
Balance/Twist =N/A
PM =N/A
Thrust =N/A

Similar missing info on other settings set under Log Settings in MP and through multiple versions of Quad firmware-just now giving up on settings and taking the easy way outby asking!
Thanks.
Joe

Posts: 1

Participants: 1

Read full topic

Viewing all 46783 articles
Browse latest View live


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