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

ArduPilot with Marvelmind Beacons

$
0
0

@karthikdesai wrote:


This blogpost contains the information that was exchanged between me, @rmackay9, @priseborough, @MHefny, and couple others who were testing the Marvelmind beacons (http://www.marvelmind.com)(henceforth referred to as MM).
At the time of writing this blog, MM was not injecting the distance between each stationary beacons and the mobile beacon. This led us to manually calculate the distance between each stationary beacon and the mobile beacon and inject this into the EKF. But due to other issues, the EKF wasn't too happy and there was some conflictions which made the vehicle jump all over the map even though the vehicle was stationary throughout.

This post contains some the ideas that were exchanged and tested!

  • The vehicle does not receive a lock when the rate of injection of MM data is >8 Hz. To get optimal results a injection rate of 4 Hz was most optimal.
    Thanks to @MHefny for the videos and analysis
    This is a Comparision between 4Hz & 12 Hz update while Beacons are all left intact even the Quad. so all data should be fixed.
  • Define AP's own virtual beacons in MM beacon code, and then use the distance calculation approach that is done in AP MM driver to calculate distance with these virtual beacons,ignoring the real beacons distance and rely only on the given XYZ of the vehicle.
    This could be a generic driver for all types of beacons that has accurate XYZ like MM, and still does not corrupt EKF code.
    This is a video for hardcoded values:

@priseborough's reply to this,
It is fusing the beacons, however there is a 0.8m range innovation on the nearest beacon data which is ID 0. This is possibly caused by the EKF trying to resolve a height error because beacon ID is only 1.3m range away, so the effect of a height offset will be increased due to the increased elevation angle relative to the beacon.
Other than that it appears to be successfully fusion beacon data.
There is something else going on with the data that is causing measurements from different range beacons to be not fused for significant periods, which is causing a lot of the horizontal position movement. This is evidenced by the position states NKF1.PN and NKF1.PE moving whilst the range innovations NKF0.innov are flat-lining:

Range innovations

Range measurements

Position states

At first i thought it was the innovation checks failing, but that is not the case. When measurements are fused, the variation in innovations is less than +-0.1m plus the offset of 0.6m in the innovation for beacon ID 0. The innovation test ratios are small when they are being updated.

Failure to fuse data can be caused by stamping or timing jitter putting the measurements outside the window they need to be for them to be retrieved by the buffer. Diagnosing this is going to require additional data logging or interactive debugging with a probe.

BTW, baro is already being used for height because EK2_ALT_SOURCE is set to 0. To use beacons for height, the beacons would need to be placed in a configuration that was not co-planar to resolve the height ambiguity created by having them all at the same or similar heights, and EK3_ALT_SOURCE should be set to 3.

The fusion of range beacon data was originally developed to work with the Pozyx system. That system read the RF beacons sequentially and did not provide a reliable xyz measurement in flight. Fusng the raw measurements gave a superior result and also enabled temporary dropouts to be handled better. To use the xyz directly, the logical approach would be to convert it to lat/lon/alt and consume it as GPS data

Data file 5 Data5_Bad.bin (175.8 KB)
shows that timing jitter meant that the EKF3 was unable to process data for beacon ID’s 1 and 2. I think the processor is being asked to do too much (it is processing 3 EKF instances) so I recommend that while we are doing the debugging EK2_ENABLE be set to 0 and that EK3_IMU_MASK be set to 1 so we are using a single EKF and IMU. We are also missing pre-arm data. Can you please set LOG_DISARMED to 1 for future testing.

Data file 1 Data1.bin (178.7 KB)
shows that the initial EKF position alignment checks did not pass. I will add a debug message to record all the metrics used by the alignment check.

I notice that the beacon system is reporting a zero height - this is an important detail because the EKF assumes it is operating in a 3D mode when it uses the data in the alignment checks. That means we will have modify the interface to indicate is the beacon systems position estimate is 2D or 3D.

Paulo from info@airborneprojects.com wrote:

I attach the results on our tests with the Marvelmind beacons as per our engineers. We have 2 different attempts, both on V3.5.0-RC7.

  • On our first attempts we were not even able to have the Pixhawk started if the MarvelMind was already initialized. We overcame this by having it powered though the Piwhawk BEC, so that by the time the MarvelMind was initialized the Pixhawk was also.
  • On the second attempts we are having similar results to the ones that Mohammad showed on the video, even though for some reason we never had troubles with the orientation of the movement.

We saw that there are many changes in the EKF for the RC8 and we will have a try at it. We will also make some tweaks on the EKF parameters to see if there is any improvement.

1st Report from 14/06/2017

On the previous tries to connect marvelmind system to pixhawk, the MM beacon was already powered on when i turned on pixhawk.
Now, I tried powering both at the same time, did this using a BEC to power the beacon instead of using it's own battery like before.
First, I turn on the MM system with the stationary beacons and generate and freeze the map.
Then i connect both the PH and MM beacon. PH boots like normal and shows coordinates 0,0. The dashboard starts looking for mobile beacon (sometimes finds it fast, others I have to put the beacon on sleeping mode and wake it up again, i believe this has to do with beacon power saving configs).
When the MM modem finds the beacon I can see it on dashboard map (some points can be wrong on the first 2-3 seconds).
Pixhawk updates coordinates about 30 seconds after that and I can see the quad on mission planner map.

I did some tests to see the precision of the location on mission planner with different Marvemind "location update rate" 4, 8, 12, 16 and 16+.
I did the tests on a ~1.8m side square on the ground, i start with the quad on the center on the square, do the above steps until i get a position on mission planner map and then move the quad in the following order:
center - left - center - right - center - up - center - down - center
where up is north and right is east of the dashboard map
I kept the quad always facing north (up)
The PH parameters where the same as before except for BCN_ORIENT_YAW = -18 I tried to measure it with tha valued on PH when pointing north of the beacons but as i am inside a lab it is not constant in time nor on all parts of the square so i eyeballed an average value.
Beacon "protocol on UART/USB output" was "marvelmind" mode

Attached are the logs and pictures of the marvelmind dashboard and missionplanner
log 2 - 4Hz
log 2 - 8Hz
log 2 - 12Hz
log 2 - 16Hz
log 2 - 16+Hz

---------------------------------------//----------------------------------------------
2nd Report 13/06/2017

This are my attempts on connecting marvelmind system to pixhawk.
I enabled LOG_DISARMED and made 7 logs to compare the results

On log 1, marvelmind beacon is not connected to pixhawk and i could arm the copter

then i connected the beacon with GND and TX to serial 1 (Telem 1 port) on pixhawk, i tried the same with beacon RX connected also. I could not arm the pixhawk on any of the next 6 tries.

log 2 - beacon on "marvelmind" mode and RX connected
log 3 - beacon on "testing data" mode and RX connected
log 4 - beacon on "testing data" mode and RX not connected
log 5 - beacon on "marvelmind" mode and RX not connected
log 6 - beacon on "NMEA" mode and RX not connected
log 7 - beacon on "NMEA" mode and RX connected

The beacon mode refers to the marvelmind dashboard parameter "protocol on UART/USB output"

I am using APM:Copter V.3.5.0-rc7 and these are my parameters:
BCN_ALT 654
BCN_LATITUDE 40,27811
BCN_LONGITUDE -7,513942
BCN_ORIENT_YAW 348 (measured value on pixhawk while pointing north of the beacons)
BCN_TYPE 2
EK2_BCN_DELAY 50
EK2_BCN_I_GTE 500
EK2_BCN_M_NSE 1
BRD_SER1_RTSCTS 0
SERIAL1_BAUD 115
SERIAL1_PROTOCOL 13
GPS_TYPE 0
GPS_TYPE2 0
ARMING_CHECK -14

When connected to copter i can see some errors on mission planner like:
-Bad compass health
-Error pos horiz variance
-gyros still settling

The ground speed keeps increasing
On the EKF window i can also see Position (Horiz) incresing with time (pics attached)
Sometimes when i connect the battery the pixhawk makes a tone different than the usual

@priseborough
I have tracked down bugs that were causing problems with the baro height fighting the beacon constellation height. This resulted in poor height and position stability when there was baro drift. I have verified these changes in SITL, but they still need to be hardware tested.

As you can see this is an ongoing investigation, updates will be posted here.

Posts: 1

Participants: 1

Read full topic


How ot configure the pix let it work when we do not mout the sd card

$
0
0

@jason4952 wrote:

hi everyone,
if i do not mout the sd card ,pixhawk can not work,i want to know how to configure the pixhawk to let it work when do not mount the sd card,thank you very much.

Posts: 1

Participants: 1

Read full topic

Parameter download in Mission Planner is very slow or takes forever, but only sometimes with no reason

$
0
0

@Adolfo_Cobo wrote:

Hello to all,
I am writing this post to ask for your help regarding an issue with Mission Planner that I have noticed since I started using it some years ago and never solved: when I connect to the autopilot using a 433MHz 3DR telemetry radio, the download of parameters takes a variable time, ranging from about 30 seconds to forever. And this download time changes randomly. I think it is not an issue of a particular software or hardware configuration because I have noticed that with several versions of MP, several autopilots (one APM, two 3DR Pixhawks, two Pixhawk-lite-32), several versions of Arduplane and Arducopter, and four models of telemetry radios (from 3dr and clones). I am using now Mission Planner 1.3.48.3 beta and Arduplane 3.8beta5.
I decided yesterday to look at the messages at the debug window, and noticed that there is like two phases in the parameter download procedure. In the first phase, there is a constant flow of messages saying “got param 1 of 819 … got param 2 of 819 … got param 819 of 819”. This is what I see in the debug window:

HUD 7 hz drawtime 0 gl True
INFO MissionPlanner.MAVLinkInterface - 70 got param 64 of 819 name: THR_SLEWRATE
INFO MissionPlanner.MAVLinkInterface - 208 got param 66 of 819 name: THR_SUPP_MAN
INFO MissionPlanner.MAVLinkInterface - 240 got param 68 of 819 name: THR_FAILSAFE
INFO MissionPlanner.MAVLinkInterface - 903 got param 71 of 819 name: THROTTLE_NUDGE
INFO MissionPlanner.MAVLinkInterface - 908 got param 73 of 819 name: FS_SHORT_TIMEOUT
bps 1020 loss 1 left 0 mem 29.3173828125 mav2 False sign False mav1 33 mav2 0 signed 0
HUD 16 hz drawtime 0 gl True
INFO MissionPlanner.MAVLinkInterface - 171 got param 76 of 819 name: FS_BATT_VOLTAGE
INFO MissionPlanner.MAVLinkInterface - 187 got param 78 of 819 name: FS_GCS_ENABL

However, some of 819 parameters are missing. Then, a second phase starts, and the missing parameter numbers are downloaded, BUT, they appear sparsely between A LOT of messages saying: “Already got 287 'COMPASS_OFS3_X' … Already got 336 'SR0_PARAMS' .” Some lines as an example:

INFO MissionPlanner.MAVLinkInterface - 21/06/2017 20:31:24 6 ArduPlane V3.8.0beta5 (708b483d)
INFO MissionPlanner.MAVLinkInterface - 21/06/2017 20:31:24 6 PX4: 8d505a02 NuttX: 1a99ba58
INFO MissionPlanner.MAVLinkInterface - 21/06/2017 20:31:24 6 PX4v2 0039002A 3034510D 36353832
INFO MissionPlanner.MAVLinkInterface - Already got 1 'SYSID_SW_TYPE'
INFO MissionPlanner.MAVLinkInterface - Already got 3 'SYSID_MYGCS'
INFO MissionPlanner.MAVLinkInterface - Already got 5 'SERIAL0_BAUD'
INFO MissionPlanner.MAVLinkInterface - Already got 7 'SERIAL1_PROTOCOL'
INFO MissionPlanner.MAVLinkInterface - Already got 9 'SERIAL2_PROTOCOL'
INFO MissionPlanner.MAVLinkInterface - Already got 11 'SERIAL3_PROTOCOL'
INFO MissionPlanner.MAVLinkInterface - Already got 13 'SERIAL4_PROTOCOL'
INFO MissionPlanner.MAVLinkInterface - Already got 15 'SERIAL5_PROTOCOL'
INFO MissionPlanner.MAVLinkInterface - Already got 17 'AUTOTUNE_LEVEL'
INFO MissionPlanner.MAVLinkInterface - Already got 19 'GCS_PID_MASK'
INFO MissionPlanner.MAVLinkInterface - Already got 21 'KFF_THR2PTCH'
INFO MissionPlanner.MAVLinkInterface - Already got 23 'GLIDE_SLOPE_MIN'
INFO MissionPlanner.MAVLinkInterface - Already got 25 'STICK_MIXING'
INFO MissionPlanner.MAVLinkInterface - Already got 27 'TKOFF_THR_MINSPD'
INFO MissionPlanner.MAVLinkInterface - Already got 29 'TKOFF_THR_DELAY'
INFO MissionPlanner.MAVLinkInterface - 358 got param 30 of 819 name: TKOFF_TDRAG_ELEV
INFO MissionPlanner.MAVLinkInterface - 374 got param 32 of 819 name: TKOFF_ROTATE_SPD
INFO MissionPlanner.MAVLinkInterface - Already got 34 'TKOFF_PLIM_SEC'

And I think that is the reason of the parameter download procedure to take so long, it depends on the number of missing parameters in the first phase. And that changes randomly every time I connect to the autopilot. If the missing parameters in the first phase are just a few, second phase ends shortly. But if many parameters in the first phase are missing, second phase could take literally forever.
I have found a thread in these forum suggesting that slow download is due to the configuration of the SR0_PARAMS parameter, which is the stream rate in hertzs for parameter download. I have then change SR1_PARAMS (SR1 because I am using the TELEM1 port) to 1Hz, 4Hz, 6Hz, 10Hz (default) and 20Hz, with no differences (only at 1Hz it seems it takes a bit longer).
This behavior does not happened when connecting using the USB, which takes a mere 4 seconds, despite the fact that baudrate is just double than radios. I cannot blame the radios because I have tried 4 of them and the STATS window shows a 100% quality connection, about 70 packets per second and no packet loss.
I will appreciate any help to deal with this issue.
Thanks in advance.
Adolfo.

Posts: 1

Participants: 1

Read full topic

Point camera here not working in loiter mode

Pixhawk EZUHF RSSI

$
0
0

@marvinlange wrote:

Anyone have any luck getting RSSI to show up in mission planner using EZUHF I have it set in EZUHF to Channel 12 nothing seems to get it to show up in Mission Planner using PPM Muxed

Posts: 1

Participants: 1

Read full topic

ESC Question Brushless Math hurts my head

$
0
0

@WilliamS wrote:

Plan on building a rover/mower with the the Ardupilot using the Rover in skid steer mode. I see a lot of guys using wheel chair motors and while those are great because they are geared but without a a few downsides. Such as most do not have a neutral, size, and lastly cost.

So off track already I was going to use 6 motors from "hoverboards" they are brushless with 350 watt motors. They are rated on a 10s battery so approximately 36 volts. My armchair math is roughly 10 amps, which sounds very low. Dropping to 24v only 15 amps, again sounds way too low.

Anyway is anyone able to assist me on the math as Im missing something and I dont know why. I run R/C helicopters as well 4x4 Trucks and Im usually good on the math but for some reason these motors are throwing me off.

My entire rig will weigh in about 60 pounds.

Posts: 1

Participants: 1

Read full topic

New control for the UAV

$
0
0

@Geraind wrote:

Hi, if i want to change the PID control for a quadcopter, for another control technique, what libraries are required ? or where i can write the new lines of control ??

So, Thanks.

Posts: 2

Participants: 2

Read full topic

Upgrade SIK Radio - Both Ends?

$
0
0

@flyingw wrote:

I want to use my new 915MHz telemetry radio and am able to see the parameters in the Mission Planner SIK Radio setup screen. I am able to see and change any of the operating parameters and copy them to the remote unit connected to the Navio2.

Are both the near end radio (connected to PC running MP) and the far end radio (connected to Navio2) upgraded? If not, then how do I upgrade the radio unit on the far end?

Also, how can I tell what firmware release was applied? It said version 1.9 before I upgraded, and still says 1.9 after.

Please advise. Thanks,

Paul

Posts: 3

Participants: 2

Read full topic


Configuring wi-fi port as SPI port in a Pixracer board

$
0
0

@IDaniele wrote:

Hi,
I'm working on a project to implement a TDoA location system using a UWB chip (DWM1000).
I'm using a Pixracer board but the DWM1000 is connected through the wi-fi port instead of the SPI port, as follows:


pins_2

Now I'm trying to set the wi-fi port as it was set in the pixhawk (px4-v2) firmware but so far it doesn't work.

Here's a list of the changes I made:

  • https://github.com/ArduPilot/PX4Firmware/blob/master/nuttx-configs/px4fmu-v4/include/board.h
    added:

#define GPIO_SPI4_MISO	(GPIO_SPI4_MISO_1|GPIO_SPEED_50MHz)
#define GPIO_SPI4_MOSI	(GPIO_SPI4_MOSI_1|GPIO_SPEED_50MHz)
#define GPIO_SPI4_SCK	(GPIO_SPI4_SCK_1|GPIO_SPEED_50MHz)
#define GPIO_SPI4_NSS	(GPIO_SPI4_NSS_1|GPIO_SPEED_50MHz)
  • https://github.com/ArduPilot/PX4Firmware/blob/master/src/drivers/boards/px4fmu-v4/board_config.h
    added:

#define GPIO_SPI_CS_EXT0	(GPIO_OUTPUT|GPIO_PUSHPULL|GPIO_SPEED_2MHz|GPIO_OUTPUT_SET|GPIO_PORTE|GPIO_PIN4)
#define GPIO_SPI_CS_EXT1	(GPIO_OUTPUT|GPIO_PUSHPULL|GPIO_SPEED_2MHz|GPIO_OUTPUT_SET|GPIO_PORTC|GPIO_PIN14)
  • https://github.com/ArduPilot/PX4Firmware/blob/master/src/drivers/boards/px4fmu-v4/px4fmu_init.c
    added:

static struct spi_dev_s *spi4;

spi4 = up_spiinitialize(4);
	SPI_SETFREQUENCY(spi4, 10000000);
	SPI_SETBITS(spi4, 8);
	SPI_SETMODE(spi4, SPIDEV_MODE3);
	SPI_SELECT(spi4, PX4_SPIDEV_EXT0, false);
	SPI_SELECT(spi4, PX4_SPIDEV_EXT1, false);
  • https://github.com/ArduPilot/PX4Firmware/blob/master/src/drivers/boards/px4fmu-v4/px4fmu_spi.c
    added:

#ifdef CONFIG_STM32_SPI4
	stm32_configgpio(GPIO_SPI_CS_EXT1);
	stm32_gpiowrite(GPIO_SPI_CS_EXT1, 1);
	stm32_configgpio(GPIO_SPI_CS_EXT0);
	stm32_gpiowrite(GPIO_SPI_CS_EXT0, 1);
#endif

__EXPORT uint8_t stm32_spi4status(FAR struct spi_dev_s *dev, enum spi_dev_e devid)
{
	return SPI_STATUS_PRESENT;
}

__EXPORT void stm32_spi4select(FAR struct spi_dev_s *dev, enum spi_dev_e devid, bool selected)
{
	switch (devid) {
	case PX4_SPIDEV_EXT0:
	stm32_gpiowrite(GPIO_SPI_CS_EXT0, !selected);
	stm32_gpiowrite(GPIO_SPI_CS_EXT1, 1);
	case PX4_SPIDEV_EXT1:
	stm32_gpiowrite(GPIO_SPI_CS_EXT0, 1);
	stm32_gpiowrite(GPIO_SPI_CS_EXT1, !selected);
	default:
	        break;
	}
}
  • https://github.com/ArduPilot/ardupilot/blob/master/libraries/AP_HAL_PX4/HAL_PX4_Class.cpp#L68
    changed:

#define UARTF_DEFAULT_DEVICE "/dev/ttyS0" // wifi

to:

#define UARTF_DEFAULT_DEVICE "/dev/null" // wifi

Please could you tell me if I did right so far and if I need to do something else?

Thank you very much.

Posts: 2

Participants: 2

Read full topic

Firmware_Frame Type Warning

$
0
0

@jimmyp wrote:

Beta Version 3.5 r8 (quadcopter, X-configuration) is loaded. We need to this version because we have a TeraRange Tower 8 installed. The Tower 8 seems to be working.

However we cannot arm det to a Pre-arm error; Firmware_Frame Type error. We tried disabling Pre-arm check, and that did now work. Anybody have any ideas on how to resolve the Pre-arm error?

Posts: 2

Participants: 2

Read full topic

Intel Edison Discontinued

Flight mode jumps when going to another flight

$
0
0

@yak-54 wrote:

Hi got an issue when select flight mode with 6 positions switch on a frsky horus
if i go to auto p it goes to rtl first then to auto p and if i go to stabilise it goes to cruse first then to stabilise

Posts: 2

Participants: 1

Read full topic

Almost there but need a bit of motor help

$
0
0

@ennalta wrote:

I have been on quite the build and I need just a bit more help.

Instead of using the custom industrial motor I was going to use, I am taking the whole 'brain' and simply putting it into an rc car first to test everything out. However I'm not sure what to do about motors, how I should wire them up, etc. and I have not been able to find any good guides to help me. Here is my set-up:
- Pixhawk 2.1 with Rover 3.2.0 beta 2
- U-blox Here+ GNSS
I purchased a skid steer/tank RC device that has two basic brushed motors in it figuring this would be the easiest way to go.

Power is currently a 3600 mah 7.2v venom nimh battery running through the Spektrworks Power Brick Mini

Now my questions:

  1. should I use these motors or...
  2. use something else such as a servo (I have a couple of MG 996R) and driver (stepstick) combo ?

Either way, how do I wire it up? I assume I can use the 12.8v lithium ion battery (or use the system battery) but again, not sure how to wire that up.

Any help would be greatly appreciated.

Posts: 1

Participants: 1

Read full topic

Constant Bad Gyro Health messages

$
0
0

@X1Aero wrote:

Got like 6 bad health gyro messages. They come and go, yet not change in flight behavior. Fly Alt hold, then a auto mission and back to some Althld and loiter. Messages, but nothing bad's happening. Could it just be mavlink reporting back to the ground station? Here's a log file if anyone wants to take a look.

Posts: 1

Participants: 1

Read full topic

Parameter Tuning EKF


Example code for autonomous take off and land

$
0
0

@Pavan wrote:

Hello, I want to achieve an autonomous take off and land of my copter using Odroid XU4 connected through serial port. Could someone share a small code for me to understand this, what are the parameters needed to achieve this. I have found one on the PX4 website, could this be used for APM as well. Thanks

Posts: 2

Participants: 2

Read full topic

Pixhawk board and PID tuning loop

$
0
0

@AhmedRejeb wrote:

hi, all, I'm new in this community, and I have some problems on the project that I'm trying to do.
Okay, I'm trying to implement a PID tuning loop on Pixhawk Board in the first place.
For that, I fund this paper http://calhoun.nps.edu/handle/10945/47258 that use PX4 firmware with the Pixhawk board but the problem is that he uses an RC to control the copter and in my case, I want to use dronekit-Python or onboard computer to control the copter.
can you please give your advice, should I use the PX4 or the APM firmware with my pixHawk and what should I do exactly to get the result that I'm looking for

Posts: 1

Participants: 1

Read full topic

Calibrate Telemetry Radio RSSI in Mission Planner HUD Display?

$
0
0

@flyingw wrote:

I recently deployed a set of 915MHz telemetry radio units for a project. I display the RSSI on Mission Planner, and the display ranges from about 30 to 130. I would like to set it to be more like 0 to 100.

Is there a way to calibrate the RSSI in Mission Planner?

Thanks,

Paul

Posts: 1

Participants: 1

Read full topic

Pixhawk with FAKEGPS

$
0
0

@Debupt wrote:

Recently I just want to use fake gps signal to make the drone fix indoors in Loiter mode with Pixhawk. ( I programed to convert the UWB xyz position info to NMEA protocol and pluged in gps port )

Now the drone can fix in one position, but it still drifts, not that still. (Following is the test log link), The error on mission planner like Error pos horiz variance often happens.

Does anyone encounter these problems? I really hope someone could help me~~

https://drive.google.com/open?id=0B1XJyGUjIacXdW9OdWtMb21UOHc

Posts: 2

Participants: 2

Read full topic

Pixhawk with FAKEGPS signal

$
0
0

@Debupt wrote:

Recently I just want to use fake gps signal to make the drone fix indoors in Loiter mode with Pixhawk. ( I programed to convert the UWB xyz position info to NMEA protocol and pluged in gps port )

Now the drone can fix in one position, but it still drifts, not that still. (Following is the test log link), The error on mission planner like Error pos horiz variance often happens.

Does anyone encounter these problems? I really hope someone could help me~~
https://drive.google.com/open?id=0B1XJyGUjIacXdW9OdWtMb21UOHc

Posts: 5

Participants: 2

Read full topic

Viewing all 46979 articles
Browse latest View live


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