Submarine Fishing Assistant

Size: px
Start display at page:

Download "Submarine Fishing Assistant"

Transcription

1 TVE-E Examensarbete 15 hp Juni 2018 Submarine Fishing Assistant Independent Project in Electrical Engineering Joel Larsson David Forsberg

2 Abstract Submarine Fishing Assistant Joel Larsson, David Forsberg Teknisk- naturvetenskaplig fakultet UTH-enheten Besöksadress: Ångströmlaboratoriet Lägerhyddsvägen 1 Hus 4, Plan 0 Postadress: Box Uppsala Telefon: Telefax: Hemsida: Humanity has been fishing for a long time, more specifically under ice with nets, this could be a lot more efficient if it could be automated in any stage of the procedure. The project aim is to construct an automated system for assisting in net fishing under ice. A navigation system using a GPS module, an IMU and radio transceiver was designed, constructed and implemented on a car for testing. The result was a system that could navigate to either a predetermined point or return to a point saved by the system. A "manual mode" was also implemented to be able to operate the system as a remote controlled car with a computer coupled to an Arduino with a radio transceiver sending control signals to the prototype. The prototype worked as intended, but would need further improvements to the automated navigation system's precision to be ready for commercial use. This should be the primary focus of any further development of this project. Handledare: Kjell Staffas Ämnesgranskare: Ladislav Bardos Examinator: Hana Barankova ISSN: , TVE-E

3 Contents 1 Vocabulary 2 2 Introduction Background Objective Limitations Theory GPS DC motor driving IMU Accelerometer Gyroscope Magnetometer Experimental Details Planning Process Mechanical Construction Electronic Assembly Verification of the system Programming Results Mechanical Construction Sensor Fusion The prototype system as a whole Discussion Precision of product Practicality of product Other applications Conclusion Acknowledgements

4 1. Vocabulary IMU - Inertial Measurement Unit I2C - Inter-Integrated Circuit; an electronic communication system DC motor - Direct Current motor GPS - Global Positioning System Arduino (IDE) - Arduino (Integrated Development Environment) CAD - Computer Aided design, software used for designing constructions in 2D and 3D. 2

5 2. Introduction 2.1 Background Ever since mankind realized there are huge quantities of food roaming the seas, fishing has been a central part of survival. This has lead to multiple technical advancements in the naval and fishing field. Ice fishing has always been a big part of the fishing culture in the colder parts of the world, and this has traditionally been done in a primitive manner. Dragging a net between two bored holes in the ice to catch fish is common practice in Sweden. An ice jigger is commonly used in this scenario, to first drag a line between the bored ice holes, and the line is in turn used to mount the fishing net under the ice. One could imagine this work to be cumbersome, therefore any kind of technical advancement that could alleviate the working process would be of great assistance. 2.2 Objective The objective is to design a product that can aid in the process of laying net under ice. The process that this project aims to facilitate is dragging a line between two holes in the ice. The vehicle should if possible be able to navigate between the holes by itself and travel a distance of up to 70 meters under the ice. The vehicle should also function if the ice is bumpy and be able to salvage if it gets stuck under the ice. The specifications of the prototype are that it should be able to navigate to a point with a precision of 2 decimeters since the hole has a diameter of about 4 decimeters. It should also be able to travel the 70 meters it is supposed to do under the ice. The battery should be large enough to last 3 of these 70 meter trips. 2.3 Limitations Due to the potential complexity of building and testing a submarine capable of navigating between bored ice holes, the project naturally needed some limitations. Main focus of the project work lied in designing and producing a highly precise and safe automated control/navigation system of the submarine, using a GPS-module and a IMU sensor coupled with an Arduino microprocessor. Because of the time frame of the project the submarine construction was only designed and never constructed nor tested in practice, instead to verify the system a RC-car format was used. This format ensured that the system could be verified and tested in a reasonable time frame. 3

6 3. Theory 3.1 GPS GPS is a global navigation satellite system maintained by USA. The GPS system functions by measuring the distance between satellites with known position in space and a receiver with unknown position. A minimum of four satellites is required to determine all parameters needed, a three dimensional coordinate and the error in the receiver clock. The distance measurement can be done in two ways, by code and carrier phase measurement. Code measurement is done by measuring a time shift between code received and code generated in the receiver. The code is generated at exactly the same time in the satellite and the receiver so by multiplying the time delay by the speed of light the distance can be calculated. Carrier phase measurement is done by measuring the number of wavelengths between the satellite and the receiver. The fraction of a wavelength is determined by measuring the phase shift with respect to the generated signal in the receiver but the number of whole wavelengths is more difficult to determine as the carrier signal has no timestamps. Because the carrier phase measurement is more complex it takes a longer time to get a valid position, therefore it is often complemented by code and differential measurement. The advantage of phase measurement is that a higher accuracy can be achieved, in theory phase measurement can be done with an accuracy of about 2 millimeters while code measurement has an accuracy of about 3 meters. Some sources of errors are faults in the satellite trajectory, distortion in the ionosphere due to charged particles and multipath errors. The error due to the satellite trajectory is caused by the satellite position not being the same as the broadcast one. The effect can be reduced by doing relative measurements or by correcting the data with the actual satellite position later. Distortion in the ionosphere is caused by the signal interacting with the charged particles and the effect is proportional to the frequency. It can be reduced by doing relative measurements or measuring signals on different frequencies. Multipath errors occurs when the signal is reflected of a surface before reaching the receiver therefore giving the wrong distance. This kind of error is more common when tall buildings or trees are close by. By measuring over a longer period of time and using good equipment this error can be reduced.[1] 3.2 DC motor driving In order to be able to control a DC motor to turn both directions, the current has to be able to flow both directions. Therefore to control the current bidirectionally through the motor, an h-bridge has to be implemented in the system. An h-bridge consists of 4 MOSFETs, 2 NPN and 2 PNP that are excited in a way that lets the current flow in one direction but not the other. 3.3 IMU An IMU is a sensor that can measure the force, angular movement and sometimes electrical field it is subjected to. They are often used in aircrafts, both manned and unmanned, to determine the orientation of 4

7 the plane during flight Accelerometer The most popular kind of accelerometer is based on the piezoelectric effect but other types are also used when the acceleration have a low frequency. They operate by having a mass suspended by a piezoelectric material acting as a spring. When the sensor is subjected to an acceleration the mass will cause stress on the piezoelectric material and generate an electrical signal. An IMU usually have three accelerometers oriented orthogonally to be able to detect acceleration in all directions.[2] Gyroscope Gyroscopes in IMUs are often angular rate sensors which measures change in the angular rotation. It works by oscillating a structure that due to the Coriolis effect will get a secondary motion in another direction when turned around the measurement axis. By measuring the amplitude of the vibrations in the secondary axis the rate of the rotation can be determined. There is usually three gyroscopes oriented orthogonally in an IMU to be able to detect rotation in all directions.[3] Magnetometer One class of magnetometers is Hall effect sensors that measures the voltage caused by the Hall effect across a conductor. When a current is flowing through a magnetic field perpendicular to the conductor the electrons will experience a force that will deflect them to the right or left depending on the direction of the magnetic field. By measuring the voltage across the conductor the magnetic field can be determined. It is also possible to measure the change of resistance as a result of the changed path of the electrons. By arranging three magnetometers orthogonally the magnetic field can be measured from all directions.[2] 5

8 4. Experimental Details 4.1 Planning Process The first step of the planning process was trying to find suitable components for the navigation/control system, naturally similar problems and their solutions were looked at. Similar projects involving GPSmodules and absolute orientation sensors have been done before, therefore there was a lot of research involved at this stage trying to find the most optimal solution for the task at hand. The choice of using Arduino in conjunction with accompanying modules came with a good interface and practical implementation of programming. 4.2 Mechanical Construction An old experimental segway robot was used for a lot of its parts such as; battery pack, DC motors, motor driver card, tires and breadboards. The new parts such as Arduino Uno, IMU, GPS-module and GPS antenna were added to the construction. The first testing prototype can be seen in figure 4.1. Figure 4.1: The prototype before a custom made chassis was constructed. The on-land car prototype was assembled together on a new custom made chassis made out of plexiglass 6

9 to make the layout of the components more suitable. A radio transceiver was added to the design to be able to control and monitor the vehicle remotely. The second radio transceiver was connected to another Arduino which in turn was connected to a computer, using the Serial monitor in the Arduino IDE as interface for communication. A very basic concept of the submarine design seen in figure 4.2 was done in CAD to visualize the final product. "Skates" were mounted on the top of the submarine to let it skate beneath the ice. Figure 4.2: CAD of the submarine, the holes are prepared for the propeller axes. 4.3 Electronic Assembly Most of the electronic assembly involved getting the sensor fusion to work properly, only one microprocessor was used on the vehicle itself. The Arduino Uno had just enough connection pins so it could connect to the IMU, GPS-module, motor driving circuit and the radio transceiver. To be able to drive the DC engine bidirectionally an L298 motor driver circuit was incorporated. The IMU was positioned in the front of the vehicle as far away as possible from the battery pack and engine which are located on the rear axis, this is an attempt to minimize the impact of statics from engines on the measurements of the IMU. BNO055 by Adafruit is the IMU sensor used in this build, it s an absolute orientation sensor with a 3- axis accelerometer, 3-axis gyroscope and a magnetometer. It uses the I2C protocol to communicate with other components. RoyalTek REB-4216 is the GPS-module used mainly because it was mounted on an Arduino shield system that is made to interface with an Arduino Uno, this was preferable since any kind of ease of implementation is helpful in a project of this complexity. 7

10 4.3.1 Verification of the system Tests were conducted on the robot to try and verify the system. It was programmed so it could store it s current position, then use these coordinates as it s next destination. Location of these tests had to be conducted as far away from a building as possible to minimize the effects of multipathing from the satellite signal but also on adequate terrain for the robot. 30 meters southwest of the Ångstrom laboratory was used as a frequent testing site. First off the BNO055 had to be calibrated to get it s offset, clear skies is also preferable to get a more reliable satellite signal and also enough satellites had to be in contact with the GPS module. It would then be put in place where the destination was wished to be set, store the coordinates for the current position and then move it 70 meters away and let the automated navigation system take it to the coordinates that were stored. The robot would stop when the distance to the destination was less than a meter and send confirmation of this to the computer via radio signals. Measurements were then made of the physical distance from the point of the stored coordinates to where the robot had arrived at its destination. This test was conducted dozens of times. 4.4 Programming The microprocessor used was an Arduino Uno R3. Programming was exclusively done in Arduino IDE, this is open source software that is based on the programming language Java and it can utilize both C and C++. Initially the parts got individual programming and testing to verify that they fulfilled the requirements of the project. The GPS-module is used to retrieve the current coordinates of the vehicle, these can then be used to calculate the course to the destination coordinates (that can either be preset or retrieved locally using the GPS-module). Then the magnetometer in conjunction with the accelerometer are used to align the vehicles course with the course to the destination, turning and propelling itself using the DC motors. A flow chart of the system can be seen in figure

11 Figure 4.3: A block diagram of the system. 9

12 5. Results 5.1 Mechanical Construction The prototype build turned out to be durable and reliable in regards to driving on flat terrain. This made testing of the prototype ideal in urban areas. Due to limitations mentioned earlier in the report, the submerge able vehicle was never constructed, only designed. This car prototype was never intended to be submerged. 5.2 Sensor Fusion Using multiple sensors with a micro processor to increase performance seems to have been a success. The software library TinyGPS++ by Mikal Hart was implemented into the code, this granted a lot of functionality and pre-made functions regarding the GPS module. The BNO055 absolute orientation sensor handles calculations of raw measurement data from the IMU on the chip, calibrating the sensor and giving output in the form of Euler angles. Software library Adafruit_BNO055 by Kevin (KTOWN) Townsend for Adafruit Industries was implemented into the code to increase functionality with pre-made the sensor. 5.3 The prototype system as a whole It came together as imagined. The prototype could navigate by itself from point A to point B. The system can easily be switched over to "manual mode" and remote controlled by a computer using another Arduino Uno microprocessor coupled with a computer and a radio transceiver. From the tests described in it is clear however that the precision of the automated navigation system is roughly ±2 m. The specification that the battery would last at least 3 trips is more than fulfilled since the battery was only charged once during all the tests. 10

13 Figure 5.1: The final version of the automated control system prototype. 11

14 6. Discussion 6.1 Precision of product Tests showed that the precision of the system was around ±2 m. A bored hole in the ice used for ice fishing is usually around four decimeter in diameter. That means that the automated navigation system isn t precise enough, it s even more likely that the GPS module has worse performance under ice due to the signal being subject to refraction and multipathing in the ice. This is something that would be prioritized for improvement if there was more time on the project. To increase the precision of the system one could possibly implement one of the following theoretical systems: Base GPS reference station; if the exact coordinates of a fix GPS station is known, it s possible that it s current position being calculated from satellites is a little bit off, since the exact coordinates of the base station is known this could be measured. The idea here is the same offset is likely applicable to nearby GPS for instance the car prototype, if so it would increase the precision of the system to acceptable levels. Ultrasound sensors and speaker; Two ultrasound sensors could be mounted on the front of the submarine and listen for a speaker submerged in the bored ice hole, sending out ultrasound waves. Then by measuring the phase shift between the two captured signals in the sensors the system could in turn be able to tell in which direction the bored ice hole is and align it s course appropriately. 6.2 Practicality of product The goal of the project was to design a product to aid in the process of getting a line between two holes in the ice. To be a good alternative to the methods traditionally used the product needs to be reliable. The prototype as it is now have not shown the level of reliability to completely replace traditional methods. Aside from the need to increase the precision the calibration of the IMU could be improved. As it is now the IMU can lose its calibration and would need to be recalibrated before the submarine can continue to drive. To recalibrate the IMU it needs to be moved in random figure eights until it indicates being calibrated. As it is impossible to move the sensor in figure eights under the ice another way to solve this is to save the offset data from the sensor and upload it back to the sensor when it loses calibration, assuming the environment around the submarine has not changed to much. The problem with doing this is that the sensor still have a status of not being calibrated when the offsets have been uploaded. The sensor continuously calibrates itself and it might be necessary to keep uploading the offsets to ensure that the right values are kept. Since the sensor is like a "black box" in regards to the calibration and calculation software it makes it harder to implement in the design. 12

15 6.3 Other applications The submarine could probably be used in other applications not being limited to only operate under ice. It could easily be modified to drive towards either a predefined coordinate or transmitter making smaller deliveries at sea when it is not safe or practical to do by boat. The navigation system could also be used in other systems where a driver is not needed, like ocean cleaning. 13

16 7. Conclusion The submarine automated control and navigation system worked as intended, and would be ready to implement into the submarine design. However the developed system would probably need further work to be ready for commercial use. In particular the precision of the system should be improved and could be a subject for future research. The system could also be modified to have a wider range of applications as new ways to use drones are invented constantly. 7.1 Acknowledgements The department of electricity at Uppsala university has been a great help by funding this project and providing equipment, thank you. We would also like to thank Kjell Staffas for being the supervisor of this project, he provided us with great insights in the technical- and project field which in the end affected the end products outcome greatly. 14

17 Bibliography [1] Lantmäteriet, GPS och satellitpositionering se/sv/kartor-och-geografisk-information/gps-och-geodetisk-matning/ GPS-och-satellitpositionering/ [2] Wilson, Jon S, Sensor technology handbook, 2005, Elsevier [3] Apostolyuk, Vladislav, Coriolis Vibratory Gyroscopes: Theory and Design, 2016, Springer International Publishing 15

ARDUINO BASED CALIBRATION OF AN INERTIAL SENSOR IN VIEW OF A GNSS/IMU INTEGRATION

ARDUINO BASED CALIBRATION OF AN INERTIAL SENSOR IN VIEW OF A GNSS/IMU INTEGRATION Journal of Young Scientist, Volume IV, 2016 ISSN 2344-1283; ISSN CD-ROM 2344-1291; ISSN Online 2344-1305; ISSN-L 2344 1283 ARDUINO BASED CALIBRATION OF AN INERTIAL SENSOR IN VIEW OF A GNSS/IMU INTEGRATION

More information

TVE-E Examensarbete 15 hp Juni Wireless charger. Barry Dyi Jonathan Hägerbrand Bruce O Dondogori

TVE-E Examensarbete 15 hp Juni Wireless charger. Barry Dyi Jonathan Hägerbrand Bruce O Dondogori TVE-E 18 005 Examensarbete 15 hp Juni 2018 Wireless charger Barry Dyi Jonathan Hägerbrand Bruce O Dondogori Abstract Wireless charger Barry Dyi Teknisk- naturvetenskaplig fakultet UTH-enheten Besöksadress:

More information

Master Op-Doc/Test Plan

Master Op-Doc/Test Plan Power Supply Master Op-Doc/Test Plan Define Engineering Specs Establish battery life Establish battery technology Establish battery size Establish number of batteries Establish weight of batteries Establish

More information

TVE-E Examensarbete 15 hp Juni Internet of Things. The smart home. Rasmus Söderström Martin J. Westman

TVE-E Examensarbete 15 hp Juni Internet of Things. The smart home. Rasmus Söderström Martin J. Westman TVE-E 18 008 Examensarbete 15 hp Juni 2018 Internet of Things The smart home Rasmus Söderström Martin J. Westman Abstract Internet of things Rasmus Söderström & Martin J. Westman Teknisk- naturvetenskaplig

More information

Motion Capture for Runners

Motion Capture for Runners Motion Capture for Runners Design Team 8 - Spring 2013 Members: Blake Frantz, Zhichao Lu, Alex Mazzoni, Nori Wilkins, Chenli Yuan, Dan Zilinskas Sponsor: Air Force Research Laboratory Dr. Eric T. Vinande

More information

GPS-Aided INS Datasheet Rev. 2.6

GPS-Aided INS Datasheet Rev. 2.6 GPS-Aided INS 1 GPS-Aided INS The Inertial Labs Single and Dual Antenna GPS-Aided Inertial Navigation System INS is new generation of fully-integrated, combined GPS, GLONASS, GALILEO and BEIDOU navigation

More information

Camera-based Autonomous Driving System

Camera-based Autonomous Driving System TVE 16 068 juni Examensarbete 15 hp Juni 2016 Camera-based Autonomous Driving System Josefine Bernberg Martin Hellkvist Erik Persson August Tynong Abstract Camera-based Autonomous Driving System Josefine

More information

CENG 5931 HW 5 Mobile Robotics Due March 5. Sensors for Mobile Robots

CENG 5931 HW 5 Mobile Robotics Due March 5. Sensors for Mobile Robots CENG 5931 HW 5 Mobile Robotics Due March 5 Sensors for Mobile Robots Dr. T. L. Harman: 281 283-3774 Office D104 For reports: Read HomeworkEssayRequirements on the web site and follow instructions which

More information

Reference Diagram IDG-300. Coriolis Sense. Low-Pass Sensor. Coriolis Sense. Demodulator Y-RATE OUT YAGC R LPY C LPy ±10% EEPROM TRIM.

Reference Diagram IDG-300. Coriolis Sense. Low-Pass Sensor. Coriolis Sense. Demodulator Y-RATE OUT YAGC R LPY C LPy ±10% EEPROM TRIM. FEATURES Integrated X- and Y-axis gyro on a single chip Factory trimmed full scale range of ±500 /sec Integrated low-pass filters High vibration rejection over a wide frequency range High cross-axis isolation

More information

GPS-Aided INS Datasheet Rev. 2.3

GPS-Aided INS Datasheet Rev. 2.3 GPS-Aided INS 1 The Inertial Labs Single and Dual Antenna GPS-Aided Inertial Navigation System INS is new generation of fully-integrated, combined L1 & L2 GPS, GLONASS, GALILEO and BEIDOU navigation and

More information

ASC IMU 7.X.Y. Inertial Measurement Unit (IMU) Description.

ASC IMU 7.X.Y. Inertial Measurement Unit (IMU) Description. Inertial Measurement Unit (IMU) 6-axis MEMS mini-imu Acceleration & Angular Rotation analog output 12-pin connector with detachable cable Aluminium housing Made in Germany Features Acceleration rate: ±2g

More information

CMPS09 - Tilt Compensated Compass Module

CMPS09 - Tilt Compensated Compass Module Introduction The CMPS09 module is a tilt compensated compass. Employing a 3-axis magnetometer and a 3-axis accelerometer and a powerful 16-bit processor, the CMPS09 has been designed to remove the errors

More information

If you want to use an inertial measurement system...

If you want to use an inertial measurement system... If you want to use an inertial measurement system...... which technical data you should analyse and compare before making your decision by Dr.-Ing. E. v. Hinueber, imar Navigation GmbH Keywords: inertial

More information

Range Sensing strategies

Range Sensing strategies Range Sensing strategies Active range sensors Ultrasound Laser range sensor Slides adopted from Siegwart and Nourbakhsh 4.1.6 Range Sensors (time of flight) (1) Large range distance measurement -> called

More information

GPS-Aided INS Datasheet Rev. 2.7

GPS-Aided INS Datasheet Rev. 2.7 1 The Inertial Labs Single and Dual Antenna GPS-Aided Inertial Navigation System INS is new generation of fully-integrated, combined GPS, GLONASS, GALILEO, QZSS and BEIDOU navigation and highperformance

More information

GPS-Aided INS Datasheet Rev. 3.0

GPS-Aided INS Datasheet Rev. 3.0 1 GPS-Aided INS The Inertial Labs Single and Dual Antenna GPS-Aided Inertial Navigation System INS is new generation of fully-integrated, combined GPS, GLONASS, GALILEO, QZSS, BEIDOU and L-Band navigation

More information

Accuracy Performance Test Methodology for Satellite Locators on Board of Trains Developments and results from the EU Project APOLO

Accuracy Performance Test Methodology for Satellite Locators on Board of Trains Developments and results from the EU Project APOLO ID No: 459 Accuracy Performance Test Methodology for Satellite Locators on Board of Trains Developments and results from the EU Project APOLO Author: Dipl. Ing. G.Barbu, Project Manager European Rail Research

More information

FLCS V2.1. AHRS, Autopilot, Gyro Stabilized Gimbals Control, Ground Control Station

FLCS V2.1. AHRS, Autopilot, Gyro Stabilized Gimbals Control, Ground Control Station AHRS, Autopilot, Gyro Stabilized Gimbals Control, Ground Control Station The platform provides a high performance basis for electromechanical system control. Originally designed for autonomous aerial vehicle

More information

Indoor Positioning by the Fusion of Wireless Metrics and Sensors

Indoor Positioning by the Fusion of Wireless Metrics and Sensors Indoor Positioning by the Fusion of Wireless Metrics and Sensors Asst. Prof. Dr. Özgür TAMER Dokuz Eylül University Electrical and Electronics Eng. Dept Indoor Positioning Indoor positioning systems (IPS)

More information

High Gain Advanced GPS Receiver

High Gain Advanced GPS Receiver High Gain Advanced GPS Receiver NAVSYS Corporation 14960 Woodcarver Road, Colorado Springs, CO 80921 Introduction The NAVSYS High Gain Advanced GPS Receiver (HAGR) is a digital beam steering receiver designed

More information

COVENANT UNIVERSITY NIGERIA TUTORIAL KIT OMEGA SEMESTER PROGRAMME: MECHANICAL ENGINEERING

COVENANT UNIVERSITY NIGERIA TUTORIAL KIT OMEGA SEMESTER PROGRAMME: MECHANICAL ENGINEERING COVENANT UNIVERSITY NIGERIA TUTORIAL KIT OMEGA SEMESTER PROGRAMME: MECHANICAL ENGINEERING COURSE: MCE 527 DISCLAIMER The contents of this document are intended for practice and leaning purposes at the

More information

10/21/2009. d R. d L. r L d B L08. POSE ESTIMATION, MOTORS. EECS 498-6: Autonomous Robotics Laboratory. Midterm 1. Mean: 53.9/67 Stddev: 7.

10/21/2009. d R. d L. r L d B L08. POSE ESTIMATION, MOTORS. EECS 498-6: Autonomous Robotics Laboratory. Midterm 1. Mean: 53.9/67 Stddev: 7. 1 d R d L L08. POSE ESTIMATION, MOTORS EECS 498-6: Autonomous Robotics Laboratory r L d B Midterm 1 2 Mean: 53.9/67 Stddev: 7.73 1 Today 3 Position Estimation Odometry IMUs GPS Motor Modelling Kinematics:

More information

Advanced Mechatronics 1 st Mini Project. Remote Control Car. Jose Antonio De Gracia Gómez, Amartya Barua March, 25 th 2014

Advanced Mechatronics 1 st Mini Project. Remote Control Car. Jose Antonio De Gracia Gómez, Amartya Barua March, 25 th 2014 Advanced Mechatronics 1 st Mini Project Remote Control Car Jose Antonio De Gracia Gómez, Amartya Barua March, 25 th 2014 Remote Control Car Manual Control with the remote and direction buttons Automatic

More information

Application Note. Communication between arduino and IMU Software capturing the data

Application Note. Communication between arduino and IMU Software capturing the data Application Note Communication between arduino and IMU Software capturing the data ECE 480 Team 8 Chenli Yuan Presentation Prep Date: April 8, 2013 Executive Summary In summary, this application note is

More information

Modulation schemes in ambient backscatter communication

Modulation schemes in ambient backscatter communication IT 17 079 Examensarbete 30 hp Oktober 2017 Modulation schemes in ambient backscatter communication Oliver Harms Institutionen för informationsteknologi Department of Information Technology Abstract Modulation

More information

Hydroacoustic Aided Inertial Navigation System - HAIN A New Reference for DP

Hydroacoustic Aided Inertial Navigation System - HAIN A New Reference for DP Return to Session Directory Return to Session Directory Doug Phillips Failure is an Option DYNAMIC POSITIONING CONFERENCE October 9-10, 2007 Sensors Hydroacoustic Aided Inertial Navigation System - HAIN

More information

IPRO 312: Unmanned Aerial Systems

IPRO 312: Unmanned Aerial Systems IPRO 312: Unmanned Aerial Systems Kay, Vlad, Akshay, Chris, Andrew, Sebastian, Anurag, Ani, Ivo, Roger Dr. Vural Diverse IPRO Group ECE MMAE BME ARCH CS Outline Background Approach Team Research Integration

More information

IMU: Get started with Arduino and the MPU 6050 Sensor!

IMU: Get started with Arduino and the MPU 6050 Sensor! 1 of 5 16-3-2017 15:17 IMU Interfacing Tutorial: Get started with Arduino and the MPU 6050 Sensor! By Arvind Sanjeev, Founder of DIY Hacking Arduino MPU 6050 Setup In this post, I will be reviewing a few

More information

Sensing. Autonomous systems. Properties. Classification. Key requirement of autonomous systems. An AS should be connected to the outside world.

Sensing. Autonomous systems. Properties. Classification. Key requirement of autonomous systems. An AS should be connected to the outside world. Sensing Key requirement of autonomous systems. An AS should be connected to the outside world. Autonomous systems Convert a physical value to an electrical value. From temperature, humidity, light, to

More information

INTRODUCTION TO VEHICLE NAVIGATION SYSTEM LECTURE 5.1 SGU 4823 SATELLITE NAVIGATION

INTRODUCTION TO VEHICLE NAVIGATION SYSTEM LECTURE 5.1 SGU 4823 SATELLITE NAVIGATION INTRODUCTION TO VEHICLE NAVIGATION SYSTEM LECTURE 5.1 SGU 4823 SATELLITE NAVIGATION AzmiHassan SGU4823 SatNav 2012 1 Navigation Systems Navigation ( Localisation ) may be defined as the process of determining

More information

Inertial Sensors. Ellipse 2 Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG

Inertial Sensors. Ellipse 2 Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG Ellipse 2 Series MINIATURE HIGH PERFORMANCE Inertial Sensors IMU AHRS MRU INS VG ITAR Free 0.1 RMS Navigation, Motion & Heave Sensing ELLIPSE SERIES sets up new standard for miniature and cost-effective

More information

Inertial Sensors. Ellipse 2 Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG

Inertial Sensors. Ellipse 2 Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG Ellipse 2 Series MINIATURE HIGH PERFORMANCE Inertial Sensors IMU AHRS MRU INS VG ITAR Free 0.1 RMS Navigation, Motion & Heave Sensing ELLIPSE SERIES sets up new standard for miniature and cost-effective

More information

Accident Sensor with Google Map Locator

Accident Sensor with Google Map Locator IJIRST International Journal for Innovative Research in Science & Technology Volume 2 Issue 10 March 2016 ISSN (online): 2349-6010 Accident Sensor with Google Map Locator Steffie Tom Keval Velip Aparna

More information

Sonic Distance Sensors

Sonic Distance Sensors Sonic Distance Sensors Introduction - Sound is transmitted through the propagation of pressure in the air. - The speed of sound in the air is normally 331m/sec at 0 o C. - Two of the important characteristics

More information

3DM -CV5-10 LORD DATASHEET. Inertial Measurement Unit (IMU) Product Highlights. Features and Benefits. Applications. Best in Class Performance

3DM -CV5-10 LORD DATASHEET. Inertial Measurement Unit (IMU) Product Highlights. Features and Benefits. Applications. Best in Class Performance LORD DATASHEET 3DM -CV5-10 Inertial Measurement Unit (IMU) Product Highlights Triaxial accelerometer, gyroscope, and sensors achieve the optimal combination of measurement qualities Smallest, lightest,

More information

3DM-GX3-45 Theory of Operation

3DM-GX3-45 Theory of Operation Theory of Operation 8500-0016 Revision 001 3DM-GX3-45 Theory of Operation www.microstrain.com Little Sensors, Big Ideas 2012 by MicroStrain, Inc. 459 Hurricane Lane Williston, VT 05495 United States of

More information

SENLUTION Miniature Angular & Heading Reference System The World s Smallest Mini-AHRS

SENLUTION Miniature Angular & Heading Reference System The World s Smallest Mini-AHRS SENLUTION Miniature Angular & Heading Reference System The World s Smallest Mini-AHRS MotionCore, the smallest size AHRS in the world, is an ultra-small form factor, highly accurate inertia system based

More information

Utility of Sensor Fusion of GPS and Motion Sensor in Android Devices In GPS- Deprived Environment

Utility of Sensor Fusion of GPS and Motion Sensor in Android Devices In GPS- Deprived Environment Utility of Sensor Fusion of GPS and Motion Sensor in Android Devices In GPS- Deprived Environment Amrit Karmacharya1 1 Land Management Training Center Bakhundol, Dhulikhel, Kavre, Nepal Tel:- +977-9841285489

More information

Devastator Tank Mobile Platform with Edison SKU:ROB0125

Devastator Tank Mobile Platform with Edison SKU:ROB0125 Devastator Tank Mobile Platform with Edison SKU:ROB0125 From Robot Wiki Contents 1 Introduction 2 Tutorial 2.1 Chapter 2: Run! Devastator! 2.2 Chapter 3: Expansion Modules 2.3 Chapter 4: Build The Devastator

More information

Distance Measurement of an Object by using Ultrasonic Sensors with Arduino and GSM Module

Distance Measurement of an Object by using Ultrasonic Sensors with Arduino and GSM Module IJSTE - International Journal of Science Technology & Engineering Volume 4 Issue 11 May 2018 ISSN (online): 2349-784X Distance Measurement of an Object by using Ultrasonic Sensors with Arduino and GSM

More information

Integrated Dual-Axis Gyro IDG-1004

Integrated Dual-Axis Gyro IDG-1004 Integrated Dual-Axis Gyro NOT RECOMMENDED FOR NEW DESIGNS. PLEASE REFER TO THE IDG-25 FOR A FUTIONALLY- UPGRADED PRODUCT APPLICATIONS GPS Navigation Devices Robotics Electronic Toys Platform Stabilization

More information

PHINS, An All-In-One Sensor for DP Applications

PHINS, An All-In-One Sensor for DP Applications DYNAMIC POSITIONING CONFERENCE September 28-30, 2004 Sensors PHINS, An All-In-One Sensor for DP Applications Yves PATUREL IXSea (Marly le Roi, France) ABSTRACT DP positioning sensors are mainly GPS receivers

More information

OS3D-FG MINIATURE ATTITUDE & HEADING REFERENCE SYSTEM MINIATURE 3D ORIENTATION SENSOR OS3D-P. Datasheet Rev OS3D-FG Datasheet rev. 2.

OS3D-FG MINIATURE ATTITUDE & HEADING REFERENCE SYSTEM MINIATURE 3D ORIENTATION SENSOR OS3D-P. Datasheet Rev OS3D-FG Datasheet rev. 2. OS3D-FG OS3D-FG MINIATURE ATTITUDE & HEADING REFERENCE SYSTEM MINIATURE 3D ORIENTATION SENSOR OS3D-P Datasheet Rev. 2.0 1 The Inertial Labs OS3D-FG is a multi-purpose miniature 3D orientation sensor Attitude

More information

Design and simulation of MEMS piezoelectric gyroscope

Design and simulation of MEMS piezoelectric gyroscope Available online at www.scholarsresearchlibrary.com European Journal of Applied Engineering and Scientific Research, 2014, 3 (2):8-12 (http://scholarsresearchlibrary.com/archive.html) ISSN: 2278 0041 Design

More information

SPEEDBOX Technical Datasheet

SPEEDBOX Technical Datasheet SPEEDBOX Technical Datasheet Race Technology Limited, 2008 Version 1.1 1. Introduction... 3 1.1. Product Overview... 3 1.2. Applications... 3 1.3. Standard Features... 3 2. Port / Connector details...

More information

Implementation of an Accelerometer Transverse Sensitivity Measurement System. By: Ian Veldman 3 to 5 September 2012

Implementation of an Accelerometer Transverse Sensitivity Measurement System. By: Ian Veldman 3 to 5 September 2012 Implementation of an Accelerometer Transverse Sensitivity Measurement System By: Ian Veldman 3 to 5 September 2012 NMISA 2012 Overview Introduction Transverse Sensitivity System description Measurement

More information

1 General Information... 2

1 General Information... 2 Release Note Topic : u-blox M8 Flash Firmware 3.01 UDR 1.00 UBX-16009439 Author : ahaz, yste, amil Date : 01 June 2016 We reserve all rights in this document and in the information contained therein. Reproduction,

More information

UNIT 1 - introduction to GPS

UNIT 1 - introduction to GPS UNIT 1 - introduction to GPS 1. GPS SIGNAL Each GPS satellite transmit two signal for positioning purposes: L1 signal (carrier frequency of 1,575.42 MHz). Modulated onto the L1 carrier are two pseudorandom

More information

Industrial Sensors. Proximity Mechanical Optical Inductive/Capacitive. Position/Velocity Potentiometer LVDT Encoders Tachogenerator

Industrial Sensors. Proximity Mechanical Optical Inductive/Capacitive. Position/Velocity Potentiometer LVDT Encoders Tachogenerator Proximity Mechanical Optical Inductive/Capacitive Position/Velocity Potentiometer LVDT Encoders Tachogenerator Force/Pressure Vibration/acceleration Industrial Sensors 1 Definitions Accuracy: The agreement

More information

5. Transducers Definition and General Concept of Transducer Classification of Transducers

5. Transducers Definition and General Concept of Transducer Classification of Transducers 5.1. Definition and General Concept of Definition The transducer is a device which converts one form of energy into another form. Examples: Mechanical transducer and Electrical transducer Electrical A

More information

HAND GESTURE CONTROLLED ROBOT USING ARDUINO

HAND GESTURE CONTROLLED ROBOT USING ARDUINO HAND GESTURE CONTROLLED ROBOT USING ARDUINO Vrushab Sakpal 1, Omkar Patil 2, Sagar Bhagat 3, Badar Shaikh 4, Prof.Poonam Patil 5 1,2,3,4,5 Department of Instrumentation Bharati Vidyapeeth C.O.E,Kharghar,Navi

More information

MICRO YAW RATE SENSORS

MICRO YAW RATE SENSORS 1 MICRO YAW RATE SENSORS FIELD OF THE INVENTION This invention relates to micro yaw rate sensors suitable for measuring yaw rate around its sensing axis. More particularly, to micro yaw rate sensors fabricated

More information

GPS data correction using encoders and INS sensors

GPS data correction using encoders and INS sensors GPS data correction using encoders and INS sensors Sid Ahmed Berrabah Mechanical Department, Royal Military School, Belgium, Avenue de la Renaissance 30, 1000 Brussels, Belgium sidahmed.berrabah@rma.ac.be

More information

MXD7210GL/HL/ML/NL. Low Cost, Low Noise ±10 g Dual Axis Accelerometer with Digital Outputs

MXD7210GL/HL/ML/NL. Low Cost, Low Noise ±10 g Dual Axis Accelerometer with Digital Outputs FEATURES Low cost Resolution better than 1milli-g at 1Hz Dual axis accelerometer fabricated on a monolithic CMOS IC On chip mixed signal processing No moving parts; No loose particle issues >50,000 g shock

More information

Inertial Sensors. Ellipse Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG

Inertial Sensors. Ellipse Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG Ellipse Series MINIATURE HIGH PERFORMANCE Inertial Sensors IMU AHRS MRU INS VG ITAR Free 0.1 RMS Navigation, Motion & Heave Sensing ELLIPSE SERIES sets up new standard for miniature and cost-effective

More information

OughtToPilot. Project Report of Submission PC128 to 2008 Propeller Design Contest. Jason Edelberg

OughtToPilot. Project Report of Submission PC128 to 2008 Propeller Design Contest. Jason Edelberg OughtToPilot Project Report of Submission PC128 to 2008 Propeller Design Contest Jason Edelberg Table of Contents Project Number.. 3 Project Description.. 4 Schematic 5 Source Code. Attached Separately

More information

Recent Progress in the Development of On-Board Electronics for Micro Air Vehicles

Recent Progress in the Development of On-Board Electronics for Micro Air Vehicles Recent Progress in the Development of On-Board Electronics for Micro Air Vehicles Jason Plew Jason Grzywna M. C. Nechyba Jason@mil.ufl.edu number9@mil.ufl.edu Nechyba@mil.ufl.edu Machine Intelligence Lab

More information

Experiment on signal filter combinations for the analysis of information from inertial measurement units in AOCS

Experiment on signal filter combinations for the analysis of information from inertial measurement units in AOCS Journal of Physics: Conference Series PAPER OPEN ACCESS Experiment on signal filter combinations for the analysis of information from inertial measurement units in AOCS To cite this article: Maurício N

More information

The below identified patent application is available for licensing. Requests for information should be addressed to:

The below identified patent application is available for licensing. Requests for information should be addressed to: DEPARTMENT OF THE NAVY OFFICE OF COUNSEL NAVAL UNDERSEA WARFARE CENTER DIVISION 1176 HOWELL STREET NEWPORT Rl 02841-1708 IN REPLY REFER TO Attorney Docket No. 300001 25 February 2016 The below identified

More information

Procedure, Field Replacement, PCU Kit, 6003A/6004, 2406 & 4003A

Procedure, Field Replacement, PCU Kit, 6003A/6004, 2406 & 4003A 1. Brief Summary: Troubleshooting document for diagnosing a fault with and replacing the PCU assembly on the 6003A/6004, 2406 & 4003A series antennas. 2. Checklist: Verify Initialization N0 Parameter Pedestal

More information

Rocking Drones with Intentional Sound Noise on Gyroscopic Sensors

Rocking Drones with Intentional Sound Noise on Gyroscopic Sensors USENIX Security Symposium 2015 Rocking Drones with Intentional Sound Noise on Gyroscopic Sensors 2015. 08. 14. Yunmok Son, Hocheol Shin, Dongkwan Kim, Youngseok Park, Juhwan Noh, Kibum Choi, Jungwoo Choi,

More information

PCB & Circuit Designing (Summer Training Program) 6 Weeks/ 45 Days PRESENTED BY

PCB & Circuit Designing (Summer Training Program) 6 Weeks/ 45 Days PRESENTED BY PCB & Circuit Designing (Summer Training Program) 6 Weeks/ 45 Days PRESENTED BY RoboSpecies Technologies Pvt. Ltd. Office: D-66, First Floor, Sector- 07, Noida, UP Contact us: Email: stp@robospecies.com

More information

Sensors and Sensing Motors, Encoders and Motor Control

Sensors and Sensing Motors, Encoders and Motor Control Sensors and Sensing Motors, Encoders and Motor Control Todor Stoyanov Mobile Robotics and Olfaction Lab Center for Applied Autonomous Sensor Systems Örebro University, Sweden todor.stoyanov@oru.se 05.11.2015

More information

Frequency-Modulated Continuous-Wave Radar (FM-CW Radar)

Frequency-Modulated Continuous-Wave Radar (FM-CW Radar) Frequency-Modulated Continuous-Wave Radar (FM-CW Radar) FM-CW radar (Frequency-Modulated Continuous Wave radar = FMCW radar) is a special type of radar sensor which radiates continuous transmission power

More information

Hardware Modeling and Machining for UAV- Based Wideband Radar

Hardware Modeling and Machining for UAV- Based Wideband Radar Hardware Modeling and Machining for UAV- Based Wideband Radar By Ryan Tubbs Abstract The Center for Remote Sensing of Ice Sheets (CReSIS) at the University of Kansas is currently implementing wideband

More information

AUTOMATION OF 3D MEASUREMENTS FOR THE FINAL ASSEMBLY STEPS OF THE LHC DIPOLE MAGNETS

AUTOMATION OF 3D MEASUREMENTS FOR THE FINAL ASSEMBLY STEPS OF THE LHC DIPOLE MAGNETS IWAA2004, CERN, Geneva, 4-7 October 2004 AUTOMATION OF 3D MEASUREMENTS FOR THE FINAL ASSEMBLY STEPS OF THE LHC DIPOLE MAGNETS M. Bajko, R. Chamizo, C. Charrondiere, A. Kuzmin 1, CERN, 1211 Geneva 23, Switzerland

More information

PCB & Circuit Designing

PCB & Circuit Designing (Summer Training Program) 4 Weeks/30 Days PRESENTED BY RoboSpecies Technologies Pvt. Ltd. Office: W-53G, Sector-11, Noida-201301, U.P. Contact us: Email: stp@robospecies.com Website: www.robospecies.com

More information

Robot Navigation System with RFID and Ultrasonic Sensors A.Seshanka Venkatesh 1, K.Vamsi Krishna 2, N.K.R.Swamy 3, P.Simhachalam 4

Robot Navigation System with RFID and Ultrasonic Sensors A.Seshanka Venkatesh 1, K.Vamsi Krishna 2, N.K.R.Swamy 3, P.Simhachalam 4 Robot Navigation System with RFID and Ultrasonic Sensors A.Seshanka Venkatesh 1, K.Vamsi Krishna 2, N.K.R.Swamy 3, P.Simhachalam 4 B.Tech., Student, Dept. Of EEE, Pragati Engineering College,Surampalem,

More information

Integrated Dual-Axis Gyro IDG-1215

Integrated Dual-Axis Gyro IDG-1215 Integrated Dual-Axis Gyro FEATURES Integrated X- and Y-axis gyros on a single chip ±67 /s full-scale range 15m/ /s sensitivity Integrated amplifiers and low-pass filter Auto Zero function Integrated reset

More information

Cooperative localization (part I) Jouni Rantakokko

Cooperative localization (part I) Jouni Rantakokko Cooperative localization (part I) Jouni Rantakokko Cooperative applications / approaches Wireless sensor networks Robotics Pedestrian localization First responders Localization sensors - Small, low-cost

More information

OPERATION AND MAINTENANCE MANUAL TRIAXIAL ACCELEROMETER MODEL PA-23 STOCK NO

OPERATION AND MAINTENANCE MANUAL TRIAXIAL ACCELEROMETER MODEL PA-23 STOCK NO OPERATION AND MAINTENANCE MANUAL TRIAXIAL ACCELEROMETER MODEL PA-23 STOCK NO. 990-60700-9801 GEOTECH INSTRUMENTS, LLC 10755 SANDEN DRIVE DALLAS, TEXAS 75238-1336 TEL: (214) 221-0000 FAX: (214) 343-4400

More information

2D Floor-Mapping Car

2D Floor-Mapping Car CDA 4630 Embedded Systems Final Report Group 4: Camilo Moreno, Ahmed Awada ------------------------------------------------------------------------------------------------------------------------------------------

More information

High Precision GNSS in Automotive

High Precision GNSS in Automotive High Precision GNSS in Automotive Jonathan Auld, VP Engineering and Safety 6, March, 2018 2 Global OEM Positioning Solutions and Services for Land, Sea, and Air. GNSS in Automotive Today Today the primary

More information

Sensor set stabilization system for miniature UAV

Sensor set stabilization system for miniature UAV Sensor set stabilization system for miniature UAV Wojciech Komorniczak 1, Tomasz Górski, Adam Kawalec, Jerzy Pietrasiński Military University of Technology, Institute of Radioelectronics, Warsaw, POLAND

More information

Team Autono-Mo. Jacobia. Department of Computer Science and Engineering The University of Texas at Arlington

Team Autono-Mo. Jacobia. Department of Computer Science and Engineering The University of Texas at Arlington Department of Computer Science and Engineering The University of Texas at Arlington Team Autono-Mo Jacobia Architecture Design Specification Team Members: Bill Butts Darius Salemizadeh Lance Storey Yunesh

More information

High Performance Advanced MEMS Industrial & Tactical Grade Inertial Measurement Units

High Performance Advanced MEMS Industrial & Tactical Grade Inertial Measurement Units High Performance Advanced MEMS Industrial & Tactical Grade Inertial Measurement Units ITAR-free Small size, low weight, low cost 1 deg/hr Gyro Bias in-run stability Datasheet Rev.2.0 5 μg Accelerometers

More information

Wide Area Wireless Networked Navigators

Wide Area Wireless Networked Navigators Wide Area Wireless Networked Navigators Dr. Norman Coleman, Ken Lam, George Papanagopoulos, Ketula Patel, and Ricky May US Army Armament Research, Development and Engineering Center Picatinny Arsenal,

More information

Extended Kalman Filtering

Extended Kalman Filtering Extended Kalman Filtering Andre Cornman, Darren Mei Stanford EE 267, Virtual Reality, Course Report, Instructors: Gordon Wetzstein and Robert Konrad Abstract When working with virtual reality, one of the

More information

3DM-GX4-45 LORD DATASHEET. GPS-Aided Inertial Navigation System (GPS/INS) Product Highlights. Features and Benefits. Applications

3DM-GX4-45 LORD DATASHEET. GPS-Aided Inertial Navigation System (GPS/INS) Product Highlights. Features and Benefits. Applications LORD DATASHEET 3DM-GX4-45 GPS-Aided Inertial Navigation System (GPS/INS) Product Highlights High performance integd GPS receiver and MEMS sensor technology provide direct and computed PVA outputs in a

More information

Navigation problem. Jussi Suomela

Navigation problem. Jussi Suomela Navigation problem Define internal navigation sensors for a ground robot with car type kinematics (4 wheels + ackerman steering + rear wheel drive) Sensors? Where? Why? ~ 15-20 min. Describe your system

More information

TigreSAT 2010 &2011 June Monthly Report

TigreSAT 2010 &2011 June Monthly Report 2010-2011 TigreSAT Monthly Progress Report EQUIS ADS 2010 PAYLOAD No changes have been done to the payload since it had passed all the tests, requirements and integration that are necessary for LSU HASP

More information

Marine Debris Cleaner Phase 1 Navigation

Marine Debris Cleaner Phase 1 Navigation Southeastern Louisiana University Marine Debris Cleaner Phase 1 Navigation Submitted as partial fulfillment for the senior design project By Ryan Fabre & Brock Dickinson ET 494 Advisor: Dr. Ahmad Fayed

More information

being developed. Most up and coming drugs are extremely expensive and limited in

being developed. Most up and coming drugs are extremely expensive and limited in Introduction In the pharmaceutical industry, it is important to know fluid properties of the drug being developed. Most up and coming drugs are extremely expensive and limited in quantity. A device that

More information

Inertial Sensors. Ellipse Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG

Inertial Sensors. Ellipse Series MINIATURE HIGH PERFORMANCE. Navigation, Motion & Heave Sensing IMU AHRS MRU INS VG Ellipse Series MINIATURE HIGH PERFORMANCE Inertial Sensors IMU AHRS MRU INS VG ITAR Free 0.2 RMS Navigation, Motion & Heave Sensing ELLIPSE SERIES sets up new standard for miniature and cost-effective

More information

EGG 101L INTRODUCTION TO ENGINEERING EXPERIENCE

EGG 101L INTRODUCTION TO ENGINEERING EXPERIENCE EGG 101L INTRODUCTION TO ENGINEERING EXPERIENCE LABORATORY 6: INTRODUCTION TO BREADBOARDS DEPARTMENT OF ELECTRICAL AND COMPUTER ENGINEERING UNIVERSITY OF NEVADA, LAS VEGAS GOAL: This section introduces

More information

HG1120 INERTIAL MEASUREMENT UNIT (IMU) Installation and Interface Manual

HG1120 INERTIAL MEASUREMENT UNIT (IMU) Installation and Interface Manual HG1120 INERTIAL MEASUREMENT UNIT (IMU) Installation and Interface Manual HG1120 Installation and Interface Manual aerospace.honeywell.com/hg1120 2 Table of Contents 4 5 6 15 17 17 Honeywell Industrial

More information

Dual-Axis, High-g, imems Accelerometers ADXL278

Dual-Axis, High-g, imems Accelerometers ADXL278 FEATURES Complete dual-axis acceleration measurement system on a single monolithic IC Available in ±35 g/±35 g, ±50 g/±50 g, or ±70 g/±35 g output full-scale ranges Full differential sensor and circuitry

More information

MXD6125Q. Ultra High Performance ±1g Dual Axis Accelerometer with Digital Outputs FEATURES

MXD6125Q. Ultra High Performance ±1g Dual Axis Accelerometer with Digital Outputs FEATURES Ultra High Performance ±1g Dual Axis Accelerometer with Digital Outputs MXD6125Q FEATURES Ultra Low Noise 0.13 mg/ Hz typical RoHS compliant Ultra Low Offset Drift 0.1 mg/ C typical Resolution better than

More information

Classical Control Based Autopilot Design Using PC/104

Classical Control Based Autopilot Design Using PC/104 Classical Control Based Autopilot Design Using PC/104 Mohammed A. Elsadig, Alneelain University, Dr. Mohammed A. Hussien, Alneelain University. Abstract Many recent papers have been written in unmanned

More information

QUADROTOR ROLL AND PITCH STABILIZATION USING SYSTEM IDENTIFICATION BASED REDESIGN OF EMPIRICAL CONTROLLERS

QUADROTOR ROLL AND PITCH STABILIZATION USING SYSTEM IDENTIFICATION BASED REDESIGN OF EMPIRICAL CONTROLLERS QUADROTOR ROLL AND PITCH STABILIZATION USING SYSTEM IDENTIFICATION BASED REDESIGN OF EMPIRICAL CONTROLLERS ANIL UFUK BATMAZ 1, a, OVUNC ELBIR 2,b and COSKU KASNAKOGLU 3,c 1,2,3 Department of Electrical

More information

1 Introduction. 2 Embedded Electronics Primer. 2.1 The Arduino

1 Introduction. 2 Embedded Electronics Primer. 2.1 The Arduino Beginning Embedded Electronics for Botballers Using the Arduino Matthew Thompson Allen D. Nease High School matthewbot@gmail.com 1 Introduction Robotics is a unique and multidisciplinary field, where successful

More information

9DoF Sensor Stick Hookup Guide

9DoF Sensor Stick Hookup Guide Page 1 of 5 9DoF Sensor Stick Hookup Guide Introduction The 9DoF Sensor Stick is an easy-to-use 9 degrees of freedom IMU. The sensor used is the LSM9DS1, the same sensor used in the SparkFun 9 Degrees

More information

Profiling Radiometer for Atmospheric and Cloud Observations PRACO

Profiling Radiometer for Atmospheric and Cloud Observations PRACO Profiling Radiometer for Atmospheric and Cloud Observations PRACO Boulder Environmental Sciences and Technology BEST Small startup company, established in 2006 Focused on radiometry ground based and airborne

More information

A Model Based Approach for Human Recognition and Reception by Robot

A Model Based Approach for Human Recognition and Reception by Robot 16 MHz ARDUINO A Model Based Approach for Human Recognition and Reception by Robot Prof. R. Sunitha Department Of ECE, N.R.I Institute Of Technology, J.N.T University, Kakinada, India. V. Sai Krishna,

More information

Physics 309 Lab 3 Bipolar junction transistor

Physics 309 Lab 3 Bipolar junction transistor Physics 39 Lab 3 Bipolar junction transistor The purpose of this third lab is to learn the principles of operation of a bipolar junction transistor, how to characterize its performances, and how to use

More information

Heuristic Drift Reduction for Gyroscopes in Vehicle Tracking Applications

Heuristic Drift Reduction for Gyroscopes in Vehicle Tracking Applications White Paper Heuristic Drift Reduction for Gyroscopes in Vehicle Tracking Applications by Johann Borenstein Last revised: 12/6/27 ABSTRACT The present invention pertains to the reduction of measurement

More information

Speech, Hearing and Language: work in progress. Volume 12

Speech, Hearing and Language: work in progress. Volume 12 Speech, Hearing and Language: work in progress Volume 12 2 Construction of a rotary vibrator and its application in human tactile communication Abbas HAYDARI and Stuart ROSEN Department of Phonetics and

More information

Training Schedule. Robotic System Design using Arduino Platform

Training Schedule. Robotic System Design using Arduino Platform Training Schedule Robotic System Design using Arduino Platform Session - 1 Embedded System Design Basics : Scope : To introduce Embedded Systems hardware design fundamentals to students. Processor Selection

More information

Geografisk information Gränssnitt för positionering (ISO 19116:2004, IDT) Geographic information Positioning services (ISO 19116:2004, IDT)

Geografisk information Gränssnitt för positionering (ISO 19116:2004, IDT) Geographic information Positioning services (ISO 19116:2004, IDT) SVENSK STANDARD Fastställd 2004-09-24 Utgåva 1 Geografisk information Gränssnitt för positionering (ISO 19116:2004, IDT) Geographic information Positioning services (ISO 19116:2004, IDT) ICS 35.020; 35.240.01;

More information

Single-Axis, High-g, imems Accelerometers ADXL193

Single-Axis, High-g, imems Accelerometers ADXL193 Single-Axis, High-g, imems Accelerometers ADXL193 FEATURES Complete acceleration measurement system on a single monolithic IC Available in ±120 g or ±250 g output full-scale ranges Full differential sensor

More information