SlideShare a Scribd company logo
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Spectrum Analytic Approach for Cooperative
Navigation of Connected and Autonomous
Vehicles
Harish Chintakunta1 Mustafa ˙Ilhan Akba¸s2
1Department of Electrical and Computer Engineering
Florida Polytechnic University
2Electrical, Computer, Software and Systems Engineering
Embry-Riddle Aeronautical University
9th ACM International Symposium on Design and Analysis of Intelligent Vehicular
Networks and Applications (DIVANET)
November 25, 2019
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Emergency vehicle navigation
Making way for the EV can take a
long time.
Drivers feel “hassled” at the
appearance of EVs, which leads
to bad decisions.
There are about 6,500 annual
accidents involving ambulances.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Advantages of Connected Autonomous Vehicles (CAVs)
Vehicles can be notified well in advance about an
approaching EV.
Complex cooperative behavior amongst CAVs can assist
the navigation of EVs.
EV itself being autonomous can enable complex path
planning algorithm to optimize travel time, saving lives.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Our view of the problem
We now consider the problem
when all other vehicles drive
cooperatively to assist an EV.
Facilitating safety for EV is
rephrased using topological
features.
The space of feasible paths
for EV should be “strongly
connected”, in other words,
no “bottle necks”.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Formulation in terms of graph theory
1 Discretize the space and draw
edges between neighboring vertices.
2 Encode the safety information onto
edge weights.
3 The weight we = 1 − e−d(s,e)
on an
edge is a decreasing function of the
distance from a surrounding vehicle.
4 In this example, we would want the
surrounding vehicle to move away
from the central edge.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Inspiration from spectral properties
Graph Laplacian L defined as
L = D − A,
has the following useful property (M.Fiedler, 1973):
λ2(L) ≤ σe(G),
where σe(G) is the edge connectivity.
More importantly, in weighted graphs, the eigenvalues of L
are sensitive to weights of the edges in an edge cut set.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Properties of λ2(L)
1 λ2(LΛ) is very sensitive to
weights of edges which
“connect” distinct
components.
2 The gradient of λ2(LΛ) w.r.t
the elements of L can be
analytically expressed.
3 Numerical computation of the
gradient of λ2(LΛ) also tends
to be accurate even for large
LΛ matrices, making it ideal
for numerical optimization
algorithms.
−0.2 −0.1 0.0 0.1 0.2
−1.00
−0.75
−0.50
−0.25
0.00
0.25
0.50
0.75
1.00
0 1
2
3
4
5
6
7
8
9
10
11
12 13
14
15
16
17
18 19
0.2 0.4 0.6 0.8 1.0
weight of the linking edge
0.0025
0.0050
0.0075
0.0100
0.0125
0.0150
0.0175
secondeigenvalue
linking edge
insider edge
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
λ2(L) as a function of vehicle position
1 λ2(L) gets smaller when
the vehicle approaches the
critical edge.
2 If fact, the gradient
x λ2(L) consistently
points away from the
central edge.
3 In this choice of the weight
function, the value is
independent of the position
x, given x is “far” from the
critical edge.
0.0
0.5
1.0
1.5
2.0
2.5
3.0
3.5
4.0
0
2
4
6
8
0.000
0.005
0.010
0.015
0.020
0.025
0.030
0.035
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Putting things together
Construct a graph G = (V, E) with discretized points in the
space as vertices, and edges between vertices in a
geometrical neighborhood.
Λ : configuration of the obstacles.
Assign weights wΛ : E → [0, 1], where wΛ(e) is a function
of distances between the edge and all other obstacles.
LΛ((ui, uj)) =
−wΛ((ui, uj)), ui = uj
uk =ui
wΛ((ui, uk )), ui = uj
The second eigenvalue λ2(LΛ) will serve as a good
measure for connectivity.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Framing as an optimization problem
EV
SV
0 1 2 3 4 5 6 7 8
0.00
0.25
0.50
0.75
1.00
1.25
1.50
1.75
2.00
0
1
2
3
4
5
6
7
8
0 1 2 3 4 5 6 7 8 0.000.250.500.751.001.251.501.752.00
0
1
2
3
4
5
6
7
8
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Solution to optimization problem
1 The acceleration functions of the surrounding vehicles are
optimized to provide a safe path to the EV.
2 Providing a safe path translates to
“Make a stronger connected component”
3 The above objective is achieved by:
{a∗
i (t)} = arg max{ai(t)} λ2(LΛ)
s.t. Safety and boundary constraints on Λ
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Results
Movement without control:
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
Movement with control:
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
0 5 10
0
1
2
Optimized acceleration functions:
0 1 2 3 4 5 6 7 8
−0.3
−0.2
−0.1
0.0
0.1
0.2
0.3
x-acceleration
y-acceleration
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Conclusions
1 The “safety” of the situation with respect to navigation of
EV in captured by λ2(L) of a suitably constructed graph.
2 The configuration of the surrounding vehicles is altered to
improve the safety measure.
3 The alteration of the surrounding vehicle configuration is
achieved by moving them along the gradient direction of
the safety measure.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Future directions
1 Distributed algorithms to compute the gradient of the
configuration.
2 Statistical analysis in a realistic traffic situation.
3 Deeper understanding of the theoretical aspects of Fiedler
vector in the context of optimal cooperative driving.
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
Problem context Mapping onto graphs Graph spectral properties Problem formalization Results
Thank you!!
Harish Chintakunta1
, Mustafa ˙Ilhan Akba¸s2
FPU & ERAU
Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles

More Related Content

What's hot

Path Planning And Navigation
Path Planning And NavigationPath Planning And Navigation
Path Planning And Navigationguest90654fd
 
IRJET - Realization of Power Optimised Carry Skip Adder using AOI Logic
IRJET -  	  Realization of Power Optimised Carry Skip Adder using AOI LogicIRJET -  	  Realization of Power Optimised Carry Skip Adder using AOI Logic
IRJET - Realization of Power Optimised Carry Skip Adder using AOI Logic
IRJET Journal
 
Performance analysis on color image mosaicing techniques on FPGA
Performance analysis on color image mosaicing techniques on FPGAPerformance analysis on color image mosaicing techniques on FPGA
Performance analysis on color image mosaicing techniques on FPGA
IJECEIAES
 
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Waqas Tariq
 
Robotics for Path Planning
Robotics for Path PlanningRobotics for Path Planning
Robotics for Path Planning
Hitesh Mohapatra
 
Path Planning for Mobile Robots
Path Planning for Mobile RobotsPath Planning for Mobile Robots
Path Planning for Mobile Robots
sriraj317
 
G1802053147
G1802053147G1802053147
G1802053147
IOSR Journals
 
A comprehensive study of different image super resolution reconstruction algo...
A comprehensive study of different image super resolution reconstruction algo...A comprehensive study of different image super resolution reconstruction algo...
A comprehensive study of different image super resolution reconstruction algo...IAEME Publication
 
Enhancement of genetic image watermarking robust against cropping attack
Enhancement of genetic image watermarking robust against cropping attackEnhancement of genetic image watermarking robust against cropping attack
Enhancement of genetic image watermarking robust against cropping attack
ijfcstjournal
 
Grychtol B. et al.: 3D EIT image reconstruction with GREIT.
Grychtol B. et al.: 3D EIT image reconstruction with GREIT.Grychtol B. et al.: 3D EIT image reconstruction with GREIT.
Grychtol B. et al.: 3D EIT image reconstruction with GREIT.
Hauke Sann
 
B010430814
B010430814B010430814
B010430814
IOSR Journals
 
Lec11: Active Contour and Level Set for Medical Image Segmentation
Lec11: Active Contour and Level Set for Medical Image SegmentationLec11: Active Contour and Level Set for Medical Image Segmentation
Lec11: Active Contour and Level Set for Medical Image Segmentation
Ulaş Bağcı
 
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
CSCJournals
 
Path Planning Algorithms for Unmanned Aerial Vehicles
Path Planning Algorithms for Unmanned Aerial VehiclesPath Planning Algorithms for Unmanned Aerial Vehicles
Path Planning Algorithms for Unmanned Aerial Vehicles
ijtsrd
 
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM NITISH K
 
SPPRA'2013 Paper Presentation
SPPRA'2013 Paper PresentationSPPRA'2013 Paper Presentation
SPPRA'2013 Paper Presentation
ActiveEon
 

What's hot (19)

Path Planning And Navigation
Path Planning And NavigationPath Planning And Navigation
Path Planning And Navigation
 
IRJET - Realization of Power Optimised Carry Skip Adder using AOI Logic
IRJET -  	  Realization of Power Optimised Carry Skip Adder using AOI LogicIRJET -  	  Realization of Power Optimised Carry Skip Adder using AOI Logic
IRJET - Realization of Power Optimised Carry Skip Adder using AOI Logic
 
Lecture 10: Navigation
Lecture 10: NavigationLecture 10: Navigation
Lecture 10: Navigation
 
Performance analysis on color image mosaicing techniques on FPGA
Performance analysis on color image mosaicing techniques on FPGAPerformance analysis on color image mosaicing techniques on FPGA
Performance analysis on color image mosaicing techniques on FPGA
 
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
 
Robotics for Path Planning
Robotics for Path PlanningRobotics for Path Planning
Robotics for Path Planning
 
40120130406008
4012013040600840120130406008
40120130406008
 
Path Planning for Mobile Robots
Path Planning for Mobile RobotsPath Planning for Mobile Robots
Path Planning for Mobile Robots
 
G1802053147
G1802053147G1802053147
G1802053147
 
A comprehensive study of different image super resolution reconstruction algo...
A comprehensive study of different image super resolution reconstruction algo...A comprehensive study of different image super resolution reconstruction algo...
A comprehensive study of different image super resolution reconstruction algo...
 
Enhancement of genetic image watermarking robust against cropping attack
Enhancement of genetic image watermarking robust against cropping attackEnhancement of genetic image watermarking robust against cropping attack
Enhancement of genetic image watermarking robust against cropping attack
 
Grychtol B. et al.: 3D EIT image reconstruction with GREIT.
Grychtol B. et al.: 3D EIT image reconstruction with GREIT.Grychtol B. et al.: 3D EIT image reconstruction with GREIT.
Grychtol B. et al.: 3D EIT image reconstruction with GREIT.
 
20320130406022
2032013040602220320130406022
20320130406022
 
B010430814
B010430814B010430814
B010430814
 
Lec11: Active Contour and Level Set for Medical Image Segmentation
Lec11: Active Contour and Level Set for Medical Image SegmentationLec11: Active Contour and Level Set for Medical Image Segmentation
Lec11: Active Contour and Level Set for Medical Image Segmentation
 
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
 
Path Planning Algorithms for Unmanned Aerial Vehicles
Path Planning Algorithms for Unmanned Aerial VehiclesPath Planning Algorithms for Unmanned Aerial Vehicles
Path Planning Algorithms for Unmanned Aerial Vehicles
 
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
 
SPPRA'2013 Paper Presentation
SPPRA'2013 Paper PresentationSPPRA'2013 Paper Presentation
SPPRA'2013 Paper Presentation
 

Similar to Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles

E0333021025
E0333021025E0333021025
E0333021025
theijes
 
A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas
A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas
A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas
cscpconf
 
Real time implementation of unscented kalman filter for target tracking
Real time implementation of unscented kalman filter for target trackingReal time implementation of unscented kalman filter for target tracking
Real time implementation of unscented kalman filter for target trackingIAEME Publication
 
Boosting CED Using Robust Orientation Estimation
Boosting CED Using Robust Orientation EstimationBoosting CED Using Robust Orientation Estimation
Boosting CED Using Robust Orientation Estimation
ijma
 
Boosting ced using robust orientation estimation
Boosting ced using robust orientation estimationBoosting ced using robust orientation estimation
Boosting ced using robust orientation estimation
ijma
 
Kernel based similarity estimation and real time tracking of moving
Kernel based similarity estimation and real time tracking of movingKernel based similarity estimation and real time tracking of moving
Kernel based similarity estimation and real time tracking of movingIAEME Publication
 
Path Loss Prediction by Robust Regression Methods
Path Loss Prediction by Robust Regression MethodsPath Loss Prediction by Robust Regression Methods
Path Loss Prediction by Robust Regression Methods
ijceronline
 
NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...
NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...
NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...
paperpublications3
 
Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...
Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...
Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...
International Journal of Latest Research in Engineering and Technology
 
ANALYSIS OF INTEREST POINTS OF CURVELET COEFFICIENTS CONTRIBUTIONS OF MICROS...
ANALYSIS OF INTEREST POINTS OF CURVELET  COEFFICIENTS CONTRIBUTIONS OF MICROS...ANALYSIS OF INTEREST POINTS OF CURVELET  COEFFICIENTS CONTRIBUTIONS OF MICROS...
ANALYSIS OF INTEREST POINTS OF CURVELET COEFFICIENTS CONTRIBUTIONS OF MICROS...
sipij
 
Paper id 21201483
Paper id 21201483Paper id 21201483
Paper id 21201483IJRAT
 
Projection methods for stochastic structural dynamics
Projection methods for stochastic structural dynamicsProjection methods for stochastic structural dynamics
Projection methods for stochastic structural dynamics
University of Glasgow
 
AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...
AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...
AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...
IJCSEIT Journal
 
Kinematics Modeling and Simulation of SCARA Robot Arm
Kinematics Modeling and Simulation of SCARA Robot ArmKinematics Modeling and Simulation of SCARA Robot Arm
Kinematics Modeling and Simulation of SCARA Robot Arm
International Journal of Modern Research in Engineering and Technology
 

Similar to Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles (20)

E0333021025
E0333021025E0333021025
E0333021025
 
A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas
A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas
A Performance Analysis of CLMS and Augmented CLMS Algorithms for Smart Antennas
 
Paper
PaperPaper
Paper
 
Real time implementation of unscented kalman filter for target tracking
Real time implementation of unscented kalman filter for target trackingReal time implementation of unscented kalman filter for target tracking
Real time implementation of unscented kalman filter for target tracking
 
Boosting CED Using Robust Orientation Estimation
Boosting CED Using Robust Orientation EstimationBoosting CED Using Robust Orientation Estimation
Boosting CED Using Robust Orientation Estimation
 
40120140501004
4012014050100440120140501004
40120140501004
 
40120140501004
4012014050100440120140501004
40120140501004
 
Boosting ced using robust orientation estimation
Boosting ced using robust orientation estimationBoosting ced using robust orientation estimation
Boosting ced using robust orientation estimation
 
Kernel based similarity estimation and real time tracking of moving
Kernel based similarity estimation and real time tracking of movingKernel based similarity estimation and real time tracking of moving
Kernel based similarity estimation and real time tracking of moving
 
Path Loss Prediction by Robust Regression Methods
Path Loss Prediction by Robust Regression MethodsPath Loss Prediction by Robust Regression Methods
Path Loss Prediction by Robust Regression Methods
 
NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...
NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...
NUMBER PLATE IMAGE DETECTION FOR FAST MOTION VEHICLES USING BLUR KERNEL ESTIM...
 
Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...
Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...
Basics Of Kalman Filter And Position Estimation Of Front Wheel Automatic Stee...
 
ANALYSIS OF INTEREST POINTS OF CURVELET COEFFICIENTS CONTRIBUTIONS OF MICROS...
ANALYSIS OF INTEREST POINTS OF CURVELET  COEFFICIENTS CONTRIBUTIONS OF MICROS...ANALYSIS OF INTEREST POINTS OF CURVELET  COEFFICIENTS CONTRIBUTIONS OF MICROS...
ANALYSIS OF INTEREST POINTS OF CURVELET COEFFICIENTS CONTRIBUTIONS OF MICROS...
 
05397385
0539738505397385
05397385
 
05397385
0539738505397385
05397385
 
Paper id 21201483
Paper id 21201483Paper id 21201483
Paper id 21201483
 
Projection methods for stochastic structural dynamics
Projection methods for stochastic structural dynamicsProjection methods for stochastic structural dynamics
Projection methods for stochastic structural dynamics
 
AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...
AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...
AN EFFICIENT IMPLEMENTATION OF TRACKING USING KALMAN FILTER FOR UNDERWATER RO...
 
Kinematics Modeling and Simulation of SCARA Robot Arm
Kinematics Modeling and Simulation of SCARA Robot ArmKinematics Modeling and Simulation of SCARA Robot Arm
Kinematics Modeling and Simulation of SCARA Robot Arm
 
12
1212
12
 

More from M. Ilhan Akbas

Goss_ICCVE 2022.pdf
Goss_ICCVE 2022.pdfGoss_ICCVE 2022.pdf
Goss_ICCVE 2022.pdf
M. Ilhan Akbas
 
IV2021-431-slides.pdf
IV2021-431-slides.pdfIV2021-431-slides.pdf
IV2021-431-slides.pdf
M. Ilhan Akbas
 
Akbas-DASC-2022.pdf
Akbas-DASC-2022.pdfAkbas-DASC-2022.pdf
Akbas-DASC-2022.pdf
M. Ilhan Akbas
 
Validation Framework for Autonomous Aerial Vehicles
Validation Framework for Autonomous Aerial VehiclesValidation Framework for Autonomous Aerial Vehicles
Validation Framework for Autonomous Aerial Vehicles
M. Ilhan Akbas
 
Scenario Generation for Validating Artifi cial Intelligence Based Autonomous ...
Scenario Generation for Validating Artificial Intelligence Based Autonomous ...Scenario Generation for Validating Artificial Intelligence Based Autonomous ...
Scenario Generation for Validating Artifi cial Intelligence Based Autonomous ...
M. Ilhan Akbas
 
Generation of Autonomous Vehicle Validation Scenarios Using Crash Data
Generation of Autonomous Vehicle Validation Scenarios Using Crash DataGeneration of Autonomous Vehicle Validation Scenarios Using Crash Data
Generation of Autonomous Vehicle Validation Scenarios Using Crash Data
M. Ilhan Akbas
 
Development of a Validation Regime for an Autonomous Campus Shuttle
Development of a Validation Regime for an Autonomous Campus ShuttleDevelopment of a Validation Regime for an Autonomous Campus Shuttle
Development of a Validation Regime for an Autonomous Campus Shuttle
M. Ilhan Akbas
 
Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...
Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...
Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...
M. Ilhan Akbas
 
Street Network Generation with Adjustable Complexity Using k-Means Clustering
Street Network Generation with Adjustable Complexity Using k-Means ClusteringStreet Network Generation with Adjustable Complexity Using k-Means Clustering
Street Network Generation with Adjustable Complexity Using k-Means Clustering
M. Ilhan Akbas
 
Requirements for the Next-Generation Autonomous Vehicle Ecosystem
Requirements for the Next-Generation Autonomous Vehicle EcosystemRequirements for the Next-Generation Autonomous Vehicle Ecosystem
Requirements for the Next-Generation Autonomous Vehicle Ecosystem
M. Ilhan Akbas
 
Abstract Simulation Scenario Generation for Autonomous Vehicle Verification
Abstract Simulation Scenario Generation  for Autonomous Vehicle VerificationAbstract Simulation Scenario Generation  for Autonomous Vehicle Verification
Abstract Simulation Scenario Generation for Autonomous Vehicle Verification
M. Ilhan Akbas
 
Autonomous Vehicle Testing and Validation at AMI
Autonomous Vehicle Testing and Validation at AMIAutonomous Vehicle Testing and Validation at AMI
Autonomous Vehicle Testing and Validation at AMI
M. Ilhan Akbas
 
Verification of Autonomous Vehicles Through Simulation Using MATLAB ADAS Toolbox
Verification of Autonomous Vehicles Through Simulation Using MATLAB ADAS ToolboxVerification of Autonomous Vehicles Through Simulation Using MATLAB ADAS Toolbox
Verification of Autonomous Vehicles Through Simulation Using MATLAB ADAS Toolbox
M. Ilhan Akbas
 
SAPFANET: Spatially Adaptive Positioning for FANETs
SAPFANET: Spatially Adaptive Positioning for FANETsSAPFANET: Spatially Adaptive Positioning for FANETs
SAPFANET: Spatially Adaptive Positioning for FANETs
M. Ilhan Akbas
 
VBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone Systems
VBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone SystemsVBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone Systems
VBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone Systems
M. Ilhan Akbas
 
Professional Network Value in Business Incubator Models
Professional Network Value in Business Incubator ModelsProfessional Network Value in Business Incubator Models
Professional Network Value in Business Incubator Models
M. Ilhan Akbas
 
Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...
Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...
Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...
M. Ilhan Akbas
 
Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...
Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...
Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...
M. Ilhan Akbas
 
Social Network Generation and Friend Ranking Based on Mobile Phone Data
Social Network Generation and Friend Ranking Based on Mobile Phone DataSocial Network Generation and Friend Ranking Based on Mobile Phone Data
Social Network Generation and Friend Ranking Based on Mobile Phone Data
M. Ilhan Akbas
 
Design and Development of a Simulation Environment in OPNET Using High Perfor...
Design and Development of a Simulation Environment in OPNET Using High Perfor...Design and Development of a Simulation Environment in OPNET Using High Perfor...
Design and Development of a Simulation Environment in OPNET Using High Perfor...
M. Ilhan Akbas
 

More from M. Ilhan Akbas (20)

Goss_ICCVE 2022.pdf
Goss_ICCVE 2022.pdfGoss_ICCVE 2022.pdf
Goss_ICCVE 2022.pdf
 
IV2021-431-slides.pdf
IV2021-431-slides.pdfIV2021-431-slides.pdf
IV2021-431-slides.pdf
 
Akbas-DASC-2022.pdf
Akbas-DASC-2022.pdfAkbas-DASC-2022.pdf
Akbas-DASC-2022.pdf
 
Validation Framework for Autonomous Aerial Vehicles
Validation Framework for Autonomous Aerial VehiclesValidation Framework for Autonomous Aerial Vehicles
Validation Framework for Autonomous Aerial Vehicles
 
Scenario Generation for Validating Artifi cial Intelligence Based Autonomous ...
Scenario Generation for Validating Artificial Intelligence Based Autonomous ...Scenario Generation for Validating Artificial Intelligence Based Autonomous ...
Scenario Generation for Validating Artifi cial Intelligence Based Autonomous ...
 
Generation of Autonomous Vehicle Validation Scenarios Using Crash Data
Generation of Autonomous Vehicle Validation Scenarios Using Crash DataGeneration of Autonomous Vehicle Validation Scenarios Using Crash Data
Generation of Autonomous Vehicle Validation Scenarios Using Crash Data
 
Development of a Validation Regime for an Autonomous Campus Shuttle
Development of a Validation Regime for an Autonomous Campus ShuttleDevelopment of a Validation Regime for an Autonomous Campus Shuttle
Development of a Validation Regime for an Autonomous Campus Shuttle
 
Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...
Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...
Transportation OS: A Simulation Platform to Explore Breakthrough Concepts in ...
 
Street Network Generation with Adjustable Complexity Using k-Means Clustering
Street Network Generation with Adjustable Complexity Using k-Means ClusteringStreet Network Generation with Adjustable Complexity Using k-Means Clustering
Street Network Generation with Adjustable Complexity Using k-Means Clustering
 
Requirements for the Next-Generation Autonomous Vehicle Ecosystem
Requirements for the Next-Generation Autonomous Vehicle EcosystemRequirements for the Next-Generation Autonomous Vehicle Ecosystem
Requirements for the Next-Generation Autonomous Vehicle Ecosystem
 
Abstract Simulation Scenario Generation for Autonomous Vehicle Verification
Abstract Simulation Scenario Generation  for Autonomous Vehicle VerificationAbstract Simulation Scenario Generation  for Autonomous Vehicle Verification
Abstract Simulation Scenario Generation for Autonomous Vehicle Verification
 
Autonomous Vehicle Testing and Validation at AMI
Autonomous Vehicle Testing and Validation at AMIAutonomous Vehicle Testing and Validation at AMI
Autonomous Vehicle Testing and Validation at AMI
 
Verification of Autonomous Vehicles Through Simulation Using MATLAB ADAS Toolbox
Verification of Autonomous Vehicles Through Simulation Using MATLAB ADAS ToolboxVerification of Autonomous Vehicles Through Simulation Using MATLAB ADAS Toolbox
Verification of Autonomous Vehicles Through Simulation Using MATLAB ADAS Toolbox
 
SAPFANET: Spatially Adaptive Positioning for FANETs
SAPFANET: Spatially Adaptive Positioning for FANETsSAPFANET: Spatially Adaptive Positioning for FANETs
SAPFANET: Spatially Adaptive Positioning for FANETs
 
VBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone Systems
VBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone SystemsVBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone Systems
VBCA: A Virtual Forces Clustering Algorithm for Autonomous Aerial Drone Systems
 
Professional Network Value in Business Incubator Models
Professional Network Value in Business Incubator ModelsProfessional Network Value in Business Incubator Models
Professional Network Value in Business Incubator Models
 
Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...
Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...
Reliable Positioning with Hybrid Antenna Model for Aerial Wireless Sensor and...
 
Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...
Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...
Lightweight Routing with QoS Support in Wireless Sensor and Actor Networks (L...
 
Social Network Generation and Friend Ranking Based on Mobile Phone Data
Social Network Generation and Friend Ranking Based on Mobile Phone DataSocial Network Generation and Friend Ranking Based on Mobile Phone Data
Social Network Generation and Friend Ranking Based on Mobile Phone Data
 
Design and Development of a Simulation Environment in OPNET Using High Perfor...
Design and Development of a Simulation Environment in OPNET Using High Perfor...Design and Development of a Simulation Environment in OPNET Using High Perfor...
Design and Development of a Simulation Environment in OPNET Using High Perfor...
 

Recently uploaded

De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...
De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...
De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...
Product School
 
Transcript: Selling digital books in 2024: Insights from industry leaders - T...
Transcript: Selling digital books in 2024: Insights from industry leaders - T...Transcript: Selling digital books in 2024: Insights from industry leaders - T...
Transcript: Selling digital books in 2024: Insights from industry leaders - T...
BookNet Canada
 
JMeter webinar - integration with InfluxDB and Grafana
JMeter webinar - integration with InfluxDB and GrafanaJMeter webinar - integration with InfluxDB and Grafana
JMeter webinar - integration with InfluxDB and Grafana
RTTS
 
FIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdf
FIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdfFIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdf
FIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdf
FIDO Alliance
 
Key Trends Shaping the Future of Infrastructure.pdf
Key Trends Shaping the Future of Infrastructure.pdfKey Trends Shaping the Future of Infrastructure.pdf
Key Trends Shaping the Future of Infrastructure.pdf
Cheryl Hung
 
Elevating Tactical DDD Patterns Through Object Calisthenics
Elevating Tactical DDD Patterns Through Object CalisthenicsElevating Tactical DDD Patterns Through Object Calisthenics
Elevating Tactical DDD Patterns Through Object Calisthenics
Dorra BARTAGUIZ
 
State of ICS and IoT Cyber Threat Landscape Report 2024 preview
State of ICS and IoT Cyber Threat Landscape Report 2024 previewState of ICS and IoT Cyber Threat Landscape Report 2024 preview
State of ICS and IoT Cyber Threat Landscape Report 2024 preview
Prayukth K V
 
Bits & Pixels using AI for Good.........
Bits & Pixels using AI for Good.........Bits & Pixels using AI for Good.........
Bits & Pixels using AI for Good.........
Alison B. Lowndes
 
Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...
Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...
Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...
Thierry Lestable
 
Essentials of Automations: Optimizing FME Workflows with Parameters
Essentials of Automations: Optimizing FME Workflows with ParametersEssentials of Automations: Optimizing FME Workflows with Parameters
Essentials of Automations: Optimizing FME Workflows with Parameters
Safe Software
 
Leading Change strategies and insights for effective change management pdf 1.pdf
Leading Change strategies and insights for effective change management pdf 1.pdfLeading Change strategies and insights for effective change management pdf 1.pdf
Leading Change strategies and insights for effective change management pdf 1.pdf
OnBoard
 
Securing your Kubernetes cluster_ a step-by-step guide to success !
Securing your Kubernetes cluster_ a step-by-step guide to success !Securing your Kubernetes cluster_ a step-by-step guide to success !
Securing your Kubernetes cluster_ a step-by-step guide to success !
KatiaHIMEUR1
 
Generating a custom Ruby SDK for your web service or Rails API using Smithy
Generating a custom Ruby SDK for your web service or Rails API using SmithyGenerating a custom Ruby SDK for your web service or Rails API using Smithy
Generating a custom Ruby SDK for your web service or Rails API using Smithy
g2nightmarescribd
 
FIDO Alliance Osaka Seminar: Passkeys at Amazon.pdf
FIDO Alliance Osaka Seminar: Passkeys at Amazon.pdfFIDO Alliance Osaka Seminar: Passkeys at Amazon.pdf
FIDO Alliance Osaka Seminar: Passkeys at Amazon.pdf
FIDO Alliance
 
FIDO Alliance Osaka Seminar: FIDO Security Aspects.pdf
FIDO Alliance Osaka Seminar: FIDO Security Aspects.pdfFIDO Alliance Osaka Seminar: FIDO Security Aspects.pdf
FIDO Alliance Osaka Seminar: FIDO Security Aspects.pdf
FIDO Alliance
 
AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...
AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...
AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...
Product School
 
GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...
GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...
GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...
Sri Ambati
 
Monitoring Java Application Security with JDK Tools and JFR Events
Monitoring Java Application Security with JDK Tools and JFR EventsMonitoring Java Application Security with JDK Tools and JFR Events
Monitoring Java Application Security with JDK Tools and JFR Events
Ana-Maria Mihalceanu
 
Encryption in Microsoft 365 - ExpertsLive Netherlands 2024
Encryption in Microsoft 365 - ExpertsLive Netherlands 2024Encryption in Microsoft 365 - ExpertsLive Netherlands 2024
Encryption in Microsoft 365 - ExpertsLive Netherlands 2024
Albert Hoitingh
 
Epistemic Interaction - tuning interfaces to provide information for AI support
Epistemic Interaction - tuning interfaces to provide information for AI supportEpistemic Interaction - tuning interfaces to provide information for AI support
Epistemic Interaction - tuning interfaces to provide information for AI support
Alan Dix
 

Recently uploaded (20)

De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...
De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...
De-mystifying Zero to One: Design Informed Techniques for Greenfield Innovati...
 
Transcript: Selling digital books in 2024: Insights from industry leaders - T...
Transcript: Selling digital books in 2024: Insights from industry leaders - T...Transcript: Selling digital books in 2024: Insights from industry leaders - T...
Transcript: Selling digital books in 2024: Insights from industry leaders - T...
 
JMeter webinar - integration with InfluxDB and Grafana
JMeter webinar - integration with InfluxDB and GrafanaJMeter webinar - integration with InfluxDB and Grafana
JMeter webinar - integration with InfluxDB and Grafana
 
FIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdf
FIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdfFIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdf
FIDO Alliance Osaka Seminar: Passkeys and the Road Ahead.pdf
 
Key Trends Shaping the Future of Infrastructure.pdf
Key Trends Shaping the Future of Infrastructure.pdfKey Trends Shaping the Future of Infrastructure.pdf
Key Trends Shaping the Future of Infrastructure.pdf
 
Elevating Tactical DDD Patterns Through Object Calisthenics
Elevating Tactical DDD Patterns Through Object CalisthenicsElevating Tactical DDD Patterns Through Object Calisthenics
Elevating Tactical DDD Patterns Through Object Calisthenics
 
State of ICS and IoT Cyber Threat Landscape Report 2024 preview
State of ICS and IoT Cyber Threat Landscape Report 2024 previewState of ICS and IoT Cyber Threat Landscape Report 2024 preview
State of ICS and IoT Cyber Threat Landscape Report 2024 preview
 
Bits & Pixels using AI for Good.........
Bits & Pixels using AI for Good.........Bits & Pixels using AI for Good.........
Bits & Pixels using AI for Good.........
 
Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...
Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...
Empowering NextGen Mobility via Large Action Model Infrastructure (LAMI): pav...
 
Essentials of Automations: Optimizing FME Workflows with Parameters
Essentials of Automations: Optimizing FME Workflows with ParametersEssentials of Automations: Optimizing FME Workflows with Parameters
Essentials of Automations: Optimizing FME Workflows with Parameters
 
Leading Change strategies and insights for effective change management pdf 1.pdf
Leading Change strategies and insights for effective change management pdf 1.pdfLeading Change strategies and insights for effective change management pdf 1.pdf
Leading Change strategies and insights for effective change management pdf 1.pdf
 
Securing your Kubernetes cluster_ a step-by-step guide to success !
Securing your Kubernetes cluster_ a step-by-step guide to success !Securing your Kubernetes cluster_ a step-by-step guide to success !
Securing your Kubernetes cluster_ a step-by-step guide to success !
 
Generating a custom Ruby SDK for your web service or Rails API using Smithy
Generating a custom Ruby SDK for your web service or Rails API using SmithyGenerating a custom Ruby SDK for your web service or Rails API using Smithy
Generating a custom Ruby SDK for your web service or Rails API using Smithy
 
FIDO Alliance Osaka Seminar: Passkeys at Amazon.pdf
FIDO Alliance Osaka Seminar: Passkeys at Amazon.pdfFIDO Alliance Osaka Seminar: Passkeys at Amazon.pdf
FIDO Alliance Osaka Seminar: Passkeys at Amazon.pdf
 
FIDO Alliance Osaka Seminar: FIDO Security Aspects.pdf
FIDO Alliance Osaka Seminar: FIDO Security Aspects.pdfFIDO Alliance Osaka Seminar: FIDO Security Aspects.pdf
FIDO Alliance Osaka Seminar: FIDO Security Aspects.pdf
 
AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...
AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...
AI for Every Business: Unlocking Your Product's Universal Potential by VP of ...
 
GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...
GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...
GenAISummit 2024 May 28 Sri Ambati Keynote: AGI Belongs to The Community in O...
 
Monitoring Java Application Security with JDK Tools and JFR Events
Monitoring Java Application Security with JDK Tools and JFR EventsMonitoring Java Application Security with JDK Tools and JFR Events
Monitoring Java Application Security with JDK Tools and JFR Events
 
Encryption in Microsoft 365 - ExpertsLive Netherlands 2024
Encryption in Microsoft 365 - ExpertsLive Netherlands 2024Encryption in Microsoft 365 - ExpertsLive Netherlands 2024
Encryption in Microsoft 365 - ExpertsLive Netherlands 2024
 
Epistemic Interaction - tuning interfaces to provide information for AI support
Epistemic Interaction - tuning interfaces to provide information for AI supportEpistemic Interaction - tuning interfaces to provide information for AI support
Epistemic Interaction - tuning interfaces to provide information for AI support
 

Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles

  • 1. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles Harish Chintakunta1 Mustafa ˙Ilhan Akba¸s2 1Department of Electrical and Computer Engineering Florida Polytechnic University 2Electrical, Computer, Software and Systems Engineering Embry-Riddle Aeronautical University 9th ACM International Symposium on Design and Analysis of Intelligent Vehicular Networks and Applications (DIVANET) November 25, 2019 Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 2. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Emergency vehicle navigation Making way for the EV can take a long time. Drivers feel “hassled” at the appearance of EVs, which leads to bad decisions. There are about 6,500 annual accidents involving ambulances. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 3. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Advantages of Connected Autonomous Vehicles (CAVs) Vehicles can be notified well in advance about an approaching EV. Complex cooperative behavior amongst CAVs can assist the navigation of EVs. EV itself being autonomous can enable complex path planning algorithm to optimize travel time, saving lives. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 4. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Our view of the problem We now consider the problem when all other vehicles drive cooperatively to assist an EV. Facilitating safety for EV is rephrased using topological features. The space of feasible paths for EV should be “strongly connected”, in other words, no “bottle necks”. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 5. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Formulation in terms of graph theory 1 Discretize the space and draw edges between neighboring vertices. 2 Encode the safety information onto edge weights. 3 The weight we = 1 − e−d(s,e) on an edge is a decreasing function of the distance from a surrounding vehicle. 4 In this example, we would want the surrounding vehicle to move away from the central edge. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 6. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Inspiration from spectral properties Graph Laplacian L defined as L = D − A, has the following useful property (M.Fiedler, 1973): λ2(L) ≤ σe(G), where σe(G) is the edge connectivity. More importantly, in weighted graphs, the eigenvalues of L are sensitive to weights of the edges in an edge cut set. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 7. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Properties of λ2(L) 1 λ2(LΛ) is very sensitive to weights of edges which “connect” distinct components. 2 The gradient of λ2(LΛ) w.r.t the elements of L can be analytically expressed. 3 Numerical computation of the gradient of λ2(LΛ) also tends to be accurate even for large LΛ matrices, making it ideal for numerical optimization algorithms. −0.2 −0.1 0.0 0.1 0.2 −1.00 −0.75 −0.50 −0.25 0.00 0.25 0.50 0.75 1.00 0 1 2 3 4 5 6 7 8 9 10 11 12 13 14 15 16 17 18 19 0.2 0.4 0.6 0.8 1.0 weight of the linking edge 0.0025 0.0050 0.0075 0.0100 0.0125 0.0150 0.0175 secondeigenvalue linking edge insider edge Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 8. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results λ2(L) as a function of vehicle position 1 λ2(L) gets smaller when the vehicle approaches the critical edge. 2 If fact, the gradient x λ2(L) consistently points away from the central edge. 3 In this choice of the weight function, the value is independent of the position x, given x is “far” from the critical edge. 0.0 0.5 1.0 1.5 2.0 2.5 3.0 3.5 4.0 0 2 4 6 8 0.000 0.005 0.010 0.015 0.020 0.025 0.030 0.035 Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 9. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Putting things together Construct a graph G = (V, E) with discretized points in the space as vertices, and edges between vertices in a geometrical neighborhood. Λ : configuration of the obstacles. Assign weights wΛ : E → [0, 1], where wΛ(e) is a function of distances between the edge and all other obstacles. LΛ((ui, uj)) = −wΛ((ui, uj)), ui = uj uk =ui wΛ((ui, uk )), ui = uj The second eigenvalue λ2(LΛ) will serve as a good measure for connectivity. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 10. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Framing as an optimization problem EV SV 0 1 2 3 4 5 6 7 8 0.00 0.25 0.50 0.75 1.00 1.25 1.50 1.75 2.00 0 1 2 3 4 5 6 7 8 0 1 2 3 4 5 6 7 8 0.000.250.500.751.001.251.501.752.00 0 1 2 3 4 5 6 7 8 Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 11. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Solution to optimization problem 1 The acceleration functions of the surrounding vehicles are optimized to provide a safe path to the EV. 2 Providing a safe path translates to “Make a stronger connected component” 3 The above objective is achieved by: {a∗ i (t)} = arg max{ai(t)} λ2(LΛ) s.t. Safety and boundary constraints on Λ Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 12. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Results Movement without control: 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 Movement with control: 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 0 5 10 0 1 2 Optimized acceleration functions: 0 1 2 3 4 5 6 7 8 −0.3 −0.2 −0.1 0.0 0.1 0.2 0.3 x-acceleration y-acceleration Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 13. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Conclusions 1 The “safety” of the situation with respect to navigation of EV in captured by λ2(L) of a suitably constructed graph. 2 The configuration of the surrounding vehicles is altered to improve the safety measure. 3 The alteration of the surrounding vehicle configuration is achieved by moving them along the gradient direction of the safety measure. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 14. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Future directions 1 Distributed algorithms to compute the gradient of the configuration. 2 Statistical analysis in a realistic traffic situation. 3 Deeper understanding of the theoretical aspects of Fiedler vector in the context of optimal cooperative driving. Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles
  • 15. Problem context Mapping onto graphs Graph spectral properties Problem formalization Results Thank you!! Harish Chintakunta1 , Mustafa ˙Ilhan Akba¸s2 FPU & ERAU Spectrum Analytic Approach for Cooperative Navigation of Connected and Autonomous Vehicles