Design Specification UAV with stabilized camera

Size: px
Start display at page:

Download "Design Specification UAV with stabilized camera"

Transcription

1 Design Specification UAV with stabilized camera Version 1.0 Author: Erik Linden, Hamdi Bawaqneh, Olof Backman, Per Johansson Date: December 5, 2010 Status Reviewed Approved

2 Project Identity Group Homepage: Orderer: Customer: Course Responsible: Project Manager: Advisors: Per Skoglar, Linköping University Phone: , David Törnqvist, Linköping University Phone: , David Törnqvist, Linköping University Phone: , Erik Lindén Sina Khoshfetrat Pakazad, Linköping University Phone: , Group Members Name Responsibility Hamdi Bawaqneh Aircraft hamba208 Olof Bäckman Tests oloba221 Magnus Degerfalk magde580 Fredrik Eskilsson Gimbal frees868 Per Johansson perjo871 Erik Jonsson Holm Design erijo975 Therese Kjelldal Documents thekj512 Erik Lindén Project Manager erili277 Gustav Öst Information gusos234

3 Document History Version Date Changes made Sign Reviewer First draft Minor changes Updates to section 2.7

4 Contents 1 Introduction Who is involved Goals Usage Background information Definition of terms Overview of the system Description of the system Product components Dependency on other system Included subsystems What is not included Design philosophy Definition of coordinate systems Relationships between coordinate systems Obtaining and transforming the target vector to the gimbal coordinate system Subsystem 1 - Aircraft Hardware Overview and connection ArduPilot ArduIMU Actuators Electronic speed control Motor GPS Xbee Radio receiver Software ArduPilot ArduIMU Subsystem 2 - Gimbal Hardware Overview and connection Camera mount Servos ArduIMU Video camera Video link Software ArdIMU Control strategy Subsystem 3 - Simulation and software 17

5 5.1 Aircraft model Gimbal model Path generation Path visualization

6 UAV 1 1 Introduction The purpose of the project is to modify an existing control system for an autonomous unmanned aerial vehicle (UAV) and to steer and stabilize a camera placed on a gimbal on the UAV. The camera shall be able to look at specific points on the ground. The camera image is sent to a computer via a wireless video link. The platform that is used in the project is the airplane Multiplex Easystar and the control system Ardupilot. The positioning system of the UAV will be based on a GPS and an IMU. The gimbal will be build by the group members and equipped with an IMU to make it possible to compensate for the movements of the UAV. 1.1 Who is involved The customer is David Tornqvist and the orderer is Per Skoglar, both at the Department of Electrical Engineering (ISY). The project group consists of 10 people studying the project course TSRT10. Four of these study M (Mechanical Engineering), five study Y (Engineering Physics and Electronics) and one studies I (Industrial Engineering and Management). 1.2 Goals Surveillance utilizing small, unmanned aircraft will become increasingly common in the future, as police, rescue services, security companies etc starts to use the technology. The goal of this project is to develop a system where a user can specify a flight path for a UAV. A camera which will be able to lock on to points of interest on the ground will be mounted. 1.3 Usage The system can be used in a number of different ways. For example: surveying damage to power lines or forests after a storm, or to look for missing persons. Another possible use is recording orienteering competitions for television broadcast. 1.4 Background information In this project a platform consisting of the model aircraft Multiplex EasyStar and the control system ArduPilot will be used. The control system is developed as an Open Source project with extensive documentation, and can therefore be modified if needed. A gimbal, constructed from a gimbal kit, will used to mount the camera while the control system to stabilize it will be developed by the group. 1.5 Definition of terms ArduPilot - Open source control system for model airplanes ArduIMU - A complete board consisting of an IMU unit and a micro controller to correct for the drift in the IMU unit itself, with the aid of data from the GPS. Xbee - Wireless modem from airplane to ground IMU - Inertial Measurement Unit RC - Radio Communication GPS - Global Positioning System

7 UAV 2 UAV - Unmanned Aerial Vehicle HIL - Hardware In the Loop. The system is connected to the simulation environment. I2C - Inter-Integrated Circuit ESC - Electronic Speed Control. A unit controlling the speed of the GCS - Ground Control Station aircraft motor. A.S.L - Above Sea Level 2 Overview of the system 2.1 Description of the system A model aircraft, capable of autonomous flight, should with the aid of a camera be able to view specified points on the ground. 2.2 Product components Figure 1: Basic overview of the system The product consists of the model aircraft Multiplex EasyStar controlled by the opensource control system ArduPilot, which makes use of a GPS and an IMU to navigate. The aircraft is equipped with a video camera mounted on a two-axis gimbal, and is also equipped with an IMU. The video camera transmits the image via a separate video link to a receiver on the ground. Wireless communication between the aircraft and a computer is done via the Xbee modem interface. Figure 1 shows a schematic diagram of how the different components interact. There is also an object oriented environment for simulating the aircraft and the gimbal. A more detailed connection scheme is described in figure??.

8 UAV 3 Figure 2: Connection scheme 2.3 Dependency on other system The aircraft is dependent on a computer where the user generates the desired flight path. To determine its position it uses the GPS satellite navigation system. 2.4 Included subsystems The system can be devided into the following subsystems: - Aircraft ï 1 2 Hardware ï 1 2 Software - Camera unit ï 1 2 Hardware ï 1 2 Software - Simulation environment and software 2.5 What is not included Because of the analog nature of the video data, no image processing will be performed. This means that the camera won t be able to track arbitrary targets. The flying will be performed primarily in good weather conditions, and with simple paths.

9 UAV Design philosophy In order for the group to work in an efficient way, it is important that the different components of the product can be developed and evaluated individually. Any computer code used will be written as generally and easy to survey as possible. 2.7 Definition of coordinate systems The system will effectively use 3 different orthogonal, right oriented coordinate systems to describe positions, velocities and vectors. Also the universal World Geodesic System is used by the GPS equipment. The fixed earthbound system is defined using the aviation convention NED, with the x-axis pointed North, y pointing East and z pointing Down. The 2 non-fixes coordinate systems will be defined as FRD, with F in the forward direction, R to the right and D down. See figure 3 for a description of the orientation for the different coordinate systems. They are fixed in the following positions: - World Geodetic System. Abrevated (W). GPS coordinates are defined using this system. Origin is at the centre of the earth, with the z-axis pointing at the geographic north pole and the x axis pointing through the Greenwitch zero meridian. Will be used by the operator when generating paths and target coordinates. - Earth system. Abrevated (e). N is pointing at geographic north pole, D is pointing down. Origin will be defined somewhere in the vicinity of where we are flying, preferably the take off position. - Aircraft system. Abrevated (a). F is pointing through the nose of the aircraft and D down through the fuselage. Will primarely be used by the ArduPilot to succesfully navigate and stabilize the aircraft. The IMU-1 unit generates R (a2e) fully describing the orientation of this coordinate system. Origin in the IMU-1 unit. - Gimbal system. Abrevated (g). F is pointing forward through the camera lens. Will be used by the software for controlling the gimbal in the desired direction. The IMU-2 unit generates R (g2e) fully describing the orientation of this coordinate system. Origin in the IMU-2 unit. Figure 3: Orientation of the coordinate systems Relationships between coordinate systems Since all GPS coordinates are given in the geodetic (W) system lat/long/height format, a system to convert these to the cartesian (e) system is first needed. Assuming that we will primarily be flying short distances in the vicinity of LIU, we will approximate the

10 UAV 5 transformation of a point expressed in the (W) to the (e) system as the differences in the GPS latitudes and longitudes, in radians, between the origo and the point of interest, multiplied by the radius of the earth. The height difference will simply translate as the (negative) D coordinate. The relationship between each non-fixed coordinate system and the earth-bound (which is approximates as fixed and cartesian) can be described by a directional cosine matrix, or DCM, R. This rotational matrix is computed and continously updated by the corresponding ArduIMU unit, and consists of a 3x3 orthogonal matrix (with 4 independent elements). The matrix transforms the vector v (a), expressed in the coordinate system (a), to the vector v (e), expressed in the earthbound system, in the following way: v (e) = R (a2e) v (a) (1) v (a) = or, since R (a2e) is always orhogonal, equivanlently R 1 (a2e)v (e) (2) v (a) = R T (a2e)v (e) (3) To calculate in what direction to point the camera, which operates in its own (g) system, to observe a given target coordinate the R T (g2e) matrix can be used to conveniently transform the vector describing the camera direction in the (e) system (which is obtained by a simple vector subtraction) to the corresponding vector in the (g) system. Having this vector, since all vectors and matrices are normalized, the pan and tilt angles for the camera can be obtained as the trigonometric functions of the corresponding elements in the directional vector. See section for a more explicit example Obtaining and transforming the target vector to the gimbal coordinate system The controller in the gimbal has 2 signals with which to influence the direction of the camera, the pan (ϕ) and tilt (θ) angles. The pan is the (approximatley, depending on orientation) horizontal angle, rotating the camera around the D axis, with 0 is at the F direction and positive direction towards the R axis. Tilt is the (again, approximate) up and down angle. It rotates the camera around the R axis, with 0 at the F axis and positive direction is towards the D axis. See figure 5 for futher referece. To calculate these angles, the controller need only to know the directional vector from itself to the target in its own coordinate system, (g).

11 UAV 6 Figure 4: Relationships between vectors in different coordinate systems Definitions: O is an arbitrary point of origin, G is the position of the gimbal and X is the positon of the target on the ground. Note: AB denotes the general vector from point A to point B, without implying that a special coordinate system is beeing used. AB (z) is the vector from point A to point B, described using coordinate system z. The same is true for points, A is simply a point in space, while A (z) is the set of coordinates describing this point in the z coordinate system. To start off with, the GPS and the user provides the ArduIMU (after the appropriate transformation from (W) to (e)) with the coordinates of its current position G (e) and the target X (e), respectively (figure 4). To obtain the vector GX (g), an arbitrary point of origin O (e) is introduced. Now GX (e) can be expressed as: GX (e) = OX (e) OG (e) (4) GX (e) = (X (e) O (e) ) (G (e) O (e) ) = X (e) G (e) (5) Now the required vector GX (g) can be obtained by multiplying GX (e) by the correct form of the DCM: GX (g) = R T (g2e)gx (e) (6) The ϕ and θ angles can be obtained using the components ( f, r, d ) T of the vector GX(g) in the following forumlas (similar to those used for standard spherical coordinate systems): ϕ = arctan 2(r, f) (7) θ = π 2 arccos ( d GX (g) ) (8) Figure 5 shows the orientation of pan and tilt angles in the gimbal coordinate system.

12 UAV 7 Figure 5: Obtaining the pan and tilt angles

13 UAV 8 3 Subsystem 1 - Aircraft 3.1 Hardware Overview and connection The aircraft itself is a Multiplex EasyStar model aircraft. It is made out of durable ELAPOR foam, and has in its basic configuration a backwards mounted electric motor, two actuators for controlling yaw and pitch rudders and a radio receiver for operation. There is also a battery pack and a speed control for the motor. In this project the system is expanded with a ready-made autopilot, ArduPilot, developed as an open source project. Using the out-of-the-box features of this autopilot, the aircraft will be able to fly autonomously using user defined GPS coordinates, perform FBW, stabilize the aircraft when controlled by operator, loiter around a specified point, and return to launch if connection is lost. To be able to estimate its position and orientation, the aircraft will use an ArduIMU and a GPS unit. For the aircraft to communicate with a laptop on the ground during flight a wireless serial modem, Xbee, is connected to the ArduPilot ArduPilot The ArduPilot is an open source autopilot system, capable of controlling and stabilizing a model aircraft in autonomous flight. When equipped with a GPS receiver and/or an IMU unit, it can navigate a simple flight path consisting of GPS coordinate waypoints. It acts as the centre of the aircraft system, collecting signals from most of the components and controlling the actuators according to its internal control strategy. If the autopilot is not in use, the signals from the operator on the ground is passed straight through the ArduPilot. However it will still log any data, if desired. The ArduPilot will be connected to the RC receiver and to the following actuators: rudder servo, elevator servo and the speed controller. Once the ArduPilot is connected to the RC receiver and actuators we move on and connect the ArduIMU-1 (with the GPS). Then we go on connecting ArduPilot to the Xbee module and the last step is to connect the voltage and ground for all included units. Voltage received from: ESC (5V) Voltage distributed to: - Rudder/elevator servo - ArduIMU-1 - ArduIMU-2 - Xbee - RC receiver Signals received from: - ArduIMU-1 Aircraft orientation information; roll, pitch and yaw in degrees GPS coordinates; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s

14 UAV 9 - ArduIMU-2 Camera orientation information (level 3 requirement) - Xbee modem Updated route/target coordinates; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s - RC Receiver Signals sent to: Rudder/elevator servo and ESC control signals Autopilot engage/disengage flag - ESC (Speed control signal) - Rudder/Elevator servo - ArduIMU-2 Target location; longitude and latitude in degrees Xbee modem Updated UAV flight data; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s ArduIMU-1 The ArduIMU-1 will be used to estimate the orientation and velocity of the aircraft. It consists of a board with three accelerometers, three gyros and a micro controller (Atmega MHz from Atmel). The micro controller is used to compute the DCM and to correct for gyro drift and numerical errors in the output, using input from the GPS and accelerometers as reference. This is already implemented in open source code and will be used as-is in the project. The unit obtains measurements from its on-board sensors and the connected GPS, processes this information and forwards the orientation and position information to the ArduPilot. Voltage received from: - ArduPilot (5V) Signals received from: - GPS unit Signals sent to: GPS coordinates; longitude and latitude in degrees 10 7, altitude in decimetres a.s.l. and speed in cm/s - ArduPilot Aircraft orientation information; roll, pitch and yaw in degrees GPS coordinates; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s

15 UAV Actuators The aircraft has two actuators to control its flight, the yaw and pitch rudders. These are controlled by two servo motors connected to the ArduPilot. When in manual mode, the signals received from the rc-receiver are passed straight through the ArduPilot, i.e. the operator is in direct control of the rudders. In autopilot mode the ArduPilot controls the rudders. Voltage/signal received from: ArduPilot Electronic speed control The electronic speed control (ESC) is the device controlling the speed of the propeller s electric motor, therefore controlling the speed of the aircraft. It also acts as a voltage regulation unit for the entire system, re-distributing the battery voltage to the ArduPilot. As with the actuators, the reference signal to the ESC can be either under direct manual control, or be handled by the ArduPilot, depending on if the autopilot mode is engaged or not. Voltage received from: Battery (11,1V) Voltage sent to: ArduPilot (5V) Signals received from: ArduPilot (Motor ref. speed) Motor The propulsion of the aircraft is controlled by a backwards mounted electric motor with an attached propeller. The motors revolution speed is controlled by the ESC. Voltage/signal received from: ESC GPS The GPS will be connected to both ArduIMUs and mounted on the aircraft vertically, with the antenna pointing to the sky. Voltage received from: ArduIMU-1 (5V) Signals sent to: - ArduIMU-1&2 GPS coordinates; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s Xbee Xbee is a wireless serial modem, and enables wireless communication between the UAV system and a laptop. It will be used for uploading/updating code, flight paths and camera targets, as well as to log flight data. Can communicate during missions while airborne. Voltage received from: ArduPilot Signals received from: - ArduPilot

16 UAV 11 - Laptop Signals sent to: Updated UAV flight data; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s Updated route/target coordinates; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s - ArduPilot - Laptop Updated route/target coordinates; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s Updated UAV flight data; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s Radio receiver In this project we will use 3 channels on the RC receiver for our rudder servo, elevator servo and for the speed controller. A fourth channel on the RC receiver will be used to enable or disable the autopilot. Voltage recieved from: ArduPilot Signals recieved from: Ground operator (Actuator/motor ref signals) Signals sent to: ArduPilot

17 UAV Software ArduPilot The code used is already implemented as open-source. We ll have to choose a GPS protocol (ArduIMU) in the code. There are some built in flight modes in ArduPilot and those are specified below: ArduPilot can act as a simple flight stabilization system or a sophisticated autopilot. Flight modes are controlled through the radio or through logic, using the events.pde file. Those modes are: - Manual - Regular RC control with no stabilization. - Stabilize - RC control with stabilization; The pilot controls the air plane manually, but ArduPilot stabilizes the aircraft when the sticks are left unadjusted. - Fly by wire - Beginner mode. The operator points the sticks in the direction he wants the aircraft to go, and the ArduPilots controls the aircraft to get there. Can be used with manual or automatic speed control. - Auto - The aircraft follows a path made up of GPS waypoints set by the user. - Return to launch - If ArduPilot discovers that connection with the rc transmitter on the ground is lost, it will return to launch point and loiter there until manual control can be regained. - Loiter - The aircraft will circle around its current position. Since we only have one serial port we will implement an i2c bus to communicate with ArduIMU-1 and ArduIMU-2. The ArduPilot will be the master. The ArduPilot will communicate with the Xbee through the serial port ArduIMU-1 We ll have to choose a GPS protocol (EM406) and maybe also change some user-modifiable options. We ll also have to write code so that the i2c bus works probably and the ArduIMU-1 will be slave-1.

18 UAV 13 4 Subsystem 2 - Gimbal 4.1 Hardware Overview and connection The gimbal subsystem consists of a ready made camera mount with a video camera, rotatable in 2 directions by servo motors (pan and tilt). It has an ArduIMU unit to estimate its orientation and position of the gimbal, and therefore also what the camera is looking at. The IMU will control the direction of the camera to look at points of interest on the ground, and to stabilize it according to some suitable control law Camera mount The camera mount is a commercial unit made out of lightweight fibreglass plates and some bearings. It can be rotated by two servo motors, and has a mount for a video camera. It will be positioned on top of the aircraft to start off with. Because this is not optimal for observing points on the ground, moving it to a better position on the aircraft is included as priority 3 requirement Servos The gimbal has two servo motors directing the camera in pan and tilt direction to achieve the desired orientation. They are controlled by the ArduIMU-2, and are connected to its two servo outputs. Voltage/signal recieved from: ArduIMU ArduIMU-2 The ArduIMU-2, physically positioned in the immediate presence of the video camera, can be used to estimate the orientation and velocity of the gimbal. It consists of a board with three accelerometers, three gyros and a micro controller (Atmega MHz from Atmel). The micro controller is used to compute the Euler angles and to correct for gyro drift and numerical errors in the output, using input from the GPS and accelerometers as reference. This is already implemented in open source code and will be used as-is in the project. What is new in this project is that the control signal to the gimbals two servos is calculated by excess capacity in the micro processor, and executed using the boards two servo outputs. It receives the target GPS coordinates from the ArduPilot, calculates the desired orientation of the camera and adjusts the pan and tilt servos accordingly. Also, as a priority 2 requirement, any disturbances (i.e. shaking, vibration etc) of the gimbal is stabilized, producing a smooth video output. Voltage received from: - ArduPilot (5V) Signals received from: - ArduPilot GPS coordinates of camera target; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s.

19 UAV 14 - GPS unit GPS coordinates of the aircraft; longitude and latitude in degrees 10 7, altitude in decimeters a.s.l. and speed in cm/s. Shared with ArduIMU-1. Signals sent to: Pan and tilt servos Video camera The video camera is mounted on the gimbal and produces a constant video stream, fed to the video link. Voltage received from: Battery (11,1V) Signals sent to: Video link (analogue video) Video link The video link is an wireless analogue link used to transmit the video stream from the camera to a pair of VR glasses on the ground. Voltage received from: Battery (11,1V) Signals sent to: Video receiver on ground

20 UAV Software ArdIMU-2 The software in the micro controller on the ArduIMU-2 will have 2 basic tasks. The first one is the task it is originally built for, and that is to estimate the orientation of the board (=the camera), correcting for gyro drift and other errors. This is already implemented when bought and will be used as-is in the project. For more details refer to the paper by Premmerlani and Bizard (2009)[1]. The second task for the controller is to implement a suitable control law to direct the camera to what ever point(s) on the ground the operator wishes to observe. It will receive the GPS coordinates of the target, in long/lat format from the ArduPilot, compare this with where it is currently looking, and adjust the pan and tilt servos accordingly. The process is schematically depicted in figure 6: Figure 6: Overview of the gimbal software Since the GPS cable will be split and led to both ArduIMU-1 and ArduIMU-2 we ll choose GPS protocol (EM406) in ArduIMU-2 too. The ArduIMU-2 also needs code to be able to communicate with the ArduPilot and ArduIMU-1 through the i2c bus. ArduIMU-2 is also a slave and we ll call it slave Control strategy The controller will be implemented in the micro controller on the ArduIMU-2 and receive target coordinates in the earth reference system from the ArduPilot. The GPS provides updated coordinates of the plane s current position in the earth reference system. By calculations described in section a vector pointing at the target in the gimbal reference system is obtained, continuously updated with information about current position and gimbal orientation through the DCM. The pan- and tilt angles are calculated from the obtained vector. The feedback from the IMU makes it possible to calculate the control error, fed to the controller. See figure 7

21 UAV 16 Figure 7: Control loops Another possible reference signal is the desired pan-and tilt angles generated for example by an operator on the ground (via the joysticks on the RC-radio). In that case the controller will work merely as a gyro stabilizer taking care of disturbances. See figure 8 for a diagram. Figure 8: Control loops, operator controlled gimbal The pan- and tilt angles will be viewed as decoupled, making it possible to use decentralized control, i.e. apply a one dimensional controller for each of them. The possible coupling will be viewed as disturbance. A PID-controller will be implemented for the pan- and tilt angles respectively. Focus will be on a stable controller that follows the reference signal without oscillations. It may be that the coupling effects between panand tilt angles have to be handled more explicit. In that case, an attempt to decouple the signals will be made. If the results aren t satisfactory, a linear-quadratic regulator will be implemented. The LQ regulator makes it possible to handle more complex dynamics of the gimbal and take care of coupling effects better.

22 UAV 17 5 Subsystem 3 - Simulation and software 5.1 Aircraft model Figure 9: The Aircraft The aircraft model will be a 3D simulation with 7 basic inputs; starting position, the two rudders, speed, wind strength, wind direction and a flag to indicate lost connection with the ground unit. We will continuously change the internal control parameters that controls how the aircraft model behaves during flight to match our real aircraft. From the model we will be able to receive pitch, yaw and roll which will be the base of our simulated ArduIMU-1. Based on initial conditions, rudder settings and speed we are also able to create a simulated GPS which we ll need for navigation purposes. A basic overview of the aircraft and its closest dependencies are shown in figure 9. The autopilot receives orders as input, together with IMU and GPS data. Based on this it calculates how to point the rudders and the speed and sends this to the aircraft model. The aircraft model also takes wind into consideration, and calculates its new position and orientation. These new values are then sent back to the autopilot, via dummy GPS- and IMU-models that just saves the values for use in other systems. We will also be able to add disturbances in these two dummy models to get more realistic results when testing requirements. With regards to software it doesn t matter if we use ArduPilot with HIL or our simulated autopilot, since they will use the same interface. When using ArduPilot we will receive simulated IMU- and GPS data via a serial cable. Based on this data it will make its decisions as usual, behaving as if it was in the air. When ArduPilot has decided how to react, it will send its data for the rudders and speed control back into the model in Matlab. The model for the autopilot, which will use a PID-controller, calculates the difference between its heading and where it should head to reach the target and transforms this into angles for the rudders.

23 UAV Gimbal model Figure 10: The Gimbal The gimbal model will have to simulate it s own orientation vector based on the UAV s orientation and previous movements. If the gimbal hasn t moved we can calculate it s current angle based on the UAV s IMU. As soon as we start moving the gimbal around we will update the gimbal s IMU values which will be used in the control loop. As depicted in figure 10, the model for the gimbal will receive GPS coordinates of the target and GPS coordinates from the simulated UAV. Based on the aircrafts orientation it will also create and use its own simulated orientation. These are the same inputs that the real ArduIMU-2 will be using when controlling the camera. With the help of these inputs we re able to use the same code as in ArduIMU-2 for the control of the gimbal, as specified in the Requirement Specification. To be able to tell if we re able to get out target centred in the video, we ll calculate the width of what the camera sees and apply it to the model. 5.3 Path generation After specifying coordinates for the camera to look at, the algorithm will generate waypoints. The model will take into consideration After specifying coordinates for the camera to look at, the algorithm will generate waypoints. The model will take into consideration limitations on turning radius for the air plane, maximum angles for the gimbal etc. The path generating algorithm will be implemented in different ways depending on the placement of the camera and desired ways to film. Different types of path generation will be taken into consideration: - Non-moving target If the target is on a fixed point on the ground, the UAV will fly in a circle around the point at a certain height and with a predefined radius, with the camera pointing at the target. The already implemented mode Loiter will be used in this case, with the target as a waypoint to be circled around. If the target is moved to another fixed position on the ground, the waypoint will simply be changed to the new target position and the UAV will circle around the new target the same way as defined for the first target. - Moving target (The follow car problem ) When a moving target is to be followed the UAV will circle around the target. The radius of the circle will depend on the speed of the moving target. If the target on the ground is moving fast the airplane will almost follow it from straight behind and if the target is moving slow the UAV will circle around it. It can either be implemented as generation of a waypoint on a

24 UAV 19 predefined distance and altitude from the coordinate. Or as a number of waypoints on a circle or part of a circle with a predefined radius and altitude. Generation of the flight path will be done in the simulation software and loaded to the ArduPilot. This will be the same for both the simulation and the real UAV. When adding new waypoint while in the air, these will replace all the previously saved waypoints including the current one. This is done as a safety measure if a waypoint to far away gets uploaded to the UAV. A list of old waypoints will be saved to make it easier to add a waypoint to the beginning of the list without having to retype all previously saved waypoints. The follow car problem will be solved by feeding the software GPS coordinates for the target and based on them calculate new waypoints to be loaded to the ArduPilot via XBee. In both of the previously mentioned cases the software will be the same, since we will be able to send updated waypoints and target locations while in the air. For requirement seven (priority 2), we will have to add a parameter to take time into consideration when planning the flight route. 5.4 Path visualization For the real UAV we will use ArduPilot Ground Control Station (GCS). ArduPilot GCS will both display the flight data and a graphical view of the UAV on a map in live-time, and log all flight data in a.kml file. This file can later be opened and replayed in any.kml reader e.g. Google Earth. In the simulation environment we will use Matlab to plot the information we re interested in since we want as much pure information as possible when testing in the simulator. There is a Google Earth toolbox for matlab which can also be used for a more graphically pleasing visualization. Figure 11 shows an example of how it might look in Google earth.

25 UAV 20 Figure 11: Logged flight in Google Earth

26 UAV 21 References [1] William Premerlani and Paul Bizard. Direction cosine matrix imu: Theory. http: //gentlenav.googlecode.com/files/dcmdraft2.pdf, 2009.

Outline Plan UAV with stabilized camera

Outline Plan UAV with stabilized camera Outline Plan UAV with stabilized camera Version 1.0 Author: Therese Kjelldal Date: December 5, 2010 Status Reviewed Approved Project Identity Group E-mail: Homepage: Orderer: Customer: Course Responsible:

More information

Technical Documentation UAV with stabilized camera

Technical Documentation UAV with stabilized camera Technical Documentation UAV with stabilized camera Version 0.2 Author: Therese Kjelldal Date: December 7, 2010 Status Reviewed Approved Project Identity Group E-mail: Homepage: Orderer: Customer: Course

More information

This was written by a designer of inertial guidance machines, & is correct. **********************************************************************

This was written by a designer of inertial guidance machines, & is correct. ********************************************************************** EXPLANATORY NOTES ON THE SIMPLE INERTIAL NAVIGATION MACHINE How does the missile know where it is at all times? It knows this because it knows where it isn't. By subtracting where it is from where it isn't

More information

Epic Made Easy The Redesigned 350 QX3

Epic Made Easy The Redesigned 350 QX3 Available November 2014 350 QX3 AP Combo BLH8160 (APC) Epic Made Easy The Redesigned 350 QX3 Capturing spectacular aerial video and stills is even easier with the new Blade 350 QX3. Its simplified controls,

More information

Navigational Aids 1 st Semester/2007/TF 7:30 PM -9:00 PM

Navigational Aids 1 st Semester/2007/TF 7:30 PM -9:00 PM Glossary of Navigation Terms accelerometer. A device that senses inertial reaction to measure linear or angular acceleration. In its simplest form, it consists of a case-mounted spring and mass arrangement

More information

Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter

Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter Estimation of Altitude and Vertical Velocity for Multirotor Aerial Vehicle using Kalman Filter Przemys law G asior, Stanis law Gardecki, Jaros law Gośliński and Wojciech Giernacki Poznan University of

More information

User s Guide. SmartAP 4. Flight Control System. SmartAP AutoPilot User s Guide. All rights reserved

User s Guide. SmartAP 4. Flight Control System.  SmartAP AutoPilot User s Guide. All rights reserved SmartAP 4 Flight Control System User s Guide All rights reserved Contents Contents... 2 Introduction... 3 Description... 3 Flight performance... 3 General... 3 Processor... 3 Sensors... 3 Interfaces...

More information

CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH

CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH 27 CHAPTER 2 SENSOR DATA SIMULATION: A KINEMATIC APPROACH 2.1 INTRODUCTION The standard technique of generating sensor data for navigation is the dynamic approach. As revealed in the literature (John Blakelock

More information

2008 AUVSI Student Competition Helicopter Unmanned Aircraft System

2008 AUVSI Student Competition Helicopter Unmanned Aircraft System 2008 AUVSI Student Competition Helicopter Unmanned Aircraft System Authors: Robert C. DeMott II Joshua S. Grinnan Jose E. Ortiz Advisor: Dr. Robert H. Klenke Submitted: May 28, 2008 Abstract The following

More information

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle

Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle Design and Development of Unmanned Tilt T-Tri Rotor Aerial Vehicle K. Senthil Kumar, Mohammad Rasheed, and T.Anand Abstract Helicopter offers the capability of hover, slow forward movement, vertical take-off

More information

CYCLOPS TORNADO OSD V1.0 manual

CYCLOPS TORNADO OSD V1.0 manual CYCLOPS TORNADO OSD V1.0 manual Thanks for buying and using CYCLOPS OSD series products, please read this manual carefully before use. Installation of connections Important: select Jumper instructions:

More information

ALGORITHMS FOR DETECTING DISORDERS OF THE BLDC MOTOR WITH DIRECT CONTROL

ALGORITHMS FOR DETECTING DISORDERS OF THE BLDC MOTOR WITH DIRECT CONTROL Journal of KONES Powertrain and Transport, Vol. 23, No. 4 2016 ALGORITHMS FOR DETECTING DISORDERS OF THE BLDC MOTOR WITH DIRECT CONTROL Marcin Chodnicki, Przemysław Kordowski Mirosław Nowakowski, Grzegorz

More information

QBALL-X4 QUICK START GUIDE

QBALL-X4 QUICK START GUIDE QBALL-X4 QUICK START GUIDE A STEP BY STEP GUIDE TO FLY THE QBALL-X4 UAV This is a step by step guide to fly the Qball-X4 unmanned aerial vehicle. It is highly recommended to follow this guide particularly

More information

Virginia Commonwealth University. Helo UAS. Helicopter Unmanned Aircraft System. Authors: Robert A.Gleich III Robert C. DeMott II James W.

Virginia Commonwealth University. Helo UAS. Helicopter Unmanned Aircraft System. Authors: Robert A.Gleich III Robert C. DeMott II James W. Helo UAS Helicopter Unmanned Aircraft System Authors: Robert A.Gleich III Robert C. DeMott II James W. Homan Advisor: Dr. Robert H. Klenke Submitted: 1 June 2007 Abstract This paper discusses s design

More information

STEP 1: MODULE MOUNTING / WIRING:

STEP 1: MODULE MOUNTING / WIRING: VER1.0 PINOUT DIAGRAM: PORT 1 - INPUT 1 (S.BUS, PWM, PPM INPUT) PORT 2 - INPUT 2 (PWM MODE INPUT OR AUX OUTPUT DEFINED IN SOFTWARE) PORT 3 - OUTPUT 1 (S.BUS OUTPUT) PORT 4 - OUTPUT 2 (SERVO OUTPUT) PORT

More information

Camera gimbal control system for unmanned platforms

Camera gimbal control system for unmanned platforms 8 th International Symposium Topical Problems in the Field of Electrical and Power Engineering Pärnu, Estonia, January 11-16, 2010 Camera gimbal control system for unmanned platforms Kristjan Tiimus, Mart

More information

DJI MATRICE 600 PRO Release Notes

DJI MATRICE 600 PRO Release Notes Date : 2017.10.24 Aircraft Firmware : V 1.0.1.65 DJI GO App : ios V 3.1.18, Android V 3.1.11 DJI Assistant 2 : V 1.1.6 Aircraft Firmware: Increased flight safety. Fixed issue of output error when F channel

More information

INSPIRE 1 Quick Start Guide V1.0

INSPIRE 1 Quick Start Guide V1.0 INSPIRE Quick Start Guide V.0 The Inspire is a professional aerial filmmaking and photography platform that is ready to fly right out of the box. Featuring an onboard camera equipped with a 0mm lens and

More information

2-Axis Brushless Gimbal User Manual

2-Axis Brushless Gimbal User Manual 2-Axis Brushless Gimbal User Manual I Introduction AGM 2-axis brushless gimbal is designed to accommodate the GoPro Hero3 camera, enhancing such various aspects of aerial videography as entertainment,

More information

Make a Quadcopter using KK Flight Controller

Make a Quadcopter using KK Flight Controller Make a Quadcopter using KK 2.1.5 Flight Controller 1 Typical Applications A quadcopter, also called a quadrotor helicopter or quadrotor, is a multirotor helicopter that is lifted and propelled by four

More information

PixHawk and Marvelmind Integration Manual. PixHawk/APM Integration with Marvelmind mobile beacon

PixHawk and Marvelmind Integration Manual. PixHawk/APM Integration with Marvelmind mobile beacon PixHawk and Marvelmind Integration Manual PixHawk/APM Integration with Marvelmind mobile beacon The guide assumes that: 1) The user has configured the copter according to the recommendations available

More information

DJI MATRICE 600 Release Notes

DJI MATRICE 600 Release Notes Date : 2018.04.17 Aircraft Firmware : V 1.0.1.66 DJI GO App : ios V 3.1.31, Android V 3.1.30 DJI Assistant 2 : V 1.1.7 Aircraft Firmware: Improved altitude measuring precision by lowering barometer drift

More information

The Modern Archetype of Drones. Symmetrical facet design radiates a brilliance in the sky

The Modern Archetype of Drones. Symmetrical facet design radiates a brilliance in the sky The Modern Archetype of Drones Symmetrical facet design radiates a brilliance in the sky INSTANT FLYING The Xiro Xplorer is ready to fly right out of the box. Attach the propellers, install the battery

More information

UCSD AUVSI Unmanned Aerial System Team. Joshua Egbert Shane Grant

UCSD AUVSI Unmanned Aerial System Team. Joshua Egbert Shane Grant UCSD AUVSI Unmanned Aerial System Team Joshua Egbert Shane Grant Agenda Project background and history System design overview Gimbal Stabilization Target Recognition Lessons Learned Future Work Q&A UCSD

More information

INSPIRE 1 Release Notes

INSPIRE 1 Release Notes 2017.07.10 1. All-in-One firmware version updated to v01.11.01.50. 2. Remote Controller firmware version updated to v1.7.80. 3. DJI GO app ios version updated to v3.1.13. 4. DJI GO app Android version

More information

1 P a g e. P13231 UAV Test Bed Flight Procedures

1 P a g e. P13231 UAV Test Bed Flight Procedures 1 P a g e P13231 UAV Test Bed Flight Procedures Table of Contents Introduction....3 One Time Operations... 3-4 Automated Flight... 5-6 FPV System 7 Seeded Faults.. 7 Data Management 8 On-Board Flash Memory

More information

Relating Local Vision Measurements to Global Navigation Satellite Systems Using Waypoint Based Maps

Relating Local Vision Measurements to Global Navigation Satellite Systems Using Waypoint Based Maps Relating Local Vision Measurements to Global Navigation Satellite Systems Using Waypoint Based Maps John W. Allen Samuel Gin College of Engineering GPS and Vehicle Dynamics Lab Auburn University Auburn,

More information

AETHER. Thomas Cameron, Kristine Colton, Daren Childers. Senior Project ELECTRICAL ENGINEERING DEPARTMENT. California Polytechnic State University

AETHER. Thomas Cameron, Kristine Colton, Daren Childers. Senior Project ELECTRICAL ENGINEERING DEPARTMENT. California Polytechnic State University AETHER By Thomas Cameron, Kristine Colton, Daren Childers Senior Project ELECTRICAL ENGINEERING DEPARTMENT California Polytechnic State University -San Luis Obispo 2011 2 Table of Contents Contents 1.

More information

DJI Ace One product release notes

DJI Ace One product release notes Date : 26 July 2012 Ace One firmware version : 4.02 Ace Assistant software version : 2.4 Low Voltage Warning Semi Auto Takeoff & Landing (Optional) Ground Station chargeable functions: View (optional)

More information

TG VR Gimbal User Manual V Accsoon. All Rights Reserved.

TG VR Gimbal User Manual V Accsoon. All Rights Reserved. TG20 360 VR Gimbal User Manual V1.0 20161209 www.accsoon.com E-mail: salse@accsoon.com 0 Disclaimers and Warnings Congratulations on purchasing you new VR Gimbal. Please read this manual and disclaimer

More information

THIS IS THE CURRENT FF USER GUIDE AS OF PLEASE DO NOT USE ANY PREVIOUSLY DATED VERSIONS

THIS IS THE CURRENT FF USER GUIDE AS OF PLEASE DO NOT USE ANY PREVIOUSLY DATED VERSIONS THIS IS THE CURRENT FF USER GUIDE AS OF 05-04-2012 PLEASE DO NOT USE ANY PREVIOUSLY DATED VERSIONS INTRODUCTION: I compiled this guide from information posted on RCGroups.COM and from GoodLuckBuy.COM where

More information

INSPIRE 1 Release Notes

INSPIRE 1 Release Notes 2016.12.15 1. All-in-One firmware version updated to v1.10.1.40. 2. DJI GO app ios version updated to v3.1.1. 3. DJI GO app Android version updated to v3.1.1. What s New: 1. Optimized Flight Restriction

More information

The Applanix Approach to GPS/INS Integration

The Applanix Approach to GPS/INS Integration Lithopoulos 53 The Applanix Approach to GPS/INS Integration ERIK LITHOPOULOS, Markham ABSTRACT The Position and Orientation System for Direct Georeferencing (POS/DG) is an off-the-shelf integrated GPS/inertial

More information

CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES

CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES 8th International DAAAM Baltic Conference "INDUSTRIAL ENGINEERING 19-21 April 2012, Tallinn, Estonia CAMERA GIMBAL PERFORMANCE IMPROVEMENT WITH SPINNING-MASS MECHANICAL GYROSCOPES Tiimus, K. & Tamre, M.

More information

{ update_gps, 50 Hz } Updates GPS and inits home for ground start the first time GPS_OK_FIX_3D.

{ update_gps, 50 Hz } Updates GPS and inits home for ground start the first time GPS_OK_FIX_3D. Arducopter deals with many kinds of multicopter and a helicopter. However here I only discuss the case of quadcopter, the other cases of multicopter are similar, except for the case of traditional helicopter.

More information

THE AIVA FLY-BY-WIRELESS UAV PLATFORM

THE AIVA FLY-BY-WIRELESS UAV PLATFORM THE AIVA FLY-BY-WIRELESS UAV PLATFORM The AIVA project concerns to an UAV aimed to perform aerial surveillance, forest fire detection and also to monitor high voltage cables for stress or failures. The

More information

THE VANGUARD LONG RANGE SURVEILLANCE DRONE BEST USED FOR SURVEILLANCE & SECURITY INSPECTION & DETECTION WILDLIFE & GAME

THE VANGUARD LONG RANGE SURVEILLANCE DRONE BEST USED FOR SURVEILLANCE & SECURITY INSPECTION & DETECTION WILDLIFE & GAME THE VANGUARD LONG RANGE SURVEILLANCE DRONE The Vanguard, our most popular UAV, is a long range surveillance drone with a configurable Data Link video Range and flight times. The Vanguard drone system is

More information

THIS IS THE CURRENT FF USER GUIDE AS OF PLEASE DO NOT USE ANY PREVIOUSLY DATED VERSIONS

THIS IS THE CURRENT FF USER GUIDE AS OF PLEASE DO NOT USE ANY PREVIOUSLY DATED VERSIONS THIS IS THE CURRENT FF USER GUIDE AS OF 02-26-2012 PLEASE DO NOT USE ANY PREVIOUSLY DATED VERSIONS INTRODUCTION: I compiled this guide from information posted on RCGroups.COM and from GoodLuckBuy.COM where

More information

LibrePilot GCS Tutorial

LibrePilot GCS Tutorial LibrePilot GCS Tutorial BY Wirginia Tomczyk page 1 of 13 Introduction The first dron of Drone Team project use Open Pilot Copter Control (CC). It is the flight controller supported by LibrePilot firmware.

More information

An Intro to Gyros. FTC Team #6832. Science and Engineering Magnet - Dallas ISD

An Intro to Gyros. FTC Team #6832. Science and Engineering Magnet - Dallas ISD An Intro to Gyros FTC Team #6832 Science and Engineering Magnet - Dallas ISD Gyro Types - Mechanical Hubble Gyro Unit Gyro Types - Sensors Low cost MEMS Gyros High End Gyros Ring laser, fiber optic, hemispherical

More information

Autonomous Landing of an Unmanned Aerial Vehicle

Autonomous Landing of an Unmanned Aerial Vehicle Autonomous Landing of an Unmanned Aerial Vehicle Joel Hermansson, Andreas Gising Cybaero AB SE-581 12 Linköping, Sweden Email: {joel.hermansson, andreas.gising}@cybaero.se Martin Skoglund and Thomas B.

More information

An Arduino-Based System for Controlling UAVs through GSM

An Arduino-Based System for Controlling UAVs through GSM An Arduino-Based System for Controlling UAVs through GSM Perla Krishnakanth Department of Embedded Systems, Nova College of Engineering and Technology, Hyderabad, Telangana 501512, India. Abstract: Long

More information

FPVMODEL. Rescue-2. Integrated with 1 OX Zoom HD Camera Intended for Search and Rescue Missions USER MANUAL

FPVMODEL. Rescue-2. Integrated with 1 OX Zoom HD Camera Intended for Search and Rescue Missions USER MANUAL FPVMODEL Rescue-2 USER MANUAL Integrated with 1 OX Zoom HD Camera Intended for Search and Rescue Missions FP IU n-= WWW.FPVMODEL.COM Copyright 201 7 FPVMODEL LIMITED WARNING AND DISCLAIMER Make sure not

More information

PCEFIS VERSION 3.6 SOFTWARE SUMMARY DESCRIPTION Sellers Aviation Inc

PCEFIS VERSION 3.6 SOFTWARE SUMMARY DESCRIPTION   Sellers Aviation Inc PCEFIS VERSION 3.6 SOFTWARE SUMMARY DESCRIPTION WWW.PCFLIGHTSYSTEMS.COM Sellers Aviation Inc. 352-804-7217 PCFLIGHTSYSTEMS PCEFIS VERSION 3.6 SOFTWARE DISPLAY SUMMARY Bearing to destination* Heading (slaved

More information

Evaluating the Performance of a Vehicle Pose Measurement System

Evaluating the Performance of a Vehicle Pose Measurement System Evaluating the Performance of a Vehicle Pose Measurement System Harry Scott Sandor Szabo National Institute of Standards and Technology Abstract A method is presented for evaluating the performance of

More information

UNIVERSAL CONTROL METHODOLOGY DESIGN AND IMPLEMENTATION FOR UNMANNED VEHICLES. 8 th April 2010 Phang Swee King

UNIVERSAL CONTROL METHODOLOGY DESIGN AND IMPLEMENTATION FOR UNMANNED VEHICLES. 8 th April 2010 Phang Swee King UNIVERSAL CONTROL METHODOLOGY DESIGN AND IMPLEMENTATION FOR UNMANNED VEHICLES 8 th April 2010 Phang Swee King OUTLINES Introduction Platform Design Helicopter Avionics System Ground Station Sensors Measurement

More information

Using the Paparazzi UAV System for Scientific Research

Using the Paparazzi UAV System for Scientific Research Using the Paparazzi UAV System for Scientific Research Gautier Hattenberger, Murat Bronz, and Michel Gorraz ENAC, MAIAA, University of Toulouse, France IMAV2014 Delft August 2014 Hattenberger, Bronz, Gorraz

More information

User s Guide. SmartAP 3.x Pro. Flight Control System. SmartAP AutoPilot User s Guide. All rights reserved

User s Guide. SmartAP 3.x Pro. Flight Control System.  SmartAP AutoPilot User s Guide. All rights reserved SmartAP 3.x Pro Flight Control System User s Guide All rights reserved Contents Introduction... 3 Description... 3 General... 3 Sensors... 3 Firmware capabilities... 4 Flight Modes Overview... 4 Parts...

More information

Identification of a UAV and Design of a Hardware-in-the-Loop System for Nonlinear Control Purposes

Identification of a UAV and Design of a Hardware-in-the-Loop System for Nonlinear Control Purposes Identification of a UAV and Design of a Hardware-in-the-Loop System for Nonlinear Control Purposes Myriam Manaï and André Desbiens LOOP, Université Laval, Quebec City, Quebec, G1K 7P4, Canada Eric Gagnon

More information

Exterior Orientation Parameters

Exterior Orientation Parameters Exterior Orientation Parameters PERS 12/2001 pp 1321-1332 Karsten Jacobsen, Institute for Photogrammetry and GeoInformation, University of Hannover, Germany The georeference of any photogrammetric product

More information

DJI GS PRO. User Manual V

DJI GS PRO. User Manual V DJI GS PRO User Manual V1.4 2017.03 Video Tutorials Virtual Fence Mission 3D Map Area Mission Waypoint Flight Mission 2 2017 DJI All Rights Reserved. Contents Video Tutorials 2 Disclaimer 4 Warning 4 Introduction

More information

ZYX User Manual V Revision

ZYX User Manual V Revision ZYX User Manual V.00 206.07.26 Revision Contents Warning and Disclaimer... 3 I. Product Introduction... 4 II. Product List... 5. Package Contents... 5 III. Mounting & Configuration... 6. Gimbal Controller

More information

Zenmuse Z15-BMPCC. User Manual. V1.0 May 09, 2014

Zenmuse Z15-BMPCC. User Manual. V1.0 May 09, 2014 Zenmuse Z15-BMPCC User Manual V1.0 May 09, 2014 Warning & Disclaimer Do not modify or adjust the Z15-BMPCC. The Z15-BMPCC has been calibrated specifically for the designated Camera and Lens before it leaves

More information

IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION

IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION IMPROVING QUADROTOR 3-AXES STABILIZATION RESULTS USING EMPIRICAL RESULTS AND SYSTEM IDENTIFICATION Övünç Elbir & Electronics Eng. oelbir@etu.edu.tr Anıl Ufuk Batmaz & Electronics Eng. aubatmaz@etu.edu.tr

More information

ROBOT TEAMS CH 12. Experiments with Cooperative Aerial-Ground Robots

ROBOT TEAMS CH 12. Experiments with Cooperative Aerial-Ground Robots ROBOT TEAMS CH 12 Experiments with Cooperative Aerial-Ground Robots Gaurav S. Sukhatme, James F. Montgomery, and Richard T. Vaughan Speaker: Jeff Barnett Paper Focus Heterogeneous Teams for Surveillance

More information

Handout. and. brief description. Marine Gravity Meter KSS 32- M

Handout. and. brief description. Marine Gravity Meter KSS 32- M and brief description of Marine Gravity Meter KSS 32- M Copyright 1999-2010 Bodensee Gravitymeter Geosystem GmbH All rights reserved 1 KSS32-M Marine Gravity Meter Cover removed Copyright 1999-2010 Bodensee

More information

Draganflyer X4 - Base Model SKU: DF-X4-BASE-PKG

Draganflyer X4 - Base Model SKU: DF-X4-BASE-PKG Innovative RC Aircraft & Aerial Video Systems Draganflyer X4 - Base Model SKU: DF-X4-BASE-PKG RTF Basic System With no unnecessary moving parts, the Draganflyer X4 helicopter will operate without maintenance

More information

ET312 GPS-UAV Development Platform. Part 2: Flight dynamics and control theory

ET312 GPS-UAV Development Platform. Part 2: Flight dynamics and control theory ET312 GPS-UAV Development Platform Part 2: Flight dynamics and control theory ET312 GPS-UAV Development Platform This is the second part of a three part series of manuals for the ET312 GPS-UAV. The first

More information

Zenmuse Z15-A7. User Manual

Zenmuse Z15-A7. User Manual Zenmuse Z15-A7 User Manual V1.0 2015.4 Warning & Disclaimer The Z15-A7 gimbal has been calibrated specifically for the designated camera and lens before it leaves the factory. Please mount only the designated

More information

Camera Drones Lecture 2 Control and Sensors

Camera Drones Lecture 2 Control and Sensors Camera Drones Lecture 2 Control and Sensors Ass.Prof. Friedrich Fraundorfer WS 2017 1 Outline Quadrotor control principles Sensors 2 Quadrotor control - Hovering Hovering means quadrotor needs to hold

More information

Terrestrial GPS setup Fundamentals of Airborne LiDAR Systems, Collection and Calibration. JAMIE YOUNG Senior Manager LiDAR Solutions

Terrestrial GPS setup Fundamentals of Airborne LiDAR Systems, Collection and Calibration. JAMIE YOUNG Senior Manager LiDAR Solutions Terrestrial GPS setup Fundamentals of Airborne LiDAR Systems, Collection and Calibration JAMIE YOUNG Senior Manager LiDAR Solutions Topics Terrestrial GPS reference Planning and Collection Considerations

More information

The BOM [Broadcasting Outer Module]

The BOM [Broadcasting Outer Module] Avionics Reimagined The BOM [Broadcasting Outer Module] The first and only ALL-IN-ONE AVIONICS SUITE Distributed by: Adams Aviation Supply Co Ltd mail@adamsaviation.com www.adamsaviation.com BOM (Broadcasting

More information

Zenmuse Z15-BMPCC User Manual

Zenmuse Z15-BMPCC User Manual Zenmuse Z15-BMPCC User Manual 2014.12 V1.2 Warning & Disclaimer Do not modify or adjust the Z15-BMPCC. The Z15-BMPCC has been calibrated specifically for the designated Camera and Lens before it leaves

More information

AscTec Laser Scanner Mount V2 - manual

AscTec Laser Scanner Mount V2 - manual AscTec Laser Scanner Mount V2 - manual Mounting option: + -configuration Please follow the steps in this manual to mount your AscTec Laser Scanner Mount (LSM) onto your AscTec Pelican. For new users, please

More information

Attach the propeller, install the battery and you enter the fascinating world of photography and aerial video.

Attach the propeller, install the battery and you enter the fascinating world of photography and aerial video. XPLORER V - XIRO - HD XPLORER V Platform 3-axis stabilized HD Camera 1080 Manufacturer:XIRODRONE Reference:AXR-16001 Loyalty points offered:291 Price:699.00 XPLORER V - XIRO - HD EVERYTHING YOU NEED IN

More information

GPS-Aided Inertial Navigation Systems (INS) for Remote Sensing

GPS-Aided Inertial Navigation Systems (INS) for Remote Sensing GPS-Aided Inertial Navigation Systems (INS) for Remote Sensing www.inertiallabs.com 1 EVOLUTION OF REMOTE SENSING The latest progress in Remote sensing emerged more than 150 years ago, as balloonists took

More information

Fall 2016 Semester METR 3113 Atmospheric Dynamics I: Introduction to Atmospheric Kinematics and Dynamics

Fall 2016 Semester METR 3113 Atmospheric Dynamics I: Introduction to Atmospheric Kinematics and Dynamics Fall 2016 Semester METR 3113 Atmospheric Dynamics I: Introduction to Atmospheric Kinematics and Dynamics Lecture 5 August 31 2016 Topics: Polar coordinate system Conversion of polar coordinates to 2-D

More information

Satellite Attitude Determination

Satellite Attitude Determination Satellite Attitude Determination AERO4701 Space Engineering 3 Week 5 Last Week Looked at GPS signals and pseudorange error terms Looked at GPS positioning from pseudorange data Looked at GPS error sources,

More information

ESTGIS 2012 Priit Leomar 1

ESTGIS 2012 Priit Leomar 1 5.12.2012 ESTGIS 2012 Priit Leomar 1 ELI 1995 Haljas tee 25 Tallinn 12012 Estonia +372 6480242 eli@eli.ee 5.12.2012 ESTGIS 2012 Priit Leomar 2 MAIN ACTIVITIES ELI ELI MILITARY SIMULATIONS ELI ENGINEERING

More information

ISTANBUL TECHNICAL UNIVERSITY TEAM HEZARFEN AUVSI 2013 Journal Paper

ISTANBUL TECHNICAL UNIVERSITY TEAM HEZARFEN AUVSI 2013 Journal Paper ISTANBUL TECHNICAL UNIVERSITY TEAM HEZARFEN AUVSI 2013 Journal Paper Abstract UAS of Team Hezarfen from Istanbul Technical University is explained in this paper. Aerial vehicle is a multicopter (hexacopter)

More information

Inspire 2 Release Notes

Inspire 2 Release Notes Date: 2018.04.18 Remote Controller Firmware: DJI GO 4 app: V01.02.0100 V01.01.0010 ios V 4.2.12 or above, Android V 4.2.12 or above Added support for adjusting the maximum velocity of aircraft s real-time

More information

ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 2 COORDINATE TRANSFORMS. Prof. Steven Waslander

ME 597: AUTONOMOUS MOBILE ROBOTICS SECTION 2 COORDINATE TRANSFORMS. Prof. Steven Waslander ME 597: AUTONOMOUS MOILE ROOTICS SECTION 2 COORDINATE TRANSFORMS Prof. Steven Waslander OUTLINE Coordinate Frames and Transforms Rotation Matrices Euler Angles Quaternions Homogeneous Transforms 2 COORDINATE

More information

DYNAMIC POSITIONING CONFERENCE September 16-17, Sensors

DYNAMIC POSITIONING CONFERENCE September 16-17, Sensors DYNAMIC POSITIONING CONFERENCE September 16-17, 2003 Sensors An Integrated acoustic positioning and inertial navigation system Jan Erik Faugstadmo, Hans Petter Jacobsen Kongsberg Simrad, Norway Revisions

More information

UAS of Team Hezarfen from Istanbul Technical University is explained in this paper. Aerial

UAS of Team Hezarfen from Istanbul Technical University is explained in this paper. Aerial ISTANBUL TECHNICAL UNIVERSITY TEAM HEZARFEN Auvsi 2014 Journal Paper Abstract UAS of Team Hezarfen from Istanbul Technical University is explained in this paper. Aerial vehicle is a multicopter(hexacopter)

More information

Zenmuse Z15-GH4 (HD) User Manual

Zenmuse Z15-GH4 (HD) User Manual Zenmuse Z15-GH4 (HD) User Manual 2015.4 V1.4 Warning & Disclaimer Do not modify or adjust the Z15-GH4. The Z15-GH4 gimbal has been calibrated specifically for the designated camera and lens before it leaves

More information

3-axis Gyro & Flight Stabilizer for fixed-wing

3-axis Gyro & Flight Stabilizer for fixed-wing A3 Super II 3-axis Gyro & Flight Stabilizer for fixed-wing User Manual 2015.4.20 Revision For Firmware Version V1.1, V1.0, Data Version V1.0 Copyright 2011-2015 HOBBYEAGLE. All Rights Reserved. http://www.hobbyeagle.com

More information

Technical documentation Tricopter with stabilized camera

Technical documentation Tricopter with stabilized camera Technical documentation Tricopter with stabilized camera Version 1.0 Author: Karl-Johan Barsk Date: December 12, 2011 Status Reviewed Karl-Johan Barsk 111206 Approved Fredrik Lindsten 111208 Project Identity

More information

State Space System Modeling of a Quad Copter UAV

State Space System Modeling of a Quad Copter UAV Indian Journal of Science Technology, Vol 9(27), DOI: 10.17485/ijst/2016/v9i27/95239, July 2016 ISSN (Print) : 0974-6846 ISSN (Online) : 0974-5645 State Space System Modeling of a Quad Copter UAV Zaid

More information

Design & Optimization Fuzzy Logic Controller for General Helicopter Model

Design & Optimization Fuzzy Logic Controller for General Helicopter Model Design & Optimization Fuzzy Logic Controller for General Helicopter Model Hasan A. AbuMeteir Graduated Student of Control Engineering IUG Gaza-Palestine hmeteir@gmail.com Abstract Helicopter aviation is

More information

Visualisation Pipeline : The Virtual Camera

Visualisation Pipeline : The Virtual Camera Visualisation Pipeline : The Virtual Camera The Graphics Pipeline 3D Pipeline The Virtual Camera The Camera is defined by using a parallelepiped as a view volume with two of the walls used as the near

More information

Project: UAV Payload Retract Mechanism. Company Background. Introduction

Project: UAV Payload Retract Mechanism. Company Background. Introduction Ascent Vision Technologies LLC 90 Aviation Lane Belgrade, MT 59714 Tel 406.388.2092 Fax 406.388.8133 www.ascentvision.com Project: UAV Payload Retract Mechanism Company Background Ascent Vision Technologies

More information

DJI Inspire 1 V 2. 0 User Manual

DJI Inspire 1 V 2. 0 User Manual DJI Inspire 1 V 2. 0 User Manual Compliance Information KCC Warning Message 해당무선설비는운용중전파혼신가능성이있으므로인명안전과관련된서비스는할수없습니다. 해당무선설비는운용중전파혼신가능성이있음 In the Box Check that all of the following items have been included

More information

Sensor Fusion: Potential, Challenges and Applications. Presented by KVH Industries and Geodetics, Inc. December 2016

Sensor Fusion: Potential, Challenges and Applications. Presented by KVH Industries and Geodetics, Inc. December 2016 Sensor Fusion: Potential, Challenges and Applications Presented by KVH Industries and Geodetics, Inc. December 2016 1 KVH Industries Overview Innovative technology company 600 employees worldwide Focused

More information

Autonomous Navigation for Flying Robots

Autonomous Navigation for Flying Robots Computer Vision Group Prof. Daniel Cremers Autonomous Navigation for Flying Robots Lecture 3.2: Sensors Jürgen Sturm Technische Universität München Sensors IMUs (inertial measurement units) Accelerometers

More information

Caution Notes. Features. Specifications. A3-L User Manual V1.0

Caution Notes. Features. Specifications. A3-L User Manual V1.0 Caution Notes Thank you for choosing our products. If any difficulties are encountered while setting up or operating it, please consult this manual first. For further help, please don t hesitate to contact

More information

Strapdown Inertial Navigation Technology

Strapdown Inertial Navigation Technology Strapdown Inertial Navigation Technology 2nd Edition David Titterton and John Weston The Institution of Engineering and Technology Preface xv 1 Introduction 1 1.1 Navigation 1 1.2 Inertial navigation 2

More information

Critical Design Review. Almog Dov Assaf Aloush Bar Ovadia Dafna Lavi Orad Eldar. Supervisor: Dror Artzi

Critical Design Review. Almog Dov Assaf Aloush Bar Ovadia Dafna Lavi Orad Eldar. Supervisor: Dror Artzi Critical Design Review Almog Dov Assaf Aloush Bar Ovadia Dafna Lavi Orad Eldar Supervisor: Dror Artzi Man-portable UAV Over the hill / Urban surveillance Fast field deployment Endurance: 3 min Simple to

More information

BRx6 Sensor Calibration Using SurvCE/SurvPC

BRx6 Sensor Calibration Using SurvCE/SurvPC OVERVIEW BRx6 Sensor Calibration Using SurvCE/SurvPC The BRx6 internal sensors (tilt, accelerometer and compass) must be calibrated in order to use the electronic bubble and tilted pole corrections in

More information

Inspire 2 Release Notes

Inspire 2 Release Notes Date: 2018.11.16 DJI GO 4 app: v01.02.0300 v01.01.0050 ios v4.3.0 or above, Android v4.3.0 or above Fixed a rare issue where compass interference altered the orientation of the aircraft. Fixed a rare issue

More information

ZENMUSE H3-3D Gimbal. User Manual V DJI Innovations. All Rights Reserved.

ZENMUSE H3-3D Gimbal. User Manual V DJI Innovations. All Rights Reserved. ZENMUSE H3-3D Gimbal User Manual V1.02 2014.06.09 www.dji.com 2014 DJI Innovations. All Rights Reserved. Warning & Disclaimer H3-3D gimbal is calibrated before delivery, no adjustment or modification to

More information

ipad Navigation Map and FPV live video can be displayed with P-in-P (above) or Side-by-Side (below) layout. Custom Telemetry can be shown in either

ipad Navigation Map and FPV live video can be displayed with P-in-P (above) or Side-by-Side (below) layout. Custom Telemetry can be shown in either Camera Overview FPV Camera brings a complete new FPV flying experience for DJI Phantom 3 Pro/Adv and Inspire 1 with innovative Navigation Map to let experienced pilots flying safer and more enjoyable.

More information

WooKong Multi Rotor Product Release Notes

WooKong Multi Rotor Product Release Notes Date : February 21, 2014 WooKong M firmware version : 5.26 WooKong M software version : 2.04 WM Assistant version : 1.4.25 WooKong M Quick Start Guide : 1.12 Software WooKongM Assistant Software V2.04

More information

NAVAL POSTGRADUATE SCHOOL THESIS

NAVAL POSTGRADUATE SCHOOL THESIS NAVAL POSTGRADUATE SCHOOL MONTEREY, CALIFORNIA THESIS STABILIZATION SYSTEM FOR CAMERA CONTROL ON AN UNMANNED SURFACE VEHICLE by Jaya Kumar Kandasamy December 2008 Thesis Advisor: Anthony J. Healey Approved

More information

3D Transformations. CS 4620 Lecture Kavita Bala w/ prior instructor Steve Marschner. Cornell CS4620 Fall 2015 Lecture 11

3D Transformations. CS 4620 Lecture Kavita Bala w/ prior instructor Steve Marschner. Cornell CS4620 Fall 2015 Lecture 11 3D Transformations CS 4620 Lecture 11 1 Announcements A2 due tomorrow Demos on Monday Please sign up for a slot Post on piazza 2 Translation 3 Scaling 4 Rotation about z axis 5 Rotation about x axis 6

More information

Sphero Lightning Lab Cheat Sheet

Sphero Lightning Lab Cheat Sheet Actions Tool Description Variables Ranges Roll Combines heading, speed and time variables to make the robot roll. Duration Speed Heading (0 to 999999 seconds) (degrees 0-359) Set Speed Sets the speed of

More information

Strapdown system technology

Strapdown system technology Chapter 9 Strapdown system technology 9.1 Introduction The preceding chapters have described the fundamental principles of strapdown navigation systems and the sensors required to provide the necessary

More information

Zenmuse Z15-GH3 User Manual V1.00

Zenmuse Z15-GH3 User Manual V1.00 Zenmuse Z15-GH3 User Manual V1.00 2013.09.13 Revision www.dji.com 2013 DJI Innovations. All Rights Reserved. 1 Warning & Disclaimer No adjusting or amending is allowed to Z15. Z15 is specialized for Camera

More information

Use of n-vector for Radar Applications

Use of n-vector for Radar Applications Use of n-vector for Radar Applications Nina Ødegaard, Kenneth Gade Norwegian Defence Research Establishment Kjeller, NORWAY email: Nina.Odegaard@ffi.no Kenneth.Gade@ffi.no Abstract: This paper aims to

More information

Spektrum AirWare Change Log 2016-November-15

Spektrum AirWare Change Log 2016-November-15 Version 1.05 Spektrum AirWare Change Log 2016-November-15 Changes since 2015-February-05 Special Note In the Telemetry menu, some sensors may not be reported properly on the display or audibly after updating.

More information

Multi-agent Collaborative Flight Experiment. Karl Hedrick UC Berkeley

Multi-agent Collaborative Flight Experiment. Karl Hedrick UC Berkeley Multi-agent Collaborative Flight Experiment Karl Hedrick UC Berkeley 1 Operated by the Naval Post Graduate School 2 !!" " #! " " $! %&!! % " ' "!! " $! %" " " %" $ " ' "!!" ("!! " $" " " ' $ " ' ) " $!*

More information