Application and Analysis of a Robust Trajectory Tracking Controller for Under-Characterized Autonomous Vehicles

Size: px
Start display at page:

Download "Application and Analysis of a Robust Trajectory Tracking Controller for Under-Characterized Autonomous Vehicles"

Transcription

1 Application and Analysis of a Robust Trajectory Tracking Controller for Under-Characterized Autonoous Vehicles Melonee Wise and John Hsu Abstract When developing path tracking controllers for autonoous vehicles the dynaic constraints of the vehicle are a critical factor. It is therefore necessary to ensure that all tracking trajectories produced by the controller are sooth and continuous. In this paper, a path tracking controller is proposed and ipleented on an experiental autonoous vehicle. This tracking ethod decouples the low-level heading and steering control of the vehicle fro the ain tracking controller, therefore requiring less vehicle characterization. The results of this paper will show this ethod yields a RMS.25 cross-track error with little to no vehicle characterization. I. INTRODUCTION With the recent activity in autonoous vehicle developent at the DARPA Urban Challenge, any researchers ([], [], [2]) are focusing on developing robust path tracking controllers. These controllers either are part of the path planning or incorporate the low-level steering and speed controllers. Both approaches require extensive vehicle characterization, [2], and repeated calibration runs to ensure stability and accuracy. Additionally ost of the control odels for wheeled obile robots and car-like vehicles are based around the bicycle odel which does not account for tire slippage, suspension stiffness, engine throttle delay, etc. In this paper the tracking controller is treated separately fro the heading and speed controller of the vehicle. This pushes the vehicle characterization into the low level controller so that the vehicle dynaics can be odeled using the bicycle odel. This allows for siplified ipleentation and testing of the tracking algorith. For exaple, adopting the current tracking algorith for driving the vehicle in reverse requires inial changes to the algorith itself; whereas careful characterization of the reverse steering characteristics are required for previously cited ethods. II. THE PATH TRACKING PROBLEM A. Proble Description Given a planar two diensional trajectory coposed of discrete GPS waypoints, the path follower is defined as a odule which coands the vehicle to follow the specified path with soe predefined tracking accuracy and passenger cofort. Given the uncertainties exhibited by the environent (uneven paveents, slippage, etc.) and nonlinear response behaviors of an under-characterized autonoous vehicle, a robust path follower ust be able to track soothly This work was supported by Willow Garage M. Wise is a Senior Engineer with Willow Garage, Menlo Park, CA 9425, USA wise@willowgarage.co J. Hsu is a Senior Engineer with Willow Garage, Menlo Park, CA 9425, USA johnhsu@willowgarage.co and consistently to the target trajectory. Through robust path tracking, the gap between high-level path planning and lowlevel hardware control of an autonoous vehicle is bridged. ) Coordinate Syste: The body frae coordinates, shown in Fig., is a right handed coordinate syste with y-axis pointing forward and z-axis pointing upwards. The rotational degrees of freedos adheres to the right-hand rule with the exception of the yaw angle. Where yaw is lefthanded with respect to the z-axis so it has the sae rotational direction as the heading convention where corresponds to north and 9 corresponds to east. Fig.. Body Frae Axis Syste: x, y and z axis of the vehicle s body frae, with rotational degrees of freedo, pitch, roll and yaw. A. Governing Equations III. CONTROL DESIGN In order to track soothly to a given trajectory, a path ust be coputed fro a given initial location and heading to soe target point and heading on the desired trajectory, Fig. 2. The in-line, cross-track, and heading errors, (e x,e y,e θ ) are given by e x = (x t x c )cos(θ t ) + (y t y c )sin(θ t ) () e y = (x t x c )sin(θ t ) + (y t y c )cos(θ t ) (2) e θ = θ t θ c. (3) Once the path errors are deterined a cubic polynoial, (4), can be used to satisfy dynaic constraints iposed by

2 dv b dt = Av b + (B v b ) ax(,e x ) (D + v b ) ax(, e x ) (7) This results in an acceleration control law of the following for a ax if v s /dt > a ax a control = a ax if v s /dt < a ax. (8) v s /dt otherwise The result of this control law can be used to control the speed of the vehicle and therefore close the loop around the in-line path error. Fig. 2. Heading and error definitions. vehicle dynaics and waypoint path planning (i.e. position, heading, and turning)[]. The cubic polynoial is a function of the cross track error, e y, and the constant c which dictates the steepness of the approach, as seen in Fig. 3. B. Ipleentation The vehicle testing platfor is an autonoized 26 Ford Escape Hybrid. The basic software architecture of this vehicle is presented in Fig. 4; whereas the details of the controller hardware ipleentations are described in section IV-B.. P(x p ) = c(x p ) 3 sign(e y ) (4) Fro (4) the approach path heading angle θ p, can be deterined, where θ t is the target heading on the desired path. Once the approach path heading angle is calculated, the approach path heading angle can be directly used to steer the vehicle via a heading controller. ( ey ) 2/3 θ p = θ t arctan(3c sign(ey )) (5) c Fig. 4. Message Passing Architecture (MPA) construct. Fig. 3. The effect of the paraeter c on the approach path. Since the current approach needs to track to a specific GPS waypoint at every given tie step, a controller for inline position tracking is needed as well as for cross-track position tracking. To extend the controller for in-line error tracking, a odified bang-bang controller (7) is used. The estiated state velocity of the vehicle is given by v s = ė x + (2a ax e x ) /2 v b. (6) where a ax is the axiu acceleration of the vehicle, and v b is scalar value. By odifying the sign function of the bang-bang controller, the estiated state velocity changes soothly satisfying the dynaic constraints of the vehicle. The ain software coponents of our autonoous vehicle syste are coposed of a path planner, a path follower, Message Passing Architecture (MPA), several independent sensor data processors and a few low-level control interfaces. The backbone of the software architecture is the MPA which allows hardware and software driven processes to counicate between each other by passing essages robustly and efficiently through the use of shared eory. The basic structure of MPA is a ring-buffer queue, where all software processes can independently retrieve data chronologically or can insert new data to the end of the queue. The input to the path follower coes fro the path planner odule, where a target path is specified by a list of waypoints in the global frae in the for of (9). x i = x i y i v i t i θ i ;i =,n (9)

3 The velocity profile (v i ) is assigned to the list of waypoints based on hardware and environental constraints such as available torque, path curvature, terrain roughness and posted speed liits. Given that the velocity profile has been deterined, a tie stap (t i ) is assigned to each eleent of the waypoint list along the target trajectory. The path planner odule sends each waypoint of the target path to the path follower based on the corresponding tie stap. Since the target waypoints are a set of discrete path locations, siple two-diensional linear interpolation based on tie is used to generate each target waypoint sent to the path follower. The in-line and cross-track tracking errors, (e x,e y ), are defined by the distance fro the vehicle s current position to the target waypoint at every tie step. Given soe finite tracking error, a robust path follower ust be able to generate a sooth, stable and convergent landing curve to guide the vehicle back towards the intended path. Based on the tracking errors, the path follower coputes the corresponding landing curve, then outputs velocity (v c ) and heading (θ c ) coands to the MPA structure. The velocity and steering coands are picked up by the vehicle s low-level PID controllers. Separate PID loops for speed and heading control are ipleented in the current vehicle platfor. The steering PID controller deterines the steering angle based on input heading angle. While two separate PID controllers for the accelerator and the brake works together to aintain the desired velocity. Additionally, all low-level hardware controller PID s are written in C/C++ languages with an average update rate of around Hz. IV. SIMULATIONS AND EXPERIMENTS A. Siulation ) Siulator Overview: The siulation environent is created using the open source Gazebo Project ( A snap shot of the siulator in action is shown in Fig. 5. A Gazebo vehicle odel has been created with siilar ass properties and acceleration/braking/steering characteristics as the actual vehicle. 2) Siulator Results: Given a test path shown in Fig. 6, the speed profile and the resulting ground tracks and crosstrack errors of the siulated runs are plotted in Figs.7(a) 7(c). The speed profile in Fig. 7(c) has been generated by liiting the overall acceleration and ultiplying the result by a weighting function proportional to the inverse of the path curvature; thus the lateral acceleration at corners are liited by predefined constants. Fro Fig.7(b) it is evident that the cross-track error has axiu agnitude of.2, while in-line tracking error spans ±.5. The reason that the in-line errors are extreely large in coparison to crosstrack errors is due to the fact that the vehicle was tuned in favor of passenger cofort rather than tracking accuracy. By increasing paraeter a ax in (8), the tracking accuracy can be iproved draatically. Unfortunately, increasing in-line tracking accuracy results in noticeably ore aggressive acceleration and braking behavior of the vehicle. In particular, Fig. 5. A Snapshot of the Siulator Fig. 6. Saple Test Path. the speed control odule tends to alternate rapidly between accelerating and braking odes. B. Experients ) Control Hardware Overview: The experiental platfor is a Ford Escape Hybrid shown in Fig. 8, which has been reverse engineered for autonoous control. The existing core systes (steering, gear shift, accelerator, brakes, etc.) are actuated electronically which allows for easy interface with and control of these systes. The vehicle is controlled by four custo 6Bit dspic Microcontroller boards, shown in Fig. 9, which interface with the existing Ford Escape coputer hardware. The controllers are inserted in line, using standard Ford parts, to interface with the existing systes for easy installation, repair, or reoval. Four odules are daisy chained together via a CAN bus and control the gear shift, accelerator, brakes, and steering.

4 2 Car Ground Track Coand Path 3 Fig. 8. Experiental Ford Escape Hybrid (a) Siulation Ground Tracks.5 e x e y tracking errors ().5.5 Fig. 9. Low Level Control Boards speed (/s) tie (sec) (b) Siulation Tracking Errors GPS Speed Path Velocity Coand tie (sec) (c) Siulation Speed Profile Fig. 7. Siulation results tracking path in Fig. 6. i. Gear Shift Module: The gear shift odule not only electronically selects the drive gear of the vehicle; the odule also dictates whether the vehicle is in driver or autonoous ode. This is a design feature built into the syste to quickly switch the vehicle fro huan driver ode to coputer controlled ode. The gear shift odule listens on the vehicle s CAN bus to deterine the shifter position of the vehicle When the vehicle is in low gear the coputer is able to send coands, over the coputer CAN bus, controlling the gear position and other vehicle systes. ii. Accelerator Module: The accelerator odule controls the speed of the vehicle and the turn signals. A RPM sensor in the transission deterines the vehicle speed and broadcasts the speed on the vehicle CAN bus. The accelerator onitors the speed and uses a PID controller to aintain velocity set points dictated by the vehicle coputer. The turn signals are turned on using a siple MOSFET switch that is activated when the odule receives turn signal coand fro the coputer. iii. Brake Module: The brake odule is responsible for sending brake control signals, and turning the brake lights on and off. The Ford Escape brakes are controlled using PWM pulses that increent and decreent an internal counter to increase and decrease the braking force. A PID controller in the brake odule receives set point coands fro the vehicle s coputer and sends

5 pulses to the vehicle accordingly. The brake lights are also turned on using a siple MOSFET switch that is activated when the odule receives a brake signal. iv. Steering Module: The steering odule uses the power assist otor in the Ford Escape to control the steering wheel position. A string potentioeter was added to the steering colun to obtain accurate steering angles. The Ford Escape power assist otor relies on a torque sensor in the steering syste to deterine the aount of assist (torque) required to ove the steering wheel. Siilar to the brakes, a PID controller in the steering odule receives set point coands fro the vehicle s coputer and sends torque values to the vehicle s power assist otor accordingly Car Ground Track Coand Path 2) Sensor Hardware Overview: The vehicle is localized using an integrated senor network that utilizes the vehicle on board diagnostics and the NovAtel SPAN (Synchronized Position Attitude and Navigation) syste. i. On Board Diagnostics: The Ford Escape Hybrid coes equipped with Hall effect sensors on all four wheels and a transission RPM sensor transit data to the vehicle CAN bus. The on board diagnostic port on the vehicle can be used to read the CAN bus which transits vehicle sensor data at a rate of 2Hz. This data is used for siple odoetry and verifying the current position of the vehicle. ii. NovAtel SPAN: The NovAtel SPAN syste integrates a GPS (NovAtel GPS-72L) and IMU (HG7 SPAN62). The GPS-72L receives L-Band frequencies fro the OniSTAR correction service and receives updates at a rate of Hz. The HG7 SPAN62 IMU is a cobined laser ring gyro and acceleroeter with an update rate of Hz. Cobining these two coponents the NovAtel SPAN syste has a published accuracy of. and a second outage accuracy of.39. 3) Experiental Trials & Results: Fig. shows the results of tracking to the test path in Fig.6 using the current algorith in our actual test vehicle. As a result of discrepancies between vehicle dynaics and siulator odel dynaics, the axiu cross-track errors have increases fro.2 to.4 for the actual test vehicle runs while the in-line tracking errors on the actual test vehicle have reained near the sae levels as the siulation runs. An additional test case was perfored to exaine the perforance of the path tracking algorith under higher lateral acceleration loads. A slalo path as shown in Fig. was given to the path follower to track, the results of tracking a ore aggressive path are deonstrated in Fig.2. It is evident in Fig.2(b) that cross-track errors are increased while in-line tracking errors reain unchanged. The increase in cross-track error is due to the fact that the current path tracking algorith is unable to handle lateral sliding otions caused by excessive lateral steering otions. tracking errors () speed (/s) (a) Test Path Ground Tracks tie (sec) (b) Test Path Tracking Errors GPS Speed Path Velocity Coand tie (sec) Fig.. (c) Test Path Speed Profile Test Path Tracking Perforance Results e x e y

6 Fig.. Slalo Path. V. CONCLUSIONS AND FUTURE WORKS A. Conclusions The derivation, ipleentation and test results of a robust and stable path tracking algorith are presented in this paper. The current path tracking schee is well behaved and has sub-eter accuracy without the need for detailed characterization of vehicle dynaics. Even when pushed to the liits, as deonstrated in the slalo test case, the current path tracking algorith is able to track the target path, with soe sacrifice in accuracy, but without exhibiting any undesirable instabilities. B. Future Works As discussed in the conclusion, the in-line tracking controller had a significant negative ipact on the accuracy of the trajectory controller. In light of this fact, future work will be done investigating and using other in-line tracking or velocity control ethods to increase the perforance of the existing path tracking controller. VI. ACKNOWLEDGMENTS We would like to thank our tea leader, Jonathan Stark, without his long hours of hard work and dedication to this project, our research would not have been possible. REFERENCES [] K. C. Koh and H. S. Cho, A Sooth Path Tracking Algorith for Wheeled Mobile Robots with Dynaic Constraints, Journal of Intelligent and Robotic Systes, vol. 24, 999, pp [2] Gabriel Hoffann, Claire Tolin, et. al., Autonoous Autoobile Trajectory Tracking for Off-Road Driving: Controller Design, Experiental Validation and Racing, in Aerican Control Conference, 27, pp [3] Luca Consolini, Aurelio Piazzi, and Mario Tosques, Path Following of Car-Like Vehicles Using Dynaic Inversion, International Journal of Control, vol. 76, 23, pp [4] ChangBoon Low and Danwei Wang, Robust Path Following of Car- Like WMR in the Presence of Skidding Effects in International Conference on Mechatronics, Taipei, Taiwan 25 pp tracking errors () speed (/s) Car Ground Track Coand Path 5 5 (a) Slalo Run Ground Tracks tie (sec) (b) Slalo Run Tracking Errors GPS Speed Path Velocity Coand 5 5 tie (sec) Fig. 2. (c) Slalo Run Speed Profile Slalo Tracking Perforance Results e x e y

7 [5] Margan Davidson and Vikas Bahl, The Scalar ǫ-controller: A Spatial Path tracking Approach for ODV, Ackeran, and Differentially Steered Autonoous Mobile Robots, in International Conference on Robotics and Autoation, Seoul, Korea, 2, pp [6] F. Diaz del Rio, G. Jienez, et al., A Generalization of Path Following for Mobile Robots, in International Conference on Robotics and Autoation, Detroit, MI, 999, pp [7] Cripps Donald, Spatially-Robust Vehicle Path Tracking Using Noral Error Feedback, in Proceedings of SPIE, vol. 4364, 2, pp [8] A. M. Bloch and N. H. McClaroch, Control and Stabilization of Nonholonoic Dynaic Systes, in IEEE Trans. Autoatic Control, vol. 37, 992, pp [9] Yutaka J. Kanayaa and Fariba Fahroo, A New Continuous-Curvature Line/Path-Tracking Method for Car-Like Vehicles, Advanced Robotics, vol. 3, 2, pp [] Willia Travis, Robert Daily, et al., SciAutonics-Auburn Engineering s Low-Cost High-Speed ATV for the 25 DARPA Grand Challenge, Journal of Field Robotics, vol. 23, 26, pp [] Isaac Miller, Sergei Lupashin, et al., Cornell University s 25 DARPA Grand Challenge Entry, Journal of Field Robotics, vol. 23, 26, pp [2] Chris Urson, Charlie Ragusa, et al., A Robust Approach to High- Speed Navigation for Unrehearsed Desert Terrain, Journal of Field Robotics, vol. 23, 26, pp

Vision Based Mobile Robot Navigation System

Vision Based Mobile Robot Navigation System International Journal of Control Science and Engineering 2012, 2(4): 83-87 DOI: 10.5923/j.control.20120204.05 Vision Based Mobile Robot Navigation Syste M. Saifizi *, D. Hazry, Rudzuan M.Nor School of

More information

AGV PATH PLANNING BASED ON SMOOTHING A* ALGORITHM

AGV PATH PLANNING BASED ON SMOOTHING A* ALGORITHM International Journal of Software Engineering & Applications (IJSEA), Vol.6, No.5, Septeber 205 AGV PATH PLANNING BASED ON SMOOTHING A* ALGORITHM Xie Yang and Cheng Wushan College of Mechanical Engineering,

More information

Solving the Damage Localization Problem in Structural Health Monitoring Using Techniques in Pattern Classification

Solving the Damage Localization Problem in Structural Health Monitoring Using Techniques in Pattern Classification Solving the Daage Localization Proble in Structural Health Monitoring Using Techniques in Pattern Classification CS 9 Final Project Due Dec. 4, 007 Hae Young Noh, Allen Cheung, Daxia Ge Introduction Structural

More information

A New Generic Model for Vision Based Tracking in Robotics Systems

A New Generic Model for Vision Based Tracking in Robotics Systems A New Generic Model for Vision Based Tracking in Robotics Systes Yanfei Liu, Ada Hoover, Ian Walker, Ben Judy, Mathew Joseph and Charly Heranson lectrical and Coputer ngineering Departent Cleson University

More information

The optimization design of microphone array layout for wideband noise sources

The optimization design of microphone array layout for wideband noise sources PROCEEDINGS of the 22 nd International Congress on Acoustics Acoustic Array Systes: Paper ICA2016-903 The optiization design of icrophone array layout for wideband noise sources Pengxiao Teng (a), Jun

More information

Design and Implementation of Fuzzy Logic Controller for Quad Rotor UAV

Design and Implementation of Fuzzy Logic Controller for Quad Rotor UAV Design and Ipleentation of Fuzzy Logic Controller for Quad Rotor UAV K.Senthil Kuar, Mohaad Rasheed, and R.Muthu Madhava Kuar Abstract A fuzzy control is designed and ipleented to control a siulation odel

More information

NON-RIGID OBJECT TRACKING: A PREDICTIVE VECTORIAL MODEL APPROACH

NON-RIGID OBJECT TRACKING: A PREDICTIVE VECTORIAL MODEL APPROACH NON-RIGID OBJECT TRACKING: A PREDICTIVE VECTORIAL MODEL APPROACH V. Atienza; J.M. Valiente and G. Andreu Departaento de Ingeniería de Sisteas, Coputadores y Autoática Universidad Politécnica de Valencia.

More information

Shortest Path Determination in a Wireless Packet Switch Network System in University of Calabar Using a Modified Dijkstra s Algorithm

Shortest Path Determination in a Wireless Packet Switch Network System in University of Calabar Using a Modified Dijkstra s Algorithm International Journal of Engineering and Technical Research (IJETR) ISSN: 31-869 (O) 454-4698 (P), Volue-5, Issue-1, May 16 Shortest Path Deterination in a Wireless Packet Switch Network Syste in University

More information

A Model Free Automatic Tuning Method for a Restricted Structured Controller. by using Simultaneous Perturbation Stochastic Approximation

A Model Free Automatic Tuning Method for a Restricted Structured Controller. by using Simultaneous Perturbation Stochastic Approximation 28 Aerican Control Conference Westin Seattle Hotel, Seattle, Washington, USA June -3, 28 WeC9.5 A Model Free Autoatic Tuning Method for a Restricted Structured Controller by Using Siultaneous Perturbation

More information

A wireless sensor network for visual detection and classification of intrusions

A wireless sensor network for visual detection and classification of intrusions A wireless sensor network for visual detection and classification of intrusions ANDRZEJ SLUZEK 1,3, PALANIAPPAN ANNAMALAI 2, MD SAIFUL ISLAM 1 1 School of Coputer Engineering, 2 IntelliSys Centre Nanyang

More information

A Novel Fast Constructive Algorithm for Neural Classifier

A Novel Fast Constructive Algorithm for Neural Classifier A Novel Fast Constructive Algorith for Neural Classifier Xudong Jiang Centre for Signal Processing, School of Electrical and Electronic Engineering Nanyang Technological University Nanyang Avenue, Singapore

More information

Data Acquisition of Obstacle Shapes for Fish Robots

Data Acquisition of Obstacle Shapes for Fish Robots Proceedings of the 2nd WEA International Conference on Dynaical ystes and Control, Bucharest, oania, October -17, 6 Data Acquisition of Obstacle hapes for Fish obots EUNG Y. NA, DAEJUNG HIN, JIN Y. KIM,

More information

Image Processing for fmri John Ashburner. Wellcome Trust Centre for Neuroimaging, 12 Queen Square, London, UK.

Image Processing for fmri John Ashburner. Wellcome Trust Centre for Neuroimaging, 12 Queen Square, London, UK. Iage Processing for fmri John Ashburner Wellcoe Trust Centre for Neuroiaging, 12 Queen Square, London, UK. Contents * Preliinaries * Rigid-Body and Affine Transforations * Optiisation and Objective Functions

More information

5-DOF Manipulator Simulation based on MATLAB- Simulink methodology

5-DOF Manipulator Simulation based on MATLAB- Simulink methodology 5-DOF Manipulator Siulation based on MATLAB- Siulink ethodology Velarde-Sanchez J.A., Rodriguez-Gutierrez S.A., Garcia-Valdovinos L.G., Pedraza-Ortega J.C., PICYT-CIDESI, CIDIT-Facultad de Inforatica,

More information

GROUND VEHICLE ATTITUDE ESTIMATION THROUGH MAGNETIC-INERTIAL SENSOR FUSION

GROUND VEHICLE ATTITUDE ESTIMATION THROUGH MAGNETIC-INERTIAL SENSOR FUSION F16-VDCF-4 GROUND VEHICLE ATTITUDE ESTIMATION THROUGH MAGNETIC-INERTIAL SENSOR FUSION 1 Hwang, Yoonjin * ; 1 Seibu, Choi 1 Korea Advanced Institute of Science and Technology, S. Korea KEYWORDS Vehicle

More information

Enhancing Real-Time CAN Communications by the Prioritization of Urgent Messages at the Outgoing Queue

Enhancing Real-Time CAN Communications by the Prioritization of Urgent Messages at the Outgoing Queue Enhancing Real-Tie CAN Counications by the Prioritization of Urgent Messages at the Outgoing Queue ANTÓNIO J. PIRES (1), JOÃO P. SOUSA (), FRANCISCO VASQUES (3) 1,,3 Faculdade de Engenharia da Universidade

More information

Clustering. Cluster Analysis of Microarray Data. Microarray Data for Clustering. Data for Clustering

Clustering. Cluster Analysis of Microarray Data. Microarray Data for Clustering. Data for Clustering Clustering Cluster Analysis of Microarray Data 4/3/009 Copyright 009 Dan Nettleton Group obects that are siilar to one another together in a cluster. Separate obects that are dissiilar fro each other into

More information

Intelligent Robotic System with Fuzzy Learning Controller and 3D Stereo Vision

Intelligent Robotic System with Fuzzy Learning Controller and 3D Stereo Vision Recent Researches in Syste Science Intelligent Robotic Syste with Fuzzy Learning Controller and D Stereo Vision SHIUH-JER HUANG Departent of echanical Engineering National aiwan University of Science and

More information

Critical subsystem failure mitigation in an indoor UAV testbed

Critical subsystem failure mitigation in an indoor UAV testbed IEEE/RSJ International Conference on Intelligent Robots and Systes October 7-,. Vilaoura, Algarve, Portugal Critical subsyste failure itigation in an indoor UAV testbed Mark W. Mueller and Raffaello D

More information

Dynamical Topology Analysis of VANET Based on Complex Networks Theory

Dynamical Topology Analysis of VANET Based on Complex Networks Theory BULGARIAN ACADEMY OF SCIENCES CYBERNETICS AND INFORMATION TECHNOLOGIES Volue 14, Special Issue Sofia 014 Print ISSN: 1311-970; Online ISSN: 1314-4081 DOI: 10.478/cait-014-0053 Dynaical Topology Analysis

More information

Relief shape inheritance and graphical editor for the landscape design

Relief shape inheritance and graphical editor for the landscape design Relief shape inheritance and graphical editor for the landscape design Egor A. Yusov Vadi E. Turlapov Nizhny Novgorod State University after N. I. Lobachevsky Nizhny Novgorod Russia yusov_egor@ail.ru vadi.turlapov@cs.vk.unn.ru

More information

EXAMPLES. Example_OC Ex_OC.asm Example_RPM_1 Ex_RPM_1.as m Example_RPM_2 Ex_RPM_2.as m

EXAMPLES. Example_OC Ex_OC.asm Example_RPM_1 Ex_RPM_1.as m Example_RPM_2 Ex_RPM_2.as m EMCH 367 Fundaentals of Microcontrollers Exaples EXAMPLES Exaples are ainly intended for the students to get started quickly with the basic concepts, prograing language, and hex/binary conventions. The

More information

Preprocessing I: Within Subject John Ashburner

Preprocessing I: Within Subject John Ashburner Preprocessing I: Within Subject John Ashburner Pre-processing Overview Statistics or whatever fmri tie-series Anatoical MRI Teplate Soothed Estiate Spatial Nor Motion Correct Sooth Coregister 11 21 31

More information

IMAGE MOSAICKING FOR ESTIMATING THE MOTION OF AN UNDERWATER VEHICLE. Rafael García, Xevi Cufí and Lluís Pacheco

IMAGE MOSAICKING FOR ESTIMATING THE MOTION OF AN UNDERWATER VEHICLE. Rafael García, Xevi Cufí and Lluís Pacheco IMAGE MOSAICKING FOR ESTIMATING THE MOTION OF AN UNDERWATER VEHICLE Rafael García, Xevi Cufí and Lluís Pacheco Coputer Vision and Robotics Group Institute of Inforatics and Applications, University of

More information

Landing a Helicopter on a Moving Target

Landing a Helicopter on a Moving Target Landing a Helicopter on a Moving Target Srikanth Saripalli and Gaurav S. Sukhate Abstract We present the design of an optial trajectory controller for landing a helicopter on a oving target. The trajectory

More information

Energy-Efficient Disk Replacement and File Placement Techniques for Mobile Systems with Hard Disks

Energy-Efficient Disk Replacement and File Placement Techniques for Mobile Systems with Hard Disks Energy-Efficient Disk Replaceent and File Placeent Techniques for Mobile Systes with Hard Disks Young-Jin Ki School of Coputer Science & Engineering Seoul National University Seoul 151-742, KOREA youngjk@davinci.snu.ac.kr

More information

Design Optimization of Mixed Time/Event-Triggered Distributed Embedded Systems

Design Optimization of Mixed Time/Event-Triggered Distributed Embedded Systems Design Optiization of Mixed Tie/Event-Triggered Distributed Ebedded Systes Traian Pop, Petru Eles, Zebo Peng Dept. of Coputer and Inforation Science, Linköping University {trapo, petel, zebpe}@ida.liu.se

More information

An Efficient Approach for Content Delivery in Overlay Networks

An Efficient Approach for Content Delivery in Overlay Networks An Efficient Approach for Content Delivery in Overlay Networks Mohaad Malli, Chadi Barakat, Walid Dabbous Projet Planète, INRIA-Sophia Antipolis, France E-ail:{alli, cbarakat, dabbous}@sophia.inria.fr

More information

Modal Masses Estimation in OMA by a Consecutive Mass Change Method.

Modal Masses Estimation in OMA by a Consecutive Mass Change Method. Modal Masses Estiation in OMA by a Consecutive Mass Change Method. F. Pelayo University of Oviedo, Departent of Construction and Manufacturing Engineering, Gijón, Spain M. López-Aenlle University of Oviedo,

More information

Identifying Converging Pairs of Nodes on a Budget

Identifying Converging Pairs of Nodes on a Budget Identifying Converging Pairs of Nodes on a Budget Konstantina Lazaridou Departent of Inforatics Aristotle University, Thessaloniki, Greece konlaznik@csd.auth.gr Evaggelia Pitoura Coputer Science and Engineering

More information

NEW APPROACHES FOR REAL TIME TRAFFIC DATA ACQUISITION WITH AIRBORNE SYSTEMS

NEW APPROACHES FOR REAL TIME TRAFFIC DATA ACQUISITION WITH AIRBORNE SYSTEMS NEW APPROACHES FOR REAL TIME TRAFFIC DATA ACQUISITION WITH AIRBORNE SYSTEMS I. Ernst a *, M. Hetscher a, K. Thiessenhusen a, M. Ruhé a, A. Börner b, S. Zuev a a DLR, Institute of Transportation Research,

More information

Secure Wireless Multihop Transmissions by Intentional Collisions with Noise Wireless Signals

Secure Wireless Multihop Transmissions by Intentional Collisions with Noise Wireless Signals Int'l Conf. Wireless etworks ICW'16 51 Secure Wireless Multihop Transissions by Intentional Collisions with oise Wireless Signals Isau Shiada 1 and Hiroaki Higaki 1 1 Tokyo Denki University, Japan Abstract

More information

A Discrete Spring Model to Generate Fair Curves and Surfaces

A Discrete Spring Model to Generate Fair Curves and Surfaces A Discrete Spring Model to Generate Fair Curves and Surfaces Atsushi Yaada Kenji Shiada 2 Tootake Furuhata and Ko-Hsiu Hou 2 Tokyo Research Laboratory IBM Japan Ltd. LAB-S73 623-4 Shiotsurua Yaato Kanagawa

More information

PROBABILISTIC LOCALIZATION AND MAPPING OF MOBILE ROBOTS IN INDOOR ENVIRONMENTS WITH A SINGLE LASER RANGE FINDER

PROBABILISTIC LOCALIZATION AND MAPPING OF MOBILE ROBOTS IN INDOOR ENVIRONMENTS WITH A SINGLE LASER RANGE FINDER nd International Congress of Mechanical Engineering (COBEM 3) Noveber 3-7, 3, Ribeirão Preto, SP, Brazil Copyright 3 by ABCM PROBABILISTIC LOCALIZATION AND MAPPING OF MOBILE ROBOTS IN INDOOR ENVIRONMENTS

More information

The Flaw Attack to the RTS/CTS Handshake Mechanism in Cluster-based Battlefield Self-organizing Network

The Flaw Attack to the RTS/CTS Handshake Mechanism in Cluster-based Battlefield Self-organizing Network The Flaw Attack to the RTS/CTS Handshake Mechanis in Cluster-based Battlefield Self-organizing Network Zeao Zhao College of Counication Engineering, Hangzhou Dianzi University, Hangzhou 310018, China National

More information

Derivation of an Analytical Model for Evaluating the Performance of a Multi- Queue Nodes Network Router

Derivation of an Analytical Model for Evaluating the Performance of a Multi- Queue Nodes Network Router Derivation of an Analytical Model for Evaluating the Perforance of a Multi- Queue Nodes Network Router 1 Hussein Al-Bahadili, 1 Jafar Ababneh, and 2 Fadi Thabtah 1 Coputer Inforation Systes Faculty of

More information

A Hybrid Network Architecture for File Transfers

A Hybrid Network Architecture for File Transfers JOURNAL OF IEEE TRANSACTIONS ON PARALLEL AND DISTRIBUTED SYSTEMS, VOL. 6, NO., JANUARY 9 A Hybrid Network Architecture for File Transfers Xiuduan Fang, Meber, IEEE, Malathi Veeraraghavan, Senior Meber,

More information

Utility-Based Resource Allocation for Mixed Traffic in Wireless Networks

Utility-Based Resource Allocation for Mixed Traffic in Wireless Networks IEEE IFOCO 2 International Workshop on Future edia etworks and IP-based TV Utility-Based Resource Allocation for ixed Traffic in Wireless etworks Li Chen, Bin Wang, Xiaohang Chen, Xin Zhang, and Dacheng

More information

Evaluation of the Timing Properties of Two Control Networks: CAN and PROFIBUS

Evaluation of the Timing Properties of Two Control Networks: CAN and PROFIBUS Evaluation of the Tiing Properties of Two Control Networs: CAN and PROFIBUS Max Mauro Dias Santos 1, Marcelo Ricardo Steer 2 and Francisco Vasques 3 1 UnilesteMG, CEP 35170-056, Coronel Fabriciano MG Brasil.

More information

Different criteria of dynamic routing

Different criteria of dynamic routing Procedia Coputer Science Volue 66, 2015, Pages 166 173 YSC 2015. 4th International Young Scientists Conference on Coputational Science Different criteria of dynaic routing Kurochkin 1*, Grinberg 1 1 Kharkevich

More information

QUERY ROUTING OPTIMIZATION IN SENSOR COMMUNICATION NETWORKS

QUERY ROUTING OPTIMIZATION IN SENSOR COMMUNICATION NETWORKS QUERY ROUTING OPTIMIZATION IN SENSOR COMMUNICATION NETWORKS Guofei Jiang and George Cybenko Institute for Security Technology Studies and Thayer School of Engineering Dartouth College, Hanover NH 03755

More information

Investigation of The Time-Offset-Based QoS Support with Optical Burst Switching in WDM Networks

Investigation of The Time-Offset-Based QoS Support with Optical Burst Switching in WDM Networks Investigation of The Tie-Offset-Based QoS Support with Optical Burst Switching in WDM Networks Pingyi Fan, Chongxi Feng,Yichao Wang, Ning Ge State Key Laboratory on Microwave and Digital Counications,

More information

PERFORMANCE MEASURES FOR INTERNET SERVER BY USING M/M/m QUEUEING MODEL

PERFORMANCE MEASURES FOR INTERNET SERVER BY USING M/M/m QUEUEING MODEL IJRET: International Journal of Research in Engineering and Technology ISSN: 239-63 PERFORMANCE MEASURES FOR INTERNET SERVER BY USING M/M/ QUEUEING MODEL Raghunath Y. T. N. V, A. S. Sravani 2 Assistant

More information

DYNAMIC ESTIMATION OF BDP IN MANETS FOR EFFECTIVE NEXT NODE SELECTION

DYNAMIC ESTIMATION OF BDP IN MANETS FOR EFFECTIVE NEXT NODE SELECTION www.arpnjournals.co DYNAMIC ESTIMATION OF BDP IN MANETS FOR EFFECTIVE NEXT NODE SELECTION N. Snehalatha 1 and Paul Rodrigues 2 1 School of Coputing, SRM University, Chennai, Tail Nadu, India 2 Departent

More information

Image Filter Using with Gaussian Curvature and Total Variation Model

Image Filter Using with Gaussian Curvature and Total Variation Model IJECT Vo l. 7, Is s u e 3, Ju l y - Se p t 016 ISSN : 30-7109 (Online) ISSN : 30-9543 (Print) Iage Using with Gaussian Curvature and Total Variation Model 1 Deepak Kuar Gour, Sanjay Kuar Shara 1, Dept.

More information

A Periodic Dynamic Load Balancing Method

A Periodic Dynamic Load Balancing Method 2016 3 rd International Conference on Engineering Technology and Application (ICETA 2016) ISBN: 978-1-60595-383-0 A Periodic Dynaic Load Balancing Method Taotao Fan* State Key Laboratory of Inforation

More information

Hand Gesture Recognition for Human-Computer Interaction

Hand Gesture Recognition for Human-Computer Interaction Journal of Coputer Science 6 (9): 002-007, 200 ISSN 549-3636 200 Science Publications Hand Gesture Recognition for Huan-Coputer Interaction S. ohaed ansoor Rooi, R. Jyothi Priya and H. Jayalakshi Departent

More information

Sequential Quadratic Programming based Global Path Re-Planner for a Mobile Manipulator

Sequential Quadratic Programming based Global Path Re-Planner for a Mobile Manipulator 318 International Journal of Control, Sooyong Autoation, Lee and Systes, vol. 4, no. 3, pp. 318-34, June 006 Sequential Quadratic Prograing ased Gloal Path Re-Planner for a Moile Manipulator Sooyong Lee

More information

Haptic Subdivision: an Approach to Defining Level-of-detail in Haptic Rendering

Haptic Subdivision: an Approach to Defining Level-of-detail in Haptic Rendering Haptic Subdivision: an Approach to Defining Level-of-detail in Haptic Rendering Jian Zhang, Shahra Payandeh and John Dill Coputer Graphics and Robotics Laboratories, School of Engineering Science Sion

More information

Equation Based Congestion Control for Video Transmission over WCDMA Networks

Equation Based Congestion Control for Video Transmission over WCDMA Networks Equation Based Congestion Control for Video Transission over WCDMA Networks Antonios Alexiou, Diitrios Antonellis and Christos Bouras Research Acadeic Coputer Technology Institute, Greece and Coputer Engineering

More information

COMPUTER GENERATED HOLOGRAMS Optical Sciences 627 W.J. Dallas (Monday, August 23, 2004, 12:38 PM) PART III: CHAPTER ONE DIFFUSERS FOR CGH S

COMPUTER GENERATED HOLOGRAMS Optical Sciences 627 W.J. Dallas (Monday, August 23, 2004, 12:38 PM) PART III: CHAPTER ONE DIFFUSERS FOR CGH S COPUTER GEERATED HOLOGRAS Optical Sciences 67 W.J. Dallas (onday, August 3, 004, 1:38 P) PART III: CHAPTER OE DIFFUSERS FOR CGH S Part III: Chapter One Page 1 of 8 Introduction Hologras for display purposes

More information

RECONFIGURABLE AND MODULAR BASED SYNTHESIS OF CYCLIC DSP DATA FLOW GRAPHS

RECONFIGURABLE AND MODULAR BASED SYNTHESIS OF CYCLIC DSP DATA FLOW GRAPHS RECONFIGURABLE AND MODULAR BASED SYNTHESIS OF CYCLIC DSP DATA FLOW GRAPHS AWNI ITRADAT Assistant Professor, Departent of Coputer Engineering, Faculty of Engineering, Hasheite University, P.O. Box 15459,

More information

Simulated Sensor Reading. Heading. Y [m] local minimum ; m. local maximum ; M. discontinuity ; D. connection ; c X [m]

Simulated Sensor Reading. Heading. Y [m] local minimum ; m. local maximum ; M. discontinuity ; D. connection ; c X [m] Localization based on Visibility Sectors using Range Sensors Sooyong Lee y Nancy. Aato Jaes Fellers Departent of Coputer Science Texas A& University College Station, TX 7784 fsooyong,aato,jpf938g@cs.tau.edu

More information

Colorado School of Mines. Computer Vision. Professor William Hoff Dept of Electrical Engineering &Computer Science.

Colorado School of Mines. Computer Vision. Professor William Hoff Dept of Electrical Engineering &Computer Science. Professor Willia Hoff Dept of Electrical Engineering &Coputer Science http://inside.ines.edu/~whoff/ 1 Caera Calibration 2 Caera Calibration Needed for ost achine vision and photograetry tasks (object

More information

Designing High Performance Web-Based Computing Services to Promote Telemedicine Database Management System

Designing High Performance Web-Based Computing Services to Promote Telemedicine Database Management System Designing High Perforance Web-Based Coputing Services to Proote Teleedicine Database Manageent Syste Isail Hababeh 1, Issa Khalil 2, and Abdallah Khreishah 3 1: Coputer Engineering & Inforation Technology,

More information

Galois Homomorphic Fractal Approach for the Recognition of Emotion

Galois Homomorphic Fractal Approach for the Recognition of Emotion Galois Hooorphic Fractal Approach for the Recognition of Eotion T. G. Grace Elizabeth Rani 1, G. Jayalalitha 1 Research Scholar, Bharathiar University, India, Associate Professor, Departent of Matheatics,

More information

Aerodynamic Parameter Measurement Using the Wind Driven Manipulator: Inverse Force Measurement on Wings

Aerodynamic Parameter Measurement Using the Wind Driven Manipulator: Inverse Force Measurement on Wings AIAA Paper 97-222, Applied Aerodynaics Conference, June 1997 Aerodynaic Paraeter Measureent Using the Wind Driven Manipulator: Inverse Force Measureent on Wings Richard G. Aes, N.M. Koerath, J.C. Magill

More information

A Generic Architecture for Programmable Trac. Shaper for High Speed Networks. Krishnan K. Kailas y Ashok K. Agrawala z. fkrish,

A Generic Architecture for Programmable Trac. Shaper for High Speed Networks. Krishnan K. Kailas y Ashok K. Agrawala z. fkrish, A Generic Architecture for Prograable Trac Shaper for High Speed Networks Krishnan K. Kailas y Ashok K. Agrawala z fkrish, agrawalag@cs.ud.edu y Departent of Electrical Engineering z Departent of Coputer

More information

Using Imperialist Competitive Algorithm in Optimization of Nonlinear Multiple Responses

Using Imperialist Competitive Algorithm in Optimization of Nonlinear Multiple Responses International Journal of Industrial Engineering & Production Research Septeber 03, Volue 4, Nuber 3 pp. 9-35 ISSN: 008-4889 http://ijiepr.iust.ac.ir/ Using Iperialist Copetitive Algorith in Optiization

More information

Ascending order sort Descending order sort

Ascending order sort Descending order sort Scalable Binary Sorting Architecture Based on Rank Ordering With Linear Area-Tie Coplexity. Hatrnaz and Y. Leblebici Departent of Electrical and Coputer Engineering Worcester Polytechnic Institute Abstract

More information

A Trajectory Splitting Model for Efficient Spatio-Temporal Indexing

A Trajectory Splitting Model for Efficient Spatio-Temporal Indexing A Trajectory Splitting Model for Efficient Spatio-Teporal Indexing Slobodan Rasetic Jörg Sander Jaes Elding Mario A. Nasciento Departent of Coputing Science University of Alberta Edonton, Alberta, Canada

More information

TensorFlow and Keras-based Convolutional Neural Network in CAT Image Recognition Ang LI 1,*, Yi-xiang LI 2 and Xue-hui LI 3

TensorFlow and Keras-based Convolutional Neural Network in CAT Image Recognition Ang LI 1,*, Yi-xiang LI 2 and Xue-hui LI 3 2017 2nd International Conference on Coputational Modeling, Siulation and Applied Matheatics (CMSAM 2017) ISBN: 978-1-60595-499-8 TensorFlow and Keras-based Convolutional Neural Network in CAT Iage Recognition

More information

General-Purpose AC Servo MELSERVO-J2-Super AC Servo Amplifier with Built-in Program Operation Functions

General-Purpose AC Servo MELSERVO-J2-Super AC Servo Amplifier with Built-in Program Operation Functions General-Purpose Servo MLSRVO-J-Super Servo plifier with uilt-in Progra Operation Functions MR-JS-L Type Unveiled!! The new MR-JS-L now offers built in otion prograing to coplient the advanced features

More information

News Events Clustering Method Based on Staging Incremental Single-Pass Technique

News Events Clustering Method Based on Staging Incremental Single-Pass Technique News Events Clustering Method Based on Staging Increental Single-Pass Technique LI Yongyi 1,a *, Gao Yin 2 1 School of Electronics and Inforation Engineering QinZhou University 535099 Guangxi, China 2

More information

Evaluation of a multi-frame blind deconvolution algorithm using Cramér-Rao bounds

Evaluation of a multi-frame blind deconvolution algorithm using Cramér-Rao bounds Evaluation of a ulti-frae blind deconvolution algorith using Craér-Rao bounds Charles C. Beckner, Jr. Air Force Research Laboratory, 3550 Aberdeen Ave SE, Kirtland AFB, New Mexico, USA 87117-5776 Charles

More information

THE rapid growth and continuous change of the real

THE rapid growth and continuous change of the real IEEE TRANSACTIONS ON SERVICES COMPUTING, VOL. 8, NO. 1, JANUARY/FEBRUARY 2015 47 Designing High Perforance Web-Based Coputing Services to Proote Teleedicine Database Manageent Syste Isail Hababeh, Issa

More information

Effective Tracking of the Players and Ball in Indoor Soccer Games in the Presence of Occlusion

Effective Tracking of the Players and Ball in Indoor Soccer Games in the Presence of Occlusion Effective Tracking of the Players and Ball in Indoor Soccer Gaes in the Presence of Occlusion Soudeh Kasiri-Bidhendi and Reza Safabakhsh Airkabir Univerisity of Technology, Tehran, Iran {kasiri, safa}@aut.ac.ir

More information

Geo-activity Recommendations by using Improved Feature Combination

Geo-activity Recommendations by using Improved Feature Combination Geo-activity Recoendations by using Iproved Feature Cobination Masoud Sattari Middle East Technical University Ankara, Turkey e76326@ceng.etu.edu.tr Murat Manguoglu Middle East Technical University Ankara,

More information

Adaptive Holistic Scheduling for In-Network Sensor Query Processing

Adaptive Holistic Scheduling for In-Network Sensor Query Processing Adaptive Holistic Scheduling for In-Network Sensor Query Processing Hejun Wu and Qiong Luo Departent of Coputer Science and Engineering Hong Kong University of Science & Technology Clear Water Bay, Kowloon,

More information

POSITION-PATCH BASED FACE HALLUCINATION VIA LOCALITY-CONSTRAINED REPRESENTATION. Junjun Jiang, Ruimin Hu, Zhen Han, Tao Lu, and Kebin Huang

POSITION-PATCH BASED FACE HALLUCINATION VIA LOCALITY-CONSTRAINED REPRESENTATION. Junjun Jiang, Ruimin Hu, Zhen Han, Tao Lu, and Kebin Huang IEEE International Conference on ultiedia and Expo POSITION-PATCH BASED FACE HALLUCINATION VIA LOCALITY-CONSTRAINED REPRESENTATION Junjun Jiang, Ruiin Hu, Zhen Han, Tao Lu, and Kebin Huang National Engineering

More information

LOSSLESS COMPRESSION OF BAYER MASK IMAGES USING AN OPTIMAL VECTOR PREDICTION TECHNIQUE

LOSSLESS COMPRESSION OF BAYER MASK IMAGES USING AN OPTIMAL VECTOR PREDICTION TECHNIQUE 1th European Signal Processing Conference (EUSIPCO 2006), Florence, Italy, Septeber -8, 2006, copyright by EUASIP LOSSLESS COMPESSION OF AYE MASK IMAES USIN AN OPTIMAL VECTO PEDICTION TECHNIQUE Stefano

More information

(Geometric) Camera Calibration

(Geometric) Camera Calibration (Geoetric) Caera Calibration CS635 Spring 217 Daniel G. Aliaga Departent of Coputer Science Purdue University Caera Calibration Caeras and CCDs Aberrations Perspective Projection Calibration Caeras First

More information

Real-Time Detection of Invisible Spreaders

Real-Time Detection of Invisible Spreaders Real-Tie Detection of Invisible Spreaders MyungKeun Yoon Shigang Chen Departent of Coputer & Inforation Science & Engineering University of Florida, Gainesville, FL 3, USA {yoon, sgchen}@cise.ufl.edu Abstract

More information

A simplified approach to merging partial plane images

A simplified approach to merging partial plane images A siplified approach to erging partial plane iages Mária Kruláková 1 This paper introduces a ethod of iage recognition based on the gradual generating and analysis of data structure consisting of the 2D

More information

Mapping Data in Peer-to-Peer Systems: Semantics and Algorithmic Issues

Mapping Data in Peer-to-Peer Systems: Semantics and Algorithmic Issues Mapping Data in Peer-to-Peer Systes: Seantics and Algorithic Issues Anastasios Keentsietsidis Marcelo Arenas Renée J. Miller Departent of Coputer Science University of Toronto {tasos,arenas,iller}@cs.toronto.edu

More information

Control Message Reduction Techniques in Backward Learning Ad Hoc Routing Protocols

Control Message Reduction Techniques in Backward Learning Ad Hoc Routing Protocols Control Message Reduction Techniques in Backward Learning Ad Hoc Routing Protocols Navodaya Garepalli Kartik Gopalan Ping Yang Coputer Science, Binghaton University (State University of New York) Contact:

More information

ANALYSIS AND RECOVERY OF SYSTEMATIC ERRORS IN AIRBORNE LASER SYSTEM

ANALYSIS AND RECOVERY OF SYSTEMATIC ERRORS IN AIRBORNE LASER SYSTEM ANALYSIS AND RECOVERY OF SYSTEMATIC ERRORS IN AIRBORNE LASER SYSTEM Zhihe Wang*, Rong Shu,Weiing Xu, Hongyi Pu, Bo Yao Shanghai Institute of Technical Physics, CAS, 500 Yutian Road, Shanghai 200083, P.

More information

Integrating fast mobility in the OLSR routing protocol

Integrating fast mobility in the OLSR routing protocol Integrating fast obility in the OLSR routing protocol Mounir BENZAID 1,2, Pascale MINET 1 and Khaldoun AL AGHA 1,2 1 INRIA, Doaine de Voluceau - B.P.105, 78153 Le Chesnay Cedex, FRANCE ounir.benzaid, pascale.inet@inria.fr

More information

Detection of Outliers and Reduction of their Undesirable Effects for Improving the Accuracy of K-means Clustering Algorithm

Detection of Outliers and Reduction of their Undesirable Effects for Improving the Accuracy of K-means Clustering Algorithm Detection of Outliers and Reduction of their Undesirable Effects for Iproving the Accuracy of K-eans Clustering Algorith Bahan Askari Departent of Coputer Science and Research Branch, Islaic Azad University,

More information

THE rounding operation is performed in almost all arithmetic

THE rounding operation is performed in almost all arithmetic This is the author's version of an article that has been published in this journal. Changes were ade to this version by the publisher prior to publication. The final version of record is available at http://dx.doi.org/.9/tvlsi.5.538

More information

An Integrated Processing Method for Multiple Large-scale Point-Clouds Captured from Different Viewpoints

An Integrated Processing Method for Multiple Large-scale Point-Clouds Captured from Different Viewpoints 519 An Integrated Processing Method for Multiple Large-scale Point-Clouds Captured fro Different Viewpoints Yousuke Kawauchi 1, Shin Usuki, Kenjiro T. Miura 3, Hiroshi Masuda 4 and Ichiro Tanaka 5 1 Shizuoka

More information

Feature Based Registration for Panoramic Image Generation

Feature Based Registration for Panoramic Image Generation IJCSI International Journal of Coputer Science Issues, Vol. 10, Issue 6, No, Noveber 013 www.ijcsi.org 13 Feature Based Registration for Panoraic Iage Generation Kawther Abbas Sallal 1, Abdul-Mone Saleh

More information

Modeling Parallel Applications Performance on Heterogeneous Systems

Modeling Parallel Applications Performance on Heterogeneous Systems Modeling Parallel Applications Perforance on Heterogeneous Systes Jaeela Al-Jaroodi, Nader Mohaed, Hong Jiang and David Swanson Departent of Coputer Science and Engineering University of Nebraska Lincoln

More information

A Broadband Spectrum Sensing Algorithm in TDCS Based on ICoSaMP Reconstruction

A Broadband Spectrum Sensing Algorithm in TDCS Based on ICoSaMP Reconstruction MATEC Web of Conferences 73, 03073(08) https://doi.org/0.05/atecconf/087303073 SMIMA 08 A roadband Spectru Sensing Algorith in TDCS ased on I Reconstruction Liu Yang, Ren Qinghua, Xu ingzheng and Li Xiazhao

More information

Software manual Mobile 3D Smart Sensor O3M151 O3M251 O3M161 O3M261. Object Detection / / 2017

Software manual Mobile 3D Smart Sensor O3M151 O3M251 O3M161 O3M261. Object Detection / / 2017 Software anual Mobile D Sart Sensor OM OM2 OM OM2 Object Detection 78 / / 27 OM D Sart Sensor Object Detection Contents About these instructions...............................................................

More information

3D Building Detection and Reconstruction from Aerial Images Using Perceptual Organization and Fast Graph Search

3D Building Detection and Reconstruction from Aerial Images Using Perceptual Organization and Fast Graph Search 436 Journal of Electrical Engineering & Technology, Vol. 3, No. 3, pp. 436~443, 008 3D Building Detection and Reconstruction fro Aerial Iages Using Perceptual Organization and Fast Graph Search Dong-Min

More information

COLLABORATIVE BEAMFORMING FOR WIRELESS AD-HOC NETWORKS

COLLABORATIVE BEAMFORMING FOR WIRELESS AD-HOC NETWORKS International Journal of Coputer Science and Counication Vol. 3, No. 1, January-June 2012, pp. 181-185 COLLABORATIVE BEAMFORMING FOR WIRELESS AD-HOC NETWORKS A.H. Karode 1, S.R. Suralkar 2, Manoj Bagde

More information

Survivability Function A Measure of Disaster-Based Routing Performance

Survivability Function A Measure of Disaster-Based Routing Performance Survivability Function A Measure of Disaster-Based Routing Perforance Journal Club Presentation on W. Molisz. Survivability function-a easure of disaster-based routing perforance. IEEE Journal on Selected

More information

Sherlock is Around: Detecting Network Failures with Local Evidence Fusion

Sherlock is Around: Detecting Network Failures with Local Evidence Fusion Sherlock is Around: Detecting Network Failures with Local Evidence Fusion Qiang Ma, Kebin Liu 2, Xin Miao, Yunhao Liu,2 Departent of Coputer Science and Engineering, Hong Kong University of Science and

More information

Ground Target Tracking of Vehicles in a Wireless Ground Sensor Network

Ground Target Tracking of Vehicles in a Wireless Ground Sensor Network Ground Target Tracing of Vehicles in a Wireless Ground Sensor Networ Mats Ean Security and Defense Solutions Saab AB Järfälla, SE-75 88, Sweden ats.x.ean@saabgroup.co Henri Pålsson Security and Defense

More information

Collaborative Web Caching Based on Proxy Affinities

Collaborative Web Caching Based on Proxy Affinities Collaborative Web Caching Based on Proxy Affinities Jiong Yang T J Watson Research Center IBM jiyang@usibco Wei Wang T J Watson Research Center IBM ww1@usibco Richard Muntz Coputer Science Departent UCLA

More information

Multi Packet Reception and Network Coding

Multi Packet Reception and Network Coding The 2010 Military Counications Conference - Unclassified Progra - etworking Protocols and Perforance Track Multi Packet Reception and etwork Coding Aran Rezaee Research Laboratory of Electronics Massachusetts

More information

ELEVATION SURFACE INTERPOLATION OF POINT DATA USING DIFFERENT TECHNIQUES A GIS APPROACH

ELEVATION SURFACE INTERPOLATION OF POINT DATA USING DIFFERENT TECHNIQUES A GIS APPROACH ELEVATION SURFACE INTERPOLATION OF POINT DATA USING DIFFERENT TECHNIQUES A GIS APPROACH Kulapraote Prathuchai Geoinforatics Center, Asian Institute of Technology, 58 Moo9, Klong Luang, Pathuthani, Thailand.

More information

COMMUNICATIONS STRUCTURE FOR SENSOR FUSION IN DISTRIBUTED REAL TIME SYSTEMS. J.L.Posadas, P.Pérez, J.E.Simó, G.Benet, F.Blanes

COMMUNICATIONS STRUCTURE FOR SENSOR FUSION IN DISTRIBUTED REAL TIME SYSTEMS. J.L.Posadas, P.Pérez, J.E.Simó, G.Benet, F.Blanes COMMUNICATIONS STRUCTURE FOR SENSOR FUSION IN DISTRIBUTED REAL TIME SYSTEMS J.L.Posadas, P.Pérez, J.E.Sió, G.Benet, F.Blanes Departaento de Inforática de Sisteas y Coputadores (D.I.S.C.A.) Universidad

More information

PERFORMANCE ANALYSIS OF THE UMTS SYSTEM FOR PACKET DATA TRANSFER OVER DEDICATED CHANNELS

PERFORMANCE ANALYSIS OF THE UMTS SYSTEM FOR PACKET DATA TRANSFER OVER DEDICATED CHANNELS PERFORMACE AALSIS OF THE MTS SSTEM FOR PACKET DATA TRASFER OVER DEDICATED CHAELS Manju Sarvagya, Ratna V. Raja Kuar Departent of Electronics and Electrical Counication Engineering Indian Institute of Technology,

More information

Accurate On-Line 3D Occupancy Grids Using Manhattan World Constraints

Accurate On-Line 3D Occupancy Grids Using Manhattan World Constraints Accurate On-Line 3D Occupancy Grids Using Manhattan World Constraints Brian Peasley and Stan Birchfield Electrical and Coputer Engineering Dept. Cleson University, Cleson, SC 29634 Alex Cunningha and Frank

More information

Predicting x86 Program Runtime for Intel Processor

Predicting x86 Program Runtime for Intel Processor Predicting x86 Progra Runtie for Intel Processor Behra Mistree, Haidreza Haki Javadi, Oid Mashayekhi Stanford University bistree,hrhaki,oid@stanford.edu 1 Introduction Progras can be equivalent: given

More information

Experiences with complex user profiles for approximate P2P community matching

Experiences with complex user profiles for approximate P2P community matching Experiences with coplex user profiles for approxiate PP counity atching Patrizio Dazzi ISTI-CNR Pisa, Italy p.dazzi@isti.cnr.it Matteo Mordacchini IIT-CNR Pisa, Italy.ordacchini@iit.cnr.it Fabio Baglini

More information

Using Time-of-Flight Cameras with Active Gaze Control for 3D Collision Avoidance

Using Time-of-Flight Cameras with Active Gaze Control for 3D Collision Avoidance Using Tie-of-Flight Caeras with Active Gaze Control for 3D Collision Avoidance David Droeschel, Dirk Holz, Jörg Stückler, and Sven Behnke Abstract We propose a 3D obstacle avoidance ethod for obile robots.

More information

Efficient Estimation of Inclusion Coefficient using HyperLogLog Sketches

Efficient Estimation of Inclusion Coefficient using HyperLogLog Sketches Efficient Estiation of Inclusion Coefficient using HyperLogLog Sketches Azade Nazi, Bolin Ding, Vivek Narasayya, Surajit Chaudhuri Microsoft Research {aznazi, bolind, viveknar, surajitc}@icrosoft.co ABSTRACT

More information