SlideShare a Scribd company logo
1 of 9
Download to read offline
IOSR Journal of Electrical and Electronics Engineering (IOSR-JEEE)
e-ISSN: 2278-1676,p-ISSN: 2320-3331, Volume 10, Issue 1 Ver. I (Jan – Feb. 2015), PP 94-102
www.iosrjournals.org
DOI: 10.9790/1676-101194102 www.iosrjournals.org 94 | Page
Automatic parking and platooning for electric vehicles
redistribution in a car-sharing application
Mohamed Marouf1
, Evangeline Pollard1
, Fawzi Nashashibi1
1
RITS Project-Team, INRIA Paris-Rocquencourt, France
Abstract: In car-sharing applications and during certain time slots, some parking stations become full whereas
others are empty. To redress this imbalance, vehicle redistribution strategies must be elaborated. As automatic
relocation cannot be in place, one alternative is to get a leader vehicle, driven by a human, which come to pick
up and drop off vehicles over the stations. This paper deals with the vehicle redistribution problem among
parking stations using this strategy and focusing on automatic parking and vehicle platooning. We present an
easy exit parking controller and path planning based only on geometric approach and vehicle's characteristics.
Once the vehicle exits the parking, it joins a platoon of vehicles and follows it automatically to go to an empty
parking space.
Keywords: Automatic Parking, Platooning, Car-sharing, Path Planning
I. Introduction
Sustainable mobility leads to limit individual properties and to increase resource sharing. This is
particularly true and realistic concerning urban transportation means, where bikes, motorbikes, cars and any new
urban transportation systems[1]can be easily shared due to the high concentration of people. In Paris, for
instance, the trend is to develop self-service mobility services. With the bike sharing system Velib, comprising
14 000 bikes, 1200 stations and 225 000 subscribers, as well as the electric car-sharing system autolib,
comprising 2000 vehicles, 1200 stations and 65 000 subscribers[2], Paris is definitively following this new
mobility trend. Both Velib and autolib systems are conceived as multiple station shared vehicle systems
(MSSVS)[3] for short local trips (home to workplace, or home to the closest station for instance). In these
systems, a group of vehicles is distributed among fixed stations. With MSSVS, round trips can occur but one-
way trips as well, leading to a complicated fleet management. Indeed, the number of vehicles per station can
quickly become imbalanced depending on the rush time and on the location (living areas vs. commercial areas).
There are frequent disparities between the availability of rental vehicle and the number of rental parking spaces.
Relocation strategies are then useful to balance the number of vehicles and meet the demand. To solve this
problem with the Velib system, operators manually displace more than 3000 bikes daily, corresponding to 3 %
of the total fleet motion. For car-sharing system, relocation strategies are more difficult to implement. Various
complicated strategies of relocation have been proposed in the past [4]: ride-sharing (two people travel in one
vehicle to pick up another), equip vehicles with a hitch to tow another vehicle behind, using a scooter which will
be towed back. However, all these strategies suffer from a lack of time and energy efficiency. On the other hand,
even if the tendency is to go towards automation opening new automatic relocation strategies, a fully automatic
relocation, implying the movement of vehicles traveling without a driver on open roads, looks difficult for legal
reasons. One alternative would have to get a leader vehicle with a driver and to regulate the number of vehicles
over stations using platooning. In that way, the leader vehicle would act as an agent which would pick up and
drop off vehicles over the stations.
In this article, we are not dealing with the problem of pickup and delivery which is largely tackled in
the literature [5][6]. We describe the implementation of a new system dedicated to an easy relocation using
automatic parking and platooning for an electric car sharing application. Both perception, planning, control and
communication issues are tackled in this article. A special attention will be given to the control aspects, parking
maneuver and platooning staying challenging issues.
Many researches on parallel parking have been presented with different control approaches. These
approaches can be divided into two categories: one based on stabilizing the vehicle to a target point, the other is
based on path planning. Some controllers of the first group are based on Lyapunov function [7]where the
function's parameters have to be hardly changed according to the free parking space. Other controllers are based
on fuzzy logic [8], neuro-fuzzy control [9] and neural network [10]. These latter controllers need learning
human skills which is limited and not easily extended to more general cases. The second group of controllers are
based on path planning [11][12]. These controllers plan a geometric collision-free path to park (res. retrieve) a
vehicle in (resp. from) a parking space. These controllers can demand heavy computations. For this reason, we
present in this paper an easy way for path planning based on non-holonomic kinematic model of a vehicle.
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 95 | Page
Also, platooning has been studied since the 70's to increase the throughput of roads. PATH in
California [13] and PRAXITELE in France [14][15]were the first pioneering projects. Later on, Auto21
[16]focused on the smooth merging and splitting of platoon considering only highways for platooning-enabled
cars. In SARTRE project[17], platoons are considered fully autonomous except for the leading vehicle, which
will be driven manually, while all other vehicles are free to join and leave the platoon. A model of platooning
vehicles with a constant inter-vehicle spacing has been presented in[18].
The paper is organized as follows. In Section II, a global description of the system elements is
provided. In Section III, the perception issues are described. In Section IV, innovate strategies for automatic
parking and platooning are explained. Finally, in Section V, experimental results are presented, before we
conclude in Section VI.
II. System Description
The general architecture of the relocation system is shown inFig. 1Error! Reference source not
found.. A supervisor centralizes positions of the fleet vehicles. From this information, it will calculate the
operator-based relocation strategy, i.e. finding the best fleet distribution over stations to maximize the system
performances. If necessary, mission orders are sent to the operators through communication knowing the
maximum number of vehicles into a platoon. Missions consist in picking up one or several vehicles from an
overloaded station and drop them off at one or several empty stations. The operator can follow the
accomplishment of its current mission through the Human Machine Interface (HMI). Its accomplishment is also
sent to the supervisor.
Fig. 1 general scheme
The leader vehicle can be any automotive vehicle, equipped with communication devices and
localization means. The driver sends orders through a HMI delivered on a tablet. To help the driver, global
planning (itinerary calculation) is made using online maps.
In our application, the shared electric vehicles are equipped with many sensors (Lidar, GPS, etc.) in
order to observe their environment and localize themselves, with computers to process these data, with actuators
to command the vehicle and with Human Machine Interface to interact with the driver. Sensor configuration is
shown inFig. 2Error! Reference source not found.. As data coming from sensors are noisy, inaccurate and
can also be unreliable or unsynchronized, the use of data fusion techniques is required in order to provide the
most accurate situation assessment as possible. For this application, situation assessment consists in merging
information about the vehicle state by itself (position, velocity, acceleration, battery level, etc.) to accurately
localize the vehicle; in detecting potential obstacles like other vehicles, bicycles or pedestrians. Local planning
is made to calculate the vehicle path according to the scenario (parking input/output, platooning) and the
corresponding commands for the lateral and longitudinal control are sent to the low-level controller.
When the head vehicle of a platoon receives a mission order to pick up a shared vehicle localized with
GPS position, the platoon moves to that position and stop in such a way that the tail vehicle of the platoon will
be in front of the parked vehicle in order to let it exit the parking.The platoon's heads vehicle communicate with
the parked vehicle to start the exit parking maneuver. The parked vehicle starts to exit the parking. Once this
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 96 | Page
maneuver finished, it detects the last vehicle of the platoon and join the platoon, then it acknowledges the head
vehicle that the exit parking maneuver is finished and it becomes the tail vehicle. The head vehicle updates the
new platoon configuration and send it to the supervisor. Once the platoon arrives to the empty parking, it stops
and send order to the platoon vehicles to park one by one. When all shared vehicles are parked or the parking
becomes full, the head vehicle updates its configuration and send it to the supervisor, then continues following
the supervisor orders.
Fig. 2 sensors and actuators of the electric vehicle Cycab
III. Perception Issues
Relatively to this automatic parking and platooning application, the main tasks of perception is obstacle
detection and object tracking as it is described in the section below.
3.1. Multi object detection and tracking
This algorithm executes 5 steps as follows:
ο‚· In the Data processing step (1), distances coming from the front and rear laser sensors are converted into
(x,y,z) points in the local Cartesian coordinate system. They are then sorted depending on their angle to the
coordinate system center.
ο‚· In the Segmentation step (2), a Cluster-based Recursive Line fitting algorithm is used with parameter d'1
and d'2 for the maximum distances to the closest segment and between two successive segments respectively
[19].
ο‚· In the Clustering step (3), segments are associated to create objects. Considering our parking application,
close obstacles are considered and objects with less than 5 laser impacts are filtered.
ο‚· In the Classification step (4), size and shape consideration are used to obtain a raw classification of the
object.
ο‚· In the Tracking step (5), information about the ego-vehicle dynamics are considered (velocity and steering
angle) to improve the tracking of the object in the local Cartesian coordinate system.Object tracking is done
in relative coordinates regarding the ego-vehicle using a Constant Velocity Kalman filter and Nearest
Neighbor approach for data association.
3.1. Head/Rear vehicle selection
During the exit parking maneuver, closest front and rear cars are selected to calculate front and back
distances. In case a pedestrian or any smaller obstacle is detected around the ego-vehicle, an emergency stop is
applied. Then, for the platooning input, the front vehicle is detected as a vehicle, following a car shape, which is
the closest obstacle in a corridor surrounding the vehicle path.
IV. Control Strategies
We first present the parallel exit parking controller which allows retrieving a vehicle from a parking
space to be at the tail of the platoon. Then, we present the platooning longitudinal and lateral controllers. The
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 97 | Page
parallel parking controller is not specifically described because it is the exact reverse maneuver in comparison to
the parallel exit parking controller.
4.1. Exit parking controller
The aim of this controller is to retrieve a vehicle from its parking space to a final position which is
parallel to its initial position. The closed loop of this controller is given byFig. 3. Front and back lasers are used
to detect the front and back vehicles, and other obstacles to be avoided, and as we need a relative position and
direction, we used an odometer model based on rear wheels incremental encoder sensors.
Fig. 3 functional Structure of Parking Exit Controller
As shown in Fig. 4, a vehicle is characterized by its width w and its length L which is composed of a
wheelbase l and respectively a front and back overhang 𝑒𝑓 and 𝑒 𝑏 . When a vehicle is moving with a constant
steering angle 𝛿, it generates a circular trajectory of a radius R. Also, the vehicle is moving between an inner
circle of radius 𝑅𝑖 and an outer circle of radius Ro. All these circles have the same center 𝐢(π‘₯ 𝑐 , 𝑦𝑐 ).
Fig. 4 geometry of a vehicle turning with a constant steering angle 𝜹
When the vehicle is moving with its maximum steering angle 𝛿 π‘šπ‘Žπ‘₯ , we obtain the minimum values of the
previous defined radii. 𝑅 π‘šπ‘–π‘› , 𝑅𝑖 π‘šπ‘–π‘›
and 𝑅 π‘œ π‘šπ‘–π‘›
are respectively given by:
𝑅 π‘šπ‘–π‘› =
l
tan Ξ΄ π‘šπ‘Žπ‘₯
𝑅𝑖 π‘šπ‘–π‘›
=
l
tan Ξ΄ π‘šπ‘Žπ‘₯
βˆ’
w
2
By using Pythagorean theorem we obtain:
𝑅 π‘œ π‘šπ‘–π‘›
= 𝑅 π‘šπ‘–π‘› +
w
2
2
+ 𝑙 + 𝑒𝑓
2
The exit parking can be done in one trial (cf.Fig. 5(a)andFig. 5(b)) or many trials (cf.Fig. 6). For one
trial maneuver, the vehicle needs enough space between the ego and the front parked vehicle. In this case, the
vehicle's trajectory is combined by two tangent circular arcs connected by the turning point. The minimum
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 98 | Page
space allowing one trial maneuver is determined by the static vehicle's back left edge point E(xe,ye) (cf.Fig.
5(b)). This latter must be outside the circle of radius𝑅 π‘œ π‘šπ‘–π‘›
and center C1, and the minimum space Smin
corresponds to the distance between the ego vehicle and the point of the outer circle having y coordinate equal to
ye as shown in Fig. 5(b). In this case, the x coordinate of this point is given by 𝑅 π‘œ π‘šπ‘–π‘›
2
βˆ’ 𝑦1 βˆ’ 𝑦𝑒
2 which
gives
𝑆 π‘šπ‘–π‘› = 𝑅 π‘œ π‘šπ‘–π‘›
2
βˆ’ 𝑅 π‘šπ‘–π‘› βˆ’ 𝑦𝑒
2
(a) parallel parking exit
(b) minimum free space Smin
Fig. 5 parallel parking exit for one maneuver case
If the free space between vehicles is less than Smin, the vehicle has to do many maneuvers as shown
inFig. 6. The first maneuver is to move backward until it reaches a secure distance between vehicles, then we
propose a bang-bang controller based on the minimum spacing computation relatively to the vehicle mobile
referential. However, Sminis always changing because ye will change when the vehicle moves.
If xe< Smin, then the vehicle moves forward with 𝛿 = 𝛿 π‘šπ‘Žπ‘₯ until reaching a secure distance between the
ego vehicle and the front vehicle. Then it moves backward with 𝛿 = βˆ’π›Ώ π‘šπ‘Žπ‘₯ until reaching a secure distance
between the ego vehicle and the back vehicle. However, during this maneuver, if xe < Sminthen the vehicle moves
forward with 𝛿 = 𝛿 π‘šπ‘Žπ‘₯ until reaching the turning point. After, the vehicle continue moving forward but with
𝛿 = βˆ’π›Ώ π‘šπ‘Žπ‘₯ until it becomes parallel to its initial position.
Fig. 6 many trials maneuvers
The turning point is computed according to the vehicle's head angle πœ™. This later must be tangent to a
circle of a radius𝑅 π‘šπ‘–π‘› and a center𝐢2(π‘₯2, 𝑦2). The coordinate y2 is defined by:
𝑦2 = 𝑦 π‘Ÿπ‘’π‘“ βˆ’ 𝑅 π‘šπ‘–π‘›
For each vehicle's position Pi, we define a distance ri as shown inFig. 7. This distance is equal to𝑅 π‘šπ‘–π‘› when the
vehicle is tangent to the circle in the turning point, for instance, inFig. 7, P3 is the turning point.
In the general case, the distance r is given by
π‘Ÿ =
𝑦 + 𝑅 π‘šπ‘–π‘› βˆ’ 𝑦 π‘Ÿπ‘’π‘“
cos⁑(βˆ…)
The turning point is reached ifπ‘Ÿ π‘šπ‘–π‘› β‰₯ 𝑅 π‘šπ‘–π‘› which means
𝑦 β‰₯ 𝑦 π‘Ÿπ‘’π‘“ + 𝑅 π‘šπ‘–π‘› (cos βˆ… βˆ’ 1)
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 99 | Page
Fig. 7 turning point computation
4.2. Platooning controller
Once the vehicle finishes the exit parking maneuver, it detects the tail vehicle of the platoon and
initializes the laser tracking algorithm to track this vehicle with a constant inter-vehicle spacing of 2 meters (dref)
(cf. Fig. 8). The tracking algorithm calculates the relative front vehicles position (π‘‹π‘Ÿπ‘’π‘™ , π‘Œπ‘Ÿπ‘’π‘™ , πœƒπ‘Ÿπ‘’π‘™ ) relatively to
the ego vehicle.
Fig. 8 platoon of two vehicles
We use a classical proportional integral controller to control the velocity 𝜈 𝑑 of the follower vehicle. For a
measured inter-distance 𝑑 𝑑 , the velocity of the follower vehicle is given by:
𝜈 𝑑 = 𝐾𝑝 Β· 𝑒 𝑑 + 𝐾𝑝 Β· 𝑒 𝜏
𝑑
0
π‘‘πœ
where 𝐾𝑝 and 𝐾𝑖 are respectively the proportional and the integral gains, and the error 𝑒(𝑑)is given by:
𝑒 𝑑 = 𝑑 π‘Ÿπ‘’π‘“ βˆ’ 𝑑(𝑑)
We proposed in [20] a lateral controller based on a constant curvature approach, which allows the follower
vehicle movement from its initial position (XF, YF) to the leader vehicle's position (XL, YL) with a constant steer
angle 𝛿.
The steer angle 𝛿 is given by:
𝛿 = tanβˆ’1
2 Β· 𝑙 Β· sin⁑(βˆ…)
Ξ”π‘₯2 + Δ𝑦2
where
Ξ”π‘₯ = 𝑋𝐿 βˆ’ 𝑋 𝐹
Δ𝑦 = π‘ŒπΏ βˆ’ π‘ŒπΉ
βˆ… = tanβˆ’1
Δ𝑦
Ξ”π‘₯
βˆ’ πœƒ
V. Experimental Results
Fig. 9 three vehicles platoon demonstration
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 100 | Page
Our approach has been implemented and tested on our experimental electric vehicles called Cycab and
a combustion vehicle CitroΓ«n C3 (cf.Fig. 9). Cycabs are equipped by an embedded fanless PC having an Intel
Core i7 Pentium and running under Windows 7 64 bits operating system. We implemented high-level exit
parking and platooning controller using RTMaps software [21]. This high-level controller communicates with
the low-level controllers using a CAN bus. The low-level controllers are PID speed and steering controllers
implemented on dsPIC microcontrollers to control 4 DC motors for propulsion and an electric jack for steering
using Curtis power drivers.
We also used Hokuyo UTM-30LX lasers having 30π‘š and 270Β° scanning range and Ibeo LUX laser
having 200 m and 110Β° scanning range. The head vehicle can be any manually driven vehicle. Both head and
follower vehicles are equipped with communication cubes enabling low latency communication, and
considering vehicular communication standard IEEE 802.11p[22].
Fig. 10 laser objects detection
Fig. 10shows the laser impact points and the detected objects of one electric vehicle parked between
two other vehicles, and a tail platoon's vehicle waiting the parked vehicle to exit the parking space and join the
platoon. The parked vehicle is represented by a blue rectangle. Front and back parked vehicles are identified
objects with IDs respectively equal to 4 and 13, where the last vehicle of the platoon has an ID equal to 5. There
is almost 1m space between the parked vehicles, and we also considered a secure distance of about 20cm. Other
detected objects are considered as obstacles.
Fig. 11trajectory of exit parking and platooning
Fig. 11shows the trajectory of the exit parking and the platooning. The left part of the figure shows the
exit parking trajectory. As there was not enough space for one trial maneuver, the exit parking has been done in
six maneuvers. At the end of the last maneuver, the vehicle become parallel to its initial position, it stops then
detects the front vehicle to be tracked. Once done, it switches to the platooning mode and acknowledges the
head vehicle to keep moving. The right part ofFig. 11shows the trajectory of the vehicle following the platoon.
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 101 | Page
(a) velocities (b) steering angles
Fig. 12 vehicle and reference velocities and steering angles
Fig. 12(a)shows the reference velocityπœˆπ‘Ÿπ‘’π‘“ and the measured velocity 𝜈. The reference velocity is
given by the bang-bang controller explained in section IV.πœˆπ‘Ÿπ‘’π‘“ switches six times between +0.3m/s and -0.3m/s
which corresponds to the trajectory given byFig. 11. The velocity 𝜈 follows the velocity referenceπœˆπ‘Ÿπ‘’π‘“ and have
a response time of about 0.1s.
Fig. 12(b) shows the reference steering angle𝛿 π‘Ÿπ‘’π‘“ and the measured steering angle 𝛿. The reference
steering angle switches six times between +0.4rad and -0.4 rad which corresponds to the trajectory of the exit
parking. The measured steering angle 𝛿 is following the reference steering angle. We notice that the curve of 𝛿
is smooth because the driver is an electric jack. Also, there is a delay of about 0.03s which is due to a
mechanical gap between the electric jack and the steering rod. The response time including the delay is about
0.1s.The response times and the delays presented below are also due to the low-level controller's period which is
10 ms and the CAN communication delay between the high-level and the low-level controllers.
VI. Conclusion
In this paper, we described the implementation of a relocation strategy to regulate the number of cars in
several car parks for a car-sharing application. The idea is to get a leader vehicle with a driver, which comes to
pick up and drop off cars (without drivers) over stations using automatic parking and platooning. The path
planning for the automatic vehicles is based on a non-holonomic kinematic model of the vehicle, which is easily
implemented and really efficient. This has been demonstrated over several experimental results.
Perspectives, now, consists in implementing such a relocation strategy including the pickup and
delivery problem and the supervisor communication to get a complete system for vehicle redistribution. Then,
concerning platooning in urban areas, even if the legislation indicates that a platoon of vehicles in France
follows the legal rules dedicated to little train for tourists, there is no doubt that specific strategies should be
employed for urban platoon driving.
References
[1]. E. Farina and E. M. Cepolina, "A new shared vehicle system for urban areas," Transportation Research Part C: Emerging
Technologies, vol. 21, pp. 230 - 243, 2012.
[2]. M. HurΓ© and O. Waine, "From VΓ©lib’ to Autolib’: private corporations’ involvement in urban mobility policy," [Online]. Available:
http://www.metropolitiques.eu/From-Velib-to-Autolib-private.html.
[3]. E. M. C. a. A. Farina, "Urban car sharing: an overview of relocation strategies," WIT Transactions on the Built Environment, vol.
128, pp. 419--431, 2012.
[4]. M. Barth and M. Todd, "Intelligent transportation system architecture for a multi-station shared vehicle system," Intelligent
Transportation Systems, pp. 240-245, 2000.
[5]. M. Dror, D. Fortin and C. Roucairol, "Redistribution of Self-service Electric Cars: A Case of Pickup and Delivery," INRIA,
Rocquencourt, 1998.
[6]. A. G. Kek, R. L. Cheu , Q. Meng and C. H. Fung, "A decision support system for vehicle relocation operations in carsharing
systems," Transportation Research Part E: Logistics and Transportation Review, vol. 45, no. 1, pp. 149 - 158, 2009.
[7]. L. Sungon, K. MinChul , Y. Youngil and C. Wankyun , "Control of a car-like mobile robot for parking problem," in IEEE
International Conference on Robotics and Automation, 1999.
[8]. R. Cabrera-Cosetl, M. Mora-Alvarez and R. Alejos-Palomares, "Self-Parking System Based in a Fuzzy Logic Approach," in
Electrical, Communications, and Computers, 2009. CONIELECOMP 2009. International Conference on, 2009.
[9]. W. Zhi-Long , Y. Chih-Hsiung and G. Tong-Yi , "The design of an autonomous parallel parking neuro-fuzzy controller for a car-
like mobile robot," in SICE Annual Conference 2010, Proceedings of, 2010.
[10]. M. Heinen, F. Osorio, F. Heinen and C. Kelber, "SEVA3D: Using Arti cial Neural Networks to Autonomous Vehicle Parking
Control," in Neural Networks, 2006. IJCNN '06. International Joint Conference on, 2006.
Automatic parking and platooning for electric vehicles redistribution in a car-sharing application
DOI: 10.9790/1676-101194102 www.iosrjournals.org 102 | Page
[11]. H. Vorobieva, N. Minoiu-Enache, S. Glaser and S. Mammar, "Geometric continuous-curvature path planning for automatic parallel
parking," in Networking, Sensing and Control (ICNSC), 2013 10th IEEE International Conference on, 2013.
[12]. B. Muller, J. Deutscher and S. Grodde, "Continuous Curvature Trajectory Design and Feedforward Control for Parking a Car,"
Control Systems Technology, IEEE Transactions on, vol. 15, pp. 541-553, 2007.
[13]. S. Shladover, "PATH at 20 - History and Major Milestones," in Intelligent Transportation Systems Conference, 2006. ITSC '06.
IEEE, 2006.
[14]. P. Daviet and M. Parent, "Longitudinal and lateral servoing of vehicles in a platoon," in Intelligent Vehicles Symposium, 1996.,
Proceedings of the 1996 IEEE, 1996.
[15]. C. Laugier, "Towards autonomous vehicles for future intelligent transportation systems," in Proc. 6th Conf. of Italian Association in
Artificial Intelligence, 1998.
[16]. S. HallΓ© , B. Chaib-draa and J. Laumonier, "Car Platoons Simulated As A Multiagent System," in In: Proc. 4th Workshop on Agent-
Based Simulation, 2003.
[17]. T. Robinson, E. Chan and E. Coelingh, "Operating Platoons On Public Motorways: An Introduction To The SARTRE Platooning
Programme," in 17th World Congress on Intelligent Transport Systems (ITS) 2010, 2010.
[18]. P. Fernandes and U. Nunes, "Platooning with DSRC-based IVC-enabled autonomous vehicles: Adding infrared communications for
IVC reliability improvement," in Intelligent Vehicles Symposium (IV), 2012 IEEE, 2012.
[19]. P. Resende, E. Pollard, H. Li and F. Nashashibi, "Low Speed Automation: technical feasibility of the driving sharing in urban
areas," in IEEE ITSC 2013 - 16th International IEEE Conference on Intelligent Transportation Systems, La Hague, Netherlands,
2013.
[20]. M. Abualhoul, M. Marouf, O. Shagdar and F. Nashashibi, "Platooning Control Using Visible Light Communications: A Feasibility
Study," in Intelligent Transportation Systems - (ITSC), 2013 16th International IEEE Conference on, The Hague, 2013.
[21]. "INTEMPORA," [Online]. Available: http://www.intempora.com.
[22]. S. Eichler, "Performance Evaluation of the IEEE 802.11p WAVE Communication Standard," in Vehicular Technology Conference,
2007. VTC-2007 Fall. 2007 IEEE 66th, 2007.

More Related Content

What's hot

Metro train prototype
Metro train prototypeMetro train prototype
Metro train prototypekajikho9
Β 
IRJET- Automated Traffic Control System
IRJET-  	  Automated Traffic Control SystemIRJET-  	  Automated Traffic Control System
IRJET- Automated Traffic Control SystemIRJET Journal
Β 
Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...
Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...
Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...IRJET Journal
Β 
ITS Implementation in Public Transport Companies - Delhi Cluster Bus Experience
ITS Implementation in Public Transport Companies - Delhi Cluster Bus ExperienceITS Implementation in Public Transport Companies - Delhi Cluster Bus Experience
ITS Implementation in Public Transport Companies - Delhi Cluster Bus ExperienceWRI Ross Center for Sustainable Cities
Β 
Traffic Queueing analysis using VISSIM Software by RK
Traffic Queueing analysis using VISSIM Software by RKTraffic Queueing analysis using VISSIM Software by RK
Traffic Queueing analysis using VISSIM Software by RKRaam Krishna Prakash Jagali
Β 
Intelligent Traffic System for kajang city, Malaysia.
Intelligent Traffic System for kajang city, Malaysia.Intelligent Traffic System for kajang city, Malaysia.
Intelligent Traffic System for kajang city, Malaysia.Yousef Abujubba
Β 
Positioning improvements for Intelligent Transportation Systems (ITS)
Positioning improvements for Intelligent Transportation Systems (ITS)Positioning improvements for Intelligent Transportation Systems (ITS)
Positioning improvements for Intelligent Transportation Systems (ITS)Bastien Terret
Β 
Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...
Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...
Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...IJERDJOURNAL
Β 
Vehicle-2-Vehicle Communication Based on Wireless Sensor Network
Vehicle-2-Vehicle Communication Based on Wireless Sensor NetworkVehicle-2-Vehicle Communication Based on Wireless Sensor Network
Vehicle-2-Vehicle Communication Based on Wireless Sensor NetworkjournalBEEI
Β 
Application of gis in indian railways
Application of gis in indian railwaysApplication of gis in indian railways
Application of gis in indian railwayssumitvikram
Β 
Online/Offline Lane Change Events Detection Algorithms
Online/Offline Lane Change Events Detection AlgorithmsOnline/Offline Lane Change Events Detection Algorithms
Online/Offline Lane Change Events Detection AlgorithmsFeras Tanan
Β 
The Current Transport Policy Environment
The Current Transport Policy Environment The Current Transport Policy Environment
The Current Transport Policy Environment Bakhtiar Zein
Β 
Ieeepro techno solutions 2013 ieee embedded project dynamic traffic control...
Ieeepro techno solutions   2013 ieee embedded project dynamic traffic control...Ieeepro techno solutions   2013 ieee embedded project dynamic traffic control...
Ieeepro techno solutions 2013 ieee embedded project dynamic traffic control...srinivasanece7
Β 
International Refereed Journal of Engineering and Science (IRJES)
International Refereed Journal of Engineering and Science (IRJES)International Refereed Journal of Engineering and Science (IRJES)
International Refereed Journal of Engineering and Science (IRJES)irjes
Β 
Left Turn Display Mechanism for Facilitating Left Hand Turns
Left Turn Display Mechanism for Facilitating Left Hand TurnsLeft Turn Display Mechanism for Facilitating Left Hand Turns
Left Turn Display Mechanism for Facilitating Left Hand TurnsAli Vira
Β 
Intelligent highways ppt
Intelligent highways pptIntelligent highways ppt
Intelligent highways pptDinesh199329
Β 

What's hot (19)

Metro train prototype
Metro train prototypeMetro train prototype
Metro train prototype
Β 
IRJET- Automated Traffic Control System
IRJET-  	  Automated Traffic Control SystemIRJET-  	  Automated Traffic Control System
IRJET- Automated Traffic Control System
Β 
Study on Paratransit in Chennai
Study on Paratransit in ChennaiStudy on Paratransit in Chennai
Study on Paratransit in Chennai
Β 
Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...
Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...
Modeling to Traffic Flow on Indian Expressway and Urban Mid-Block Section usi...
Β 
Akash
AkashAkash
Akash
Β 
ITS Implementation in Public Transport Companies - Delhi Cluster Bus Experience
ITS Implementation in Public Transport Companies - Delhi Cluster Bus ExperienceITS Implementation in Public Transport Companies - Delhi Cluster Bus Experience
ITS Implementation in Public Transport Companies - Delhi Cluster Bus Experience
Β 
Traffic Queueing analysis using VISSIM Software by RK
Traffic Queueing analysis using VISSIM Software by RKTraffic Queueing analysis using VISSIM Software by RK
Traffic Queueing analysis using VISSIM Software by RK
Β 
Intelligent Traffic System for kajang city, Malaysia.
Intelligent Traffic System for kajang city, Malaysia.Intelligent Traffic System for kajang city, Malaysia.
Intelligent Traffic System for kajang city, Malaysia.
Β 
Positioning improvements for Intelligent Transportation Systems (ITS)
Positioning improvements for Intelligent Transportation Systems (ITS)Positioning improvements for Intelligent Transportation Systems (ITS)
Positioning improvements for Intelligent Transportation Systems (ITS)
Β 
Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...
Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...
Application of Cumulative Axle Model To Impute Missing Traffic Data in Defect...
Β 
Vehicle-2-Vehicle Communication Based on Wireless Sensor Network
Vehicle-2-Vehicle Communication Based on Wireless Sensor NetworkVehicle-2-Vehicle Communication Based on Wireless Sensor Network
Vehicle-2-Vehicle Communication Based on Wireless Sensor Network
Β 
Application of gis in indian railways
Application of gis in indian railwaysApplication of gis in indian railways
Application of gis in indian railways
Β 
Online/Offline Lane Change Events Detection Algorithms
Online/Offline Lane Change Events Detection AlgorithmsOnline/Offline Lane Change Events Detection Algorithms
Online/Offline Lane Change Events Detection Algorithms
Β 
Automatic Metro
Automatic MetroAutomatic Metro
Automatic Metro
Β 
The Current Transport Policy Environment
The Current Transport Policy Environment The Current Transport Policy Environment
The Current Transport Policy Environment
Β 
Ieeepro techno solutions 2013 ieee embedded project dynamic traffic control...
Ieeepro techno solutions   2013 ieee embedded project dynamic traffic control...Ieeepro techno solutions   2013 ieee embedded project dynamic traffic control...
Ieeepro techno solutions 2013 ieee embedded project dynamic traffic control...
Β 
International Refereed Journal of Engineering and Science (IRJES)
International Refereed Journal of Engineering and Science (IRJES)International Refereed Journal of Engineering and Science (IRJES)
International Refereed Journal of Engineering and Science (IRJES)
Β 
Left Turn Display Mechanism for Facilitating Left Hand Turns
Left Turn Display Mechanism for Facilitating Left Hand TurnsLeft Turn Display Mechanism for Facilitating Left Hand Turns
Left Turn Display Mechanism for Facilitating Left Hand Turns
Β 
Intelligent highways ppt
Intelligent highways pptIntelligent highways ppt
Intelligent highways ppt
Β 

Viewers also liked

GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...
GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...
GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...IOSR Journals
Β 
A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...
A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...
A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...IOSR Journals
Β 
β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...
β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...
β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...IOSR Journals
Β 
The Production of Triploid Clariobranchus in Indoor Hatchery
The Production of Triploid Clariobranchus in Indoor HatcheryThe Production of Triploid Clariobranchus in Indoor Hatchery
The Production of Triploid Clariobranchus in Indoor HatcheryIOSR Journals
Β 
Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...
Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...
Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...IOSR Journals
Β 
Wireless Data Acquisition System Using ARM Cortex M-3
Wireless Data Acquisition System Using ARM Cortex M-3Wireless Data Acquisition System Using ARM Cortex M-3
Wireless Data Acquisition System Using ARM Cortex M-3IOSR Journals
Β 
Computer aided environment for drawing (to set) fill in the blank from given ...
Computer aided environment for drawing (to set) fill in the blank from given ...Computer aided environment for drawing (to set) fill in the blank from given ...
Computer aided environment for drawing (to set) fill in the blank from given ...IOSR Journals
Β 

Viewers also liked (20)

GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...
GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...
GIZO/P(VDF-TrFE) based dual-channel ferroelectric-gate field-effect transisto...
Β 
C017521927
C017521927C017521927
C017521927
Β 
E010222124
E010222124E010222124
E010222124
Β 
H010344552
H010344552H010344552
H010344552
Β 
H1304025762
H1304025762H1304025762
H1304025762
Β 
L012438186
L012438186L012438186
L012438186
Β 
C017221821
C017221821C017221821
C017221821
Β 
A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...
A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...
A Simple and an Innovative Gas Chromatography Method to Quantify Isopentane i...
Β 
β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...
β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...
β€œEvaluation of Sewing Performance of Plain Twill and Satin Fabrics Based On S...
Β 
The Production of Triploid Clariobranchus in Indoor Hatchery
The Production of Triploid Clariobranchus in Indoor HatcheryThe Production of Triploid Clariobranchus in Indoor Hatchery
The Production of Triploid Clariobranchus in Indoor Hatchery
Β 
P01725105109
P01725105109P01725105109
P01725105109
Β 
I017235662
I017235662I017235662
I017235662
Β 
Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...
Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...
Evaluation of long-term vegetation trends for northeastern of Iraq: Mosul, Ki...
Β 
E017163033
E017163033E017163033
E017163033
Β 
M010127983
M010127983M010127983
M010127983
Β 
A010230105
A010230105A010230105
A010230105
Β 
Wireless Data Acquisition System Using ARM Cortex M-3
Wireless Data Acquisition System Using ARM Cortex M-3Wireless Data Acquisition System Using ARM Cortex M-3
Wireless Data Acquisition System Using ARM Cortex M-3
Β 
J012256367
J012256367J012256367
J012256367
Β 
H0515259
H0515259H0515259
H0515259
Β 
Computer aided environment for drawing (to set) fill in the blank from given ...
Computer aided environment for drawing (to set) fill in the blank from given ...Computer aided environment for drawing (to set) fill in the blank from given ...
Computer aided environment for drawing (to set) fill in the blank from given ...
Β 

Similar to O0101194102

Ieeepro techno solutions ieee 2014 embedded project gps-copilot real-time ...
Ieeepro techno solutions    ieee 2014 embedded project gps-copilot real-time ...Ieeepro techno solutions    ieee 2014 embedded project gps-copilot real-time ...
Ieeepro techno solutions ieee 2014 embedded project gps-copilot real-time ...srinivasanece7
Β 
Smart parking system
Smart parking systemSmart parking system
Smart parking systemslmnsvn
Β 
(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...
(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...
(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...Naoki Shibata
Β 
Automated highway systems
Automated highway systemsAutomated highway systems
Automated highway systemsAglaia Connect
Β 
Development and testing of braking and acceleration features for vehicle adv...
Development and testing of braking and acceleration features  for vehicle adv...Development and testing of braking and acceleration features  for vehicle adv...
Development and testing of braking and acceleration features for vehicle adv...IJECEIAES
Β 
Minimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicleMinimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicleeSAT Journals
Β 
Deep neural network for lateral control of self-driving cars in urban environ...
Deep neural network for lateral control of self-driving cars in urban environ...Deep neural network for lateral control of self-driving cars in urban environ...
Deep neural network for lateral control of self-driving cars in urban environ...IAESIJAI
Β 
A Hybrid Method for Automatic Traffic Control Mechanism
A Hybrid Method for Automatic Traffic Control MechanismA Hybrid Method for Automatic Traffic Control Mechanism
A Hybrid Method for Automatic Traffic Control MechanismMangaiK4
Β 
IRJET - A Review on Multi-Functional Multi-Ability Electric Vehicle
IRJET - A Review on Multi-Functional Multi-Ability Electric VehicleIRJET - A Review on Multi-Functional Multi-Ability Electric Vehicle
IRJET - A Review on Multi-Functional Multi-Ability Electric VehicleIRJET Journal
Β 
Real time deep-learning based traffic volume count for high-traffic urban art...
Real time deep-learning based traffic volume count for high-traffic urban art...Real time deep-learning based traffic volume count for high-traffic urban art...
Real time deep-learning based traffic volume count for high-traffic urban art...Conference Papers
Β 
IRJET- I-Parker-A New Smart Car Parking System
IRJET- I-Parker-A New Smart Car Parking SystemIRJET- I-Parker-A New Smart Car Parking System
IRJET- I-Parker-A New Smart Car Parking SystemIRJET Journal
Β 
Restore and Improve Urban Infrastructure
Restore and Improve Urban InfrastructureRestore and Improve Urban Infrastructure
Restore and Improve Urban InfrastructureShahmeer Baweja
Β 
final_report
final_reportfinal_report
final_reportDevon Bates
Β 
Study of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networksStudy of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networksIAEME Publication
Β 
Study of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networksStudy of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networksIAEME Publication
Β 
DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...
DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...
DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...IAEME Publication
Β 
Vehicle Traffic Analysis using CNN Algorithm
Vehicle Traffic Analysis using CNN AlgorithmVehicle Traffic Analysis using CNN Algorithm
Vehicle Traffic Analysis using CNN AlgorithmIRJET Journal
Β 
Cloud Based Autonomous Vehicle Navigation
Cloud Based Autonomous Vehicle NavigationCloud Based Autonomous Vehicle Navigation
Cloud Based Autonomous Vehicle NavigationWilliam Smith
Β 
Improving traffic and emergency vehicle clearance at congested intersections ...
Improving traffic and emergency vehicle clearance at congested intersections ...Improving traffic and emergency vehicle clearance at congested intersections ...
Improving traffic and emergency vehicle clearance at congested intersections ...IJECEIAES
Β 

Similar to O0101194102 (20)

Ieeepro techno solutions ieee 2014 embedded project gps-copilot real-time ...
Ieeepro techno solutions    ieee 2014 embedded project gps-copilot real-time ...Ieeepro techno solutions    ieee 2014 embedded project gps-copilot real-time ...
Ieeepro techno solutions ieee 2014 embedded project gps-copilot real-time ...
Β 
Smart parking system
Smart parking systemSmart parking system
Smart parking system
Β 
(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...
(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...
(Paper) Parking Navigation for Alleviating Congestion in Multilevel Parking F...
Β 
Automated highway systems
Automated highway systemsAutomated highway systems
Automated highway systems
Β 
Development and testing of braking and acceleration features for vehicle adv...
Development and testing of braking and acceleration features  for vehicle adv...Development and testing of braking and acceleration features  for vehicle adv...
Development and testing of braking and acceleration features for vehicle adv...
Β 
Minimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicleMinimum cost implementation of autonomous vehicle
Minimum cost implementation of autonomous vehicle
Β 
[IJET-V1I3P19] Authors :Nilesh B Karande , Nagaraju Bogiri.
[IJET-V1I3P19] Authors :Nilesh B Karande , Nagaraju Bogiri.[IJET-V1I3P19] Authors :Nilesh B Karande , Nagaraju Bogiri.
[IJET-V1I3P19] Authors :Nilesh B Karande , Nagaraju Bogiri.
Β 
Deep neural network for lateral control of self-driving cars in urban environ...
Deep neural network for lateral control of self-driving cars in urban environ...Deep neural network for lateral control of self-driving cars in urban environ...
Deep neural network for lateral control of self-driving cars in urban environ...
Β 
A Hybrid Method for Automatic Traffic Control Mechanism
A Hybrid Method for Automatic Traffic Control MechanismA Hybrid Method for Automatic Traffic Control Mechanism
A Hybrid Method for Automatic Traffic Control Mechanism
Β 
IRJET - A Review on Multi-Functional Multi-Ability Electric Vehicle
IRJET - A Review on Multi-Functional Multi-Ability Electric VehicleIRJET - A Review on Multi-Functional Multi-Ability Electric Vehicle
IRJET - A Review on Multi-Functional Multi-Ability Electric Vehicle
Β 
Real time deep-learning based traffic volume count for high-traffic urban art...
Real time deep-learning based traffic volume count for high-traffic urban art...Real time deep-learning based traffic volume count for high-traffic urban art...
Real time deep-learning based traffic volume count for high-traffic urban art...
Β 
IRJET- I-Parker-A New Smart Car Parking System
IRJET- I-Parker-A New Smart Car Parking SystemIRJET- I-Parker-A New Smart Car Parking System
IRJET- I-Parker-A New Smart Car Parking System
Β 
Restore and Improve Urban Infrastructure
Restore and Improve Urban InfrastructureRestore and Improve Urban Infrastructure
Restore and Improve Urban Infrastructure
Β 
final_report
final_reportfinal_report
final_report
Β 
Study of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networksStudy of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networks
Β 
Study of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networksStudy of localization techniques in vehicular ad hoc networks
Study of localization techniques in vehicular ad hoc networks
Β 
DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...
DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...
DYNAMIC RESOURCE ALLOCATION IN ROAD TRANSPORT SECTOR USING MOBILE CLOUD COMPU...
Β 
Vehicle Traffic Analysis using CNN Algorithm
Vehicle Traffic Analysis using CNN AlgorithmVehicle Traffic Analysis using CNN Algorithm
Vehicle Traffic Analysis using CNN Algorithm
Β 
Cloud Based Autonomous Vehicle Navigation
Cloud Based Autonomous Vehicle NavigationCloud Based Autonomous Vehicle Navigation
Cloud Based Autonomous Vehicle Navigation
Β 
Improving traffic and emergency vehicle clearance at congested intersections ...
Improving traffic and emergency vehicle clearance at congested intersections ...Improving traffic and emergency vehicle clearance at congested intersections ...
Improving traffic and emergency vehicle clearance at congested intersections ...
Β 

More from IOSR Journals (20)

A011140104
A011140104A011140104
A011140104
Β 
M0111397100
M0111397100M0111397100
M0111397100
Β 
L011138596
L011138596L011138596
L011138596
Β 
K011138084
K011138084K011138084
K011138084
Β 
J011137479
J011137479J011137479
J011137479
Β 
I011136673
I011136673I011136673
I011136673
Β 
G011134454
G011134454G011134454
G011134454
Β 
H011135565
H011135565H011135565
H011135565
Β 
F011134043
F011134043F011134043
F011134043
Β 
E011133639
E011133639E011133639
E011133639
Β 
D011132635
D011132635D011132635
D011132635
Β 
C011131925
C011131925C011131925
C011131925
Β 
B011130918
B011130918B011130918
B011130918
Β 
A011130108
A011130108A011130108
A011130108
Β 
I011125160
I011125160I011125160
I011125160
Β 
H011124050
H011124050H011124050
H011124050
Β 
G011123539
G011123539G011123539
G011123539
Β 
F011123134
F011123134F011123134
F011123134
Β 
E011122530
E011122530E011122530
E011122530
Β 
D011121524
D011121524D011121524
D011121524
Β 

Recently uploaded

Understanding the Laravel MVC Architecture
Understanding the Laravel MVC ArchitectureUnderstanding the Laravel MVC Architecture
Understanding the Laravel MVC ArchitecturePixlogix Infotech
Β 
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdfThe Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdfEnterprise Knowledge
Β 
Histor y of HAM Radio presentation slide
Histor y of HAM Radio presentation slideHistor y of HAM Radio presentation slide
Histor y of HAM Radio presentation slidevu2urc
Β 
CNv6 Instructor Chapter 6 Quality of Service
CNv6 Instructor Chapter 6 Quality of ServiceCNv6 Instructor Chapter 6 Quality of Service
CNv6 Instructor Chapter 6 Quality of Servicegiselly40
Β 
From Event to Action: Accelerate Your Decision Making with Real-Time Automation
From Event to Action: Accelerate Your Decision Making with Real-Time AutomationFrom Event to Action: Accelerate Your Decision Making with Real-Time Automation
From Event to Action: Accelerate Your Decision Making with Real-Time AutomationSafe Software
Β 
WhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure serviceWhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure servicePooja Nehwal
Β 
My Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 PresentationMy Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 PresentationRidwan Fadjar
Β 
Maximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptxMaximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptxOnBoard
Β 
08448380779 Call Girls In Civil Lines Women Seeking Men
08448380779 Call Girls In Civil Lines Women Seeking Men08448380779 Call Girls In Civil Lines Women Seeking Men
08448380779 Call Girls In Civil Lines Women Seeking MenDelhi Call girls
Β 
The 7 Things I Know About Cyber Security After 25 Years | April 2024
The 7 Things I Know About Cyber Security After 25 Years | April 2024The 7 Things I Know About Cyber Security After 25 Years | April 2024
The 7 Things I Know About Cyber Security After 25 Years | April 2024Rafal Los
Β 
🐬 The future of MySQL is Postgres 🐘
🐬  The future of MySQL is Postgres   🐘🐬  The future of MySQL is Postgres   🐘
🐬 The future of MySQL is Postgres 🐘RTylerCroy
Β 
Data Cloud, More than a CDP by Matt Robison
Data Cloud, More than a CDP by Matt RobisonData Cloud, More than a CDP by Matt Robison
Data Cloud, More than a CDP by Matt RobisonAnna Loughnan Colquhoun
Β 
[2024]Digital Global Overview Report 2024 Meltwater.pdf
[2024]Digital Global Overview Report 2024 Meltwater.pdf[2024]Digital Global Overview Report 2024 Meltwater.pdf
[2024]Digital Global Overview Report 2024 Meltwater.pdfhans926745
Β 
How to Troubleshoot Apps for the Modern Connected Worker
How to Troubleshoot Apps for the Modern Connected WorkerHow to Troubleshoot Apps for the Modern Connected Worker
How to Troubleshoot Apps for the Modern Connected WorkerThousandEyes
Β 
Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...
Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...
Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...Miguel AraΓΊjo
Β 
IAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI SolutionsIAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI SolutionsEnterprise Knowledge
Β 
A Domino Admins Adventures (Engage 2024)
A Domino Admins Adventures (Engage 2024)A Domino Admins Adventures (Engage 2024)
A Domino Admins Adventures (Engage 2024)Gabriella Davis
Β 
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024BookNet Canada
Β 
08448380779 Call Girls In Greater Kailash - I Women Seeking Men
08448380779 Call Girls In Greater Kailash - I Women Seeking Men08448380779 Call Girls In Greater Kailash - I Women Seeking Men
08448380779 Call Girls In Greater Kailash - I Women Seeking MenDelhi Call girls
Β 
The Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptxThe Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptxMalak Abu Hammad
Β 

Recently uploaded (20)

Understanding the Laravel MVC Architecture
Understanding the Laravel MVC ArchitectureUnderstanding the Laravel MVC Architecture
Understanding the Laravel MVC Architecture
Β 
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdfThe Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
The Role of Taxonomy and Ontology in Semantic Layers - Heather Hedden.pdf
Β 
Histor y of HAM Radio presentation slide
Histor y of HAM Radio presentation slideHistor y of HAM Radio presentation slide
Histor y of HAM Radio presentation slide
Β 
CNv6 Instructor Chapter 6 Quality of Service
CNv6 Instructor Chapter 6 Quality of ServiceCNv6 Instructor Chapter 6 Quality of Service
CNv6 Instructor Chapter 6 Quality of Service
Β 
From Event to Action: Accelerate Your Decision Making with Real-Time Automation
From Event to Action: Accelerate Your Decision Making with Real-Time AutomationFrom Event to Action: Accelerate Your Decision Making with Real-Time Automation
From Event to Action: Accelerate Your Decision Making with Real-Time Automation
Β 
WhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure serviceWhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure service
WhatsApp 9892124323 βœ“Call Girls In Kalyan ( Mumbai ) secure service
Β 
My Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 PresentationMy Hashitalk Indonesia April 2024 Presentation
My Hashitalk Indonesia April 2024 Presentation
Β 
Maximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptxMaximizing Board Effectiveness 2024 Webinar.pptx
Maximizing Board Effectiveness 2024 Webinar.pptx
Β 
08448380779 Call Girls In Civil Lines Women Seeking Men
08448380779 Call Girls In Civil Lines Women Seeking Men08448380779 Call Girls In Civil Lines Women Seeking Men
08448380779 Call Girls In Civil Lines Women Seeking Men
Β 
The 7 Things I Know About Cyber Security After 25 Years | April 2024
The 7 Things I Know About Cyber Security After 25 Years | April 2024The 7 Things I Know About Cyber Security After 25 Years | April 2024
The 7 Things I Know About Cyber Security After 25 Years | April 2024
Β 
🐬 The future of MySQL is Postgres 🐘
🐬  The future of MySQL is Postgres   🐘🐬  The future of MySQL is Postgres   🐘
🐬 The future of MySQL is Postgres 🐘
Β 
Data Cloud, More than a CDP by Matt Robison
Data Cloud, More than a CDP by Matt RobisonData Cloud, More than a CDP by Matt Robison
Data Cloud, More than a CDP by Matt Robison
Β 
[2024]Digital Global Overview Report 2024 Meltwater.pdf
[2024]Digital Global Overview Report 2024 Meltwater.pdf[2024]Digital Global Overview Report 2024 Meltwater.pdf
[2024]Digital Global Overview Report 2024 Meltwater.pdf
Β 
How to Troubleshoot Apps for the Modern Connected Worker
How to Troubleshoot Apps for the Modern Connected WorkerHow to Troubleshoot Apps for the Modern Connected Worker
How to Troubleshoot Apps for the Modern Connected Worker
Β 
Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...
Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...
Mastering MySQL Database Architecture: Deep Dive into MySQL Shell and MySQL R...
Β 
IAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI SolutionsIAC 2024 - IA Fast Track to Search Focused AI Solutions
IAC 2024 - IA Fast Track to Search Focused AI Solutions
Β 
A Domino Admins Adventures (Engage 2024)
A Domino Admins Adventures (Engage 2024)A Domino Admins Adventures (Engage 2024)
A Domino Admins Adventures (Engage 2024)
Β 
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Transcript: #StandardsGoals for 2024: What’s new for BISAC - Tech Forum 2024
Β 
08448380779 Call Girls In Greater Kailash - I Women Seeking Men
08448380779 Call Girls In Greater Kailash - I Women Seeking Men08448380779 Call Girls In Greater Kailash - I Women Seeking Men
08448380779 Call Girls In Greater Kailash - I Women Seeking Men
Β 
The Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptxThe Codex of Business Writing Software for Real-World Solutions 2.pptx
The Codex of Business Writing Software for Real-World Solutions 2.pptx
Β 

O0101194102

  • 1. IOSR Journal of Electrical and Electronics Engineering (IOSR-JEEE) e-ISSN: 2278-1676,p-ISSN: 2320-3331, Volume 10, Issue 1 Ver. I (Jan – Feb. 2015), PP 94-102 www.iosrjournals.org DOI: 10.9790/1676-101194102 www.iosrjournals.org 94 | Page Automatic parking and platooning for electric vehicles redistribution in a car-sharing application Mohamed Marouf1 , Evangeline Pollard1 , Fawzi Nashashibi1 1 RITS Project-Team, INRIA Paris-Rocquencourt, France Abstract: In car-sharing applications and during certain time slots, some parking stations become full whereas others are empty. To redress this imbalance, vehicle redistribution strategies must be elaborated. As automatic relocation cannot be in place, one alternative is to get a leader vehicle, driven by a human, which come to pick up and drop off vehicles over the stations. This paper deals with the vehicle redistribution problem among parking stations using this strategy and focusing on automatic parking and vehicle platooning. We present an easy exit parking controller and path planning based only on geometric approach and vehicle's characteristics. Once the vehicle exits the parking, it joins a platoon of vehicles and follows it automatically to go to an empty parking space. Keywords: Automatic Parking, Platooning, Car-sharing, Path Planning I. Introduction Sustainable mobility leads to limit individual properties and to increase resource sharing. This is particularly true and realistic concerning urban transportation means, where bikes, motorbikes, cars and any new urban transportation systems[1]can be easily shared due to the high concentration of people. In Paris, for instance, the trend is to develop self-service mobility services. With the bike sharing system Velib, comprising 14 000 bikes, 1200 stations and 225 000 subscribers, as well as the electric car-sharing system autolib, comprising 2000 vehicles, 1200 stations and 65 000 subscribers[2], Paris is definitively following this new mobility trend. Both Velib and autolib systems are conceived as multiple station shared vehicle systems (MSSVS)[3] for short local trips (home to workplace, or home to the closest station for instance). In these systems, a group of vehicles is distributed among fixed stations. With MSSVS, round trips can occur but one- way trips as well, leading to a complicated fleet management. Indeed, the number of vehicles per station can quickly become imbalanced depending on the rush time and on the location (living areas vs. commercial areas). There are frequent disparities between the availability of rental vehicle and the number of rental parking spaces. Relocation strategies are then useful to balance the number of vehicles and meet the demand. To solve this problem with the Velib system, operators manually displace more than 3000 bikes daily, corresponding to 3 % of the total fleet motion. For car-sharing system, relocation strategies are more difficult to implement. Various complicated strategies of relocation have been proposed in the past [4]: ride-sharing (two people travel in one vehicle to pick up another), equip vehicles with a hitch to tow another vehicle behind, using a scooter which will be towed back. However, all these strategies suffer from a lack of time and energy efficiency. On the other hand, even if the tendency is to go towards automation opening new automatic relocation strategies, a fully automatic relocation, implying the movement of vehicles traveling without a driver on open roads, looks difficult for legal reasons. One alternative would have to get a leader vehicle with a driver and to regulate the number of vehicles over stations using platooning. In that way, the leader vehicle would act as an agent which would pick up and drop off vehicles over the stations. In this article, we are not dealing with the problem of pickup and delivery which is largely tackled in the literature [5][6]. We describe the implementation of a new system dedicated to an easy relocation using automatic parking and platooning for an electric car sharing application. Both perception, planning, control and communication issues are tackled in this article. A special attention will be given to the control aspects, parking maneuver and platooning staying challenging issues. Many researches on parallel parking have been presented with different control approaches. These approaches can be divided into two categories: one based on stabilizing the vehicle to a target point, the other is based on path planning. Some controllers of the first group are based on Lyapunov function [7]where the function's parameters have to be hardly changed according to the free parking space. Other controllers are based on fuzzy logic [8], neuro-fuzzy control [9] and neural network [10]. These latter controllers need learning human skills which is limited and not easily extended to more general cases. The second group of controllers are based on path planning [11][12]. These controllers plan a geometric collision-free path to park (res. retrieve) a vehicle in (resp. from) a parking space. These controllers can demand heavy computations. For this reason, we present in this paper an easy way for path planning based on non-holonomic kinematic model of a vehicle.
  • 2. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 95 | Page Also, platooning has been studied since the 70's to increase the throughput of roads. PATH in California [13] and PRAXITELE in France [14][15]were the first pioneering projects. Later on, Auto21 [16]focused on the smooth merging and splitting of platoon considering only highways for platooning-enabled cars. In SARTRE project[17], platoons are considered fully autonomous except for the leading vehicle, which will be driven manually, while all other vehicles are free to join and leave the platoon. A model of platooning vehicles with a constant inter-vehicle spacing has been presented in[18]. The paper is organized as follows. In Section II, a global description of the system elements is provided. In Section III, the perception issues are described. In Section IV, innovate strategies for automatic parking and platooning are explained. Finally, in Section V, experimental results are presented, before we conclude in Section VI. II. System Description The general architecture of the relocation system is shown inFig. 1Error! Reference source not found.. A supervisor centralizes positions of the fleet vehicles. From this information, it will calculate the operator-based relocation strategy, i.e. finding the best fleet distribution over stations to maximize the system performances. If necessary, mission orders are sent to the operators through communication knowing the maximum number of vehicles into a platoon. Missions consist in picking up one or several vehicles from an overloaded station and drop them off at one or several empty stations. The operator can follow the accomplishment of its current mission through the Human Machine Interface (HMI). Its accomplishment is also sent to the supervisor. Fig. 1 general scheme The leader vehicle can be any automotive vehicle, equipped with communication devices and localization means. The driver sends orders through a HMI delivered on a tablet. To help the driver, global planning (itinerary calculation) is made using online maps. In our application, the shared electric vehicles are equipped with many sensors (Lidar, GPS, etc.) in order to observe their environment and localize themselves, with computers to process these data, with actuators to command the vehicle and with Human Machine Interface to interact with the driver. Sensor configuration is shown inFig. 2Error! Reference source not found.. As data coming from sensors are noisy, inaccurate and can also be unreliable or unsynchronized, the use of data fusion techniques is required in order to provide the most accurate situation assessment as possible. For this application, situation assessment consists in merging information about the vehicle state by itself (position, velocity, acceleration, battery level, etc.) to accurately localize the vehicle; in detecting potential obstacles like other vehicles, bicycles or pedestrians. Local planning is made to calculate the vehicle path according to the scenario (parking input/output, platooning) and the corresponding commands for the lateral and longitudinal control are sent to the low-level controller. When the head vehicle of a platoon receives a mission order to pick up a shared vehicle localized with GPS position, the platoon moves to that position and stop in such a way that the tail vehicle of the platoon will be in front of the parked vehicle in order to let it exit the parking.The platoon's heads vehicle communicate with the parked vehicle to start the exit parking maneuver. The parked vehicle starts to exit the parking. Once this
  • 3. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 96 | Page maneuver finished, it detects the last vehicle of the platoon and join the platoon, then it acknowledges the head vehicle that the exit parking maneuver is finished and it becomes the tail vehicle. The head vehicle updates the new platoon configuration and send it to the supervisor. Once the platoon arrives to the empty parking, it stops and send order to the platoon vehicles to park one by one. When all shared vehicles are parked or the parking becomes full, the head vehicle updates its configuration and send it to the supervisor, then continues following the supervisor orders. Fig. 2 sensors and actuators of the electric vehicle Cycab III. Perception Issues Relatively to this automatic parking and platooning application, the main tasks of perception is obstacle detection and object tracking as it is described in the section below. 3.1. Multi object detection and tracking This algorithm executes 5 steps as follows: ο‚· In the Data processing step (1), distances coming from the front and rear laser sensors are converted into (x,y,z) points in the local Cartesian coordinate system. They are then sorted depending on their angle to the coordinate system center. ο‚· In the Segmentation step (2), a Cluster-based Recursive Line fitting algorithm is used with parameter d'1 and d'2 for the maximum distances to the closest segment and between two successive segments respectively [19]. ο‚· In the Clustering step (3), segments are associated to create objects. Considering our parking application, close obstacles are considered and objects with less than 5 laser impacts are filtered. ο‚· In the Classification step (4), size and shape consideration are used to obtain a raw classification of the object. ο‚· In the Tracking step (5), information about the ego-vehicle dynamics are considered (velocity and steering angle) to improve the tracking of the object in the local Cartesian coordinate system.Object tracking is done in relative coordinates regarding the ego-vehicle using a Constant Velocity Kalman filter and Nearest Neighbor approach for data association. 3.1. Head/Rear vehicle selection During the exit parking maneuver, closest front and rear cars are selected to calculate front and back distances. In case a pedestrian or any smaller obstacle is detected around the ego-vehicle, an emergency stop is applied. Then, for the platooning input, the front vehicle is detected as a vehicle, following a car shape, which is the closest obstacle in a corridor surrounding the vehicle path. IV. Control Strategies We first present the parallel exit parking controller which allows retrieving a vehicle from a parking space to be at the tail of the platoon. Then, we present the platooning longitudinal and lateral controllers. The
  • 4. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 97 | Page parallel parking controller is not specifically described because it is the exact reverse maneuver in comparison to the parallel exit parking controller. 4.1. Exit parking controller The aim of this controller is to retrieve a vehicle from its parking space to a final position which is parallel to its initial position. The closed loop of this controller is given byFig. 3. Front and back lasers are used to detect the front and back vehicles, and other obstacles to be avoided, and as we need a relative position and direction, we used an odometer model based on rear wheels incremental encoder sensors. Fig. 3 functional Structure of Parking Exit Controller As shown in Fig. 4, a vehicle is characterized by its width w and its length L which is composed of a wheelbase l and respectively a front and back overhang 𝑒𝑓 and 𝑒 𝑏 . When a vehicle is moving with a constant steering angle 𝛿, it generates a circular trajectory of a radius R. Also, the vehicle is moving between an inner circle of radius 𝑅𝑖 and an outer circle of radius Ro. All these circles have the same center 𝐢(π‘₯ 𝑐 , 𝑦𝑐 ). Fig. 4 geometry of a vehicle turning with a constant steering angle 𝜹 When the vehicle is moving with its maximum steering angle 𝛿 π‘šπ‘Žπ‘₯ , we obtain the minimum values of the previous defined radii. 𝑅 π‘šπ‘–π‘› , 𝑅𝑖 π‘šπ‘–π‘› and 𝑅 π‘œ π‘šπ‘–π‘› are respectively given by: 𝑅 π‘šπ‘–π‘› = l tan Ξ΄ π‘šπ‘Žπ‘₯ 𝑅𝑖 π‘šπ‘–π‘› = l tan Ξ΄ π‘šπ‘Žπ‘₯ βˆ’ w 2 By using Pythagorean theorem we obtain: 𝑅 π‘œ π‘šπ‘–π‘› = 𝑅 π‘šπ‘–π‘› + w 2 2 + 𝑙 + 𝑒𝑓 2 The exit parking can be done in one trial (cf.Fig. 5(a)andFig. 5(b)) or many trials (cf.Fig. 6). For one trial maneuver, the vehicle needs enough space between the ego and the front parked vehicle. In this case, the vehicle's trajectory is combined by two tangent circular arcs connected by the turning point. The minimum
  • 5. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 98 | Page space allowing one trial maneuver is determined by the static vehicle's back left edge point E(xe,ye) (cf.Fig. 5(b)). This latter must be outside the circle of radius𝑅 π‘œ π‘šπ‘–π‘› and center C1, and the minimum space Smin corresponds to the distance between the ego vehicle and the point of the outer circle having y coordinate equal to ye as shown in Fig. 5(b). In this case, the x coordinate of this point is given by 𝑅 π‘œ π‘šπ‘–π‘› 2 βˆ’ 𝑦1 βˆ’ 𝑦𝑒 2 which gives 𝑆 π‘šπ‘–π‘› = 𝑅 π‘œ π‘šπ‘–π‘› 2 βˆ’ 𝑅 π‘šπ‘–π‘› βˆ’ 𝑦𝑒 2 (a) parallel parking exit (b) minimum free space Smin Fig. 5 parallel parking exit for one maneuver case If the free space between vehicles is less than Smin, the vehicle has to do many maneuvers as shown inFig. 6. The first maneuver is to move backward until it reaches a secure distance between vehicles, then we propose a bang-bang controller based on the minimum spacing computation relatively to the vehicle mobile referential. However, Sminis always changing because ye will change when the vehicle moves. If xe< Smin, then the vehicle moves forward with 𝛿 = 𝛿 π‘šπ‘Žπ‘₯ until reaching a secure distance between the ego vehicle and the front vehicle. Then it moves backward with 𝛿 = βˆ’π›Ώ π‘šπ‘Žπ‘₯ until reaching a secure distance between the ego vehicle and the back vehicle. However, during this maneuver, if xe < Sminthen the vehicle moves forward with 𝛿 = 𝛿 π‘šπ‘Žπ‘₯ until reaching the turning point. After, the vehicle continue moving forward but with 𝛿 = βˆ’π›Ώ π‘šπ‘Žπ‘₯ until it becomes parallel to its initial position. Fig. 6 many trials maneuvers The turning point is computed according to the vehicle's head angle πœ™. This later must be tangent to a circle of a radius𝑅 π‘šπ‘–π‘› and a center𝐢2(π‘₯2, 𝑦2). The coordinate y2 is defined by: 𝑦2 = 𝑦 π‘Ÿπ‘’π‘“ βˆ’ 𝑅 π‘šπ‘–π‘› For each vehicle's position Pi, we define a distance ri as shown inFig. 7. This distance is equal to𝑅 π‘šπ‘–π‘› when the vehicle is tangent to the circle in the turning point, for instance, inFig. 7, P3 is the turning point. In the general case, the distance r is given by π‘Ÿ = 𝑦 + 𝑅 π‘šπ‘–π‘› βˆ’ 𝑦 π‘Ÿπ‘’π‘“ cos⁑(βˆ…) The turning point is reached ifπ‘Ÿ π‘šπ‘–π‘› β‰₯ 𝑅 π‘šπ‘–π‘› which means 𝑦 β‰₯ 𝑦 π‘Ÿπ‘’π‘“ + 𝑅 π‘šπ‘–π‘› (cos βˆ… βˆ’ 1)
  • 6. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 99 | Page Fig. 7 turning point computation 4.2. Platooning controller Once the vehicle finishes the exit parking maneuver, it detects the tail vehicle of the platoon and initializes the laser tracking algorithm to track this vehicle with a constant inter-vehicle spacing of 2 meters (dref) (cf. Fig. 8). The tracking algorithm calculates the relative front vehicles position (π‘‹π‘Ÿπ‘’π‘™ , π‘Œπ‘Ÿπ‘’π‘™ , πœƒπ‘Ÿπ‘’π‘™ ) relatively to the ego vehicle. Fig. 8 platoon of two vehicles We use a classical proportional integral controller to control the velocity 𝜈 𝑑 of the follower vehicle. For a measured inter-distance 𝑑 𝑑 , the velocity of the follower vehicle is given by: 𝜈 𝑑 = 𝐾𝑝 Β· 𝑒 𝑑 + 𝐾𝑝 Β· 𝑒 𝜏 𝑑 0 π‘‘πœ where 𝐾𝑝 and 𝐾𝑖 are respectively the proportional and the integral gains, and the error 𝑒(𝑑)is given by: 𝑒 𝑑 = 𝑑 π‘Ÿπ‘’π‘“ βˆ’ 𝑑(𝑑) We proposed in [20] a lateral controller based on a constant curvature approach, which allows the follower vehicle movement from its initial position (XF, YF) to the leader vehicle's position (XL, YL) with a constant steer angle 𝛿. The steer angle 𝛿 is given by: 𝛿 = tanβˆ’1 2 Β· 𝑙 Β· sin⁑(βˆ…) Ξ”π‘₯2 + Δ𝑦2 where Ξ”π‘₯ = 𝑋𝐿 βˆ’ 𝑋 𝐹 Δ𝑦 = π‘ŒπΏ βˆ’ π‘ŒπΉ βˆ… = tanβˆ’1 Δ𝑦 Ξ”π‘₯ βˆ’ πœƒ V. Experimental Results Fig. 9 three vehicles platoon demonstration
  • 7. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 100 | Page Our approach has been implemented and tested on our experimental electric vehicles called Cycab and a combustion vehicle CitroΓ«n C3 (cf.Fig. 9). Cycabs are equipped by an embedded fanless PC having an Intel Core i7 Pentium and running under Windows 7 64 bits operating system. We implemented high-level exit parking and platooning controller using RTMaps software [21]. This high-level controller communicates with the low-level controllers using a CAN bus. The low-level controllers are PID speed and steering controllers implemented on dsPIC microcontrollers to control 4 DC motors for propulsion and an electric jack for steering using Curtis power drivers. We also used Hokuyo UTM-30LX lasers having 30π‘š and 270Β° scanning range and Ibeo LUX laser having 200 m and 110Β° scanning range. The head vehicle can be any manually driven vehicle. Both head and follower vehicles are equipped with communication cubes enabling low latency communication, and considering vehicular communication standard IEEE 802.11p[22]. Fig. 10 laser objects detection Fig. 10shows the laser impact points and the detected objects of one electric vehicle parked between two other vehicles, and a tail platoon's vehicle waiting the parked vehicle to exit the parking space and join the platoon. The parked vehicle is represented by a blue rectangle. Front and back parked vehicles are identified objects with IDs respectively equal to 4 and 13, where the last vehicle of the platoon has an ID equal to 5. There is almost 1m space between the parked vehicles, and we also considered a secure distance of about 20cm. Other detected objects are considered as obstacles. Fig. 11trajectory of exit parking and platooning Fig. 11shows the trajectory of the exit parking and the platooning. The left part of the figure shows the exit parking trajectory. As there was not enough space for one trial maneuver, the exit parking has been done in six maneuvers. At the end of the last maneuver, the vehicle become parallel to its initial position, it stops then detects the front vehicle to be tracked. Once done, it switches to the platooning mode and acknowledges the head vehicle to keep moving. The right part ofFig. 11shows the trajectory of the vehicle following the platoon.
  • 8. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 101 | Page (a) velocities (b) steering angles Fig. 12 vehicle and reference velocities and steering angles Fig. 12(a)shows the reference velocityπœˆπ‘Ÿπ‘’π‘“ and the measured velocity 𝜈. The reference velocity is given by the bang-bang controller explained in section IV.πœˆπ‘Ÿπ‘’π‘“ switches six times between +0.3m/s and -0.3m/s which corresponds to the trajectory given byFig. 11. The velocity 𝜈 follows the velocity referenceπœˆπ‘Ÿπ‘’π‘“ and have a response time of about 0.1s. Fig. 12(b) shows the reference steering angle𝛿 π‘Ÿπ‘’π‘“ and the measured steering angle 𝛿. The reference steering angle switches six times between +0.4rad and -0.4 rad which corresponds to the trajectory of the exit parking. The measured steering angle 𝛿 is following the reference steering angle. We notice that the curve of 𝛿 is smooth because the driver is an electric jack. Also, there is a delay of about 0.03s which is due to a mechanical gap between the electric jack and the steering rod. The response time including the delay is about 0.1s.The response times and the delays presented below are also due to the low-level controller's period which is 10 ms and the CAN communication delay between the high-level and the low-level controllers. VI. Conclusion In this paper, we described the implementation of a relocation strategy to regulate the number of cars in several car parks for a car-sharing application. The idea is to get a leader vehicle with a driver, which comes to pick up and drop off cars (without drivers) over stations using automatic parking and platooning. The path planning for the automatic vehicles is based on a non-holonomic kinematic model of the vehicle, which is easily implemented and really efficient. This has been demonstrated over several experimental results. Perspectives, now, consists in implementing such a relocation strategy including the pickup and delivery problem and the supervisor communication to get a complete system for vehicle redistribution. Then, concerning platooning in urban areas, even if the legislation indicates that a platoon of vehicles in France follows the legal rules dedicated to little train for tourists, there is no doubt that specific strategies should be employed for urban platoon driving. References [1]. E. Farina and E. M. Cepolina, "A new shared vehicle system for urban areas," Transportation Research Part C: Emerging Technologies, vol. 21, pp. 230 - 243, 2012. [2]. M. HurΓ© and O. Waine, "From VΓ©lib’ to Autolib’: private corporations’ involvement in urban mobility policy," [Online]. Available: http://www.metropolitiques.eu/From-Velib-to-Autolib-private.html. [3]. E. M. C. a. A. Farina, "Urban car sharing: an overview of relocation strategies," WIT Transactions on the Built Environment, vol. 128, pp. 419--431, 2012. [4]. M. Barth and M. Todd, "Intelligent transportation system architecture for a multi-station shared vehicle system," Intelligent Transportation Systems, pp. 240-245, 2000. [5]. M. Dror, D. Fortin and C. Roucairol, "Redistribution of Self-service Electric Cars: A Case of Pickup and Delivery," INRIA, Rocquencourt, 1998. [6]. A. G. Kek, R. L. Cheu , Q. Meng and C. H. Fung, "A decision support system for vehicle relocation operations in carsharing systems," Transportation Research Part E: Logistics and Transportation Review, vol. 45, no. 1, pp. 149 - 158, 2009. [7]. L. Sungon, K. MinChul , Y. Youngil and C. Wankyun , "Control of a car-like mobile robot for parking problem," in IEEE International Conference on Robotics and Automation, 1999. [8]. R. Cabrera-Cosetl, M. Mora-Alvarez and R. Alejos-Palomares, "Self-Parking System Based in a Fuzzy Logic Approach," in Electrical, Communications, and Computers, 2009. CONIELECOMP 2009. International Conference on, 2009. [9]. W. Zhi-Long , Y. Chih-Hsiung and G. Tong-Yi , "The design of an autonomous parallel parking neuro-fuzzy controller for a car- like mobile robot," in SICE Annual Conference 2010, Proceedings of, 2010. [10]. M. Heinen, F. Osorio, F. Heinen and C. Kelber, "SEVA3D: Using Arti cial Neural Networks to Autonomous Vehicle Parking Control," in Neural Networks, 2006. IJCNN '06. International Joint Conference on, 2006.
  • 9. Automatic parking and platooning for electric vehicles redistribution in a car-sharing application DOI: 10.9790/1676-101194102 www.iosrjournals.org 102 | Page [11]. H. Vorobieva, N. Minoiu-Enache, S. Glaser and S. Mammar, "Geometric continuous-curvature path planning for automatic parallel parking," in Networking, Sensing and Control (ICNSC), 2013 10th IEEE International Conference on, 2013. [12]. B. Muller, J. Deutscher and S. Grodde, "Continuous Curvature Trajectory Design and Feedforward Control for Parking a Car," Control Systems Technology, IEEE Transactions on, vol. 15, pp. 541-553, 2007. [13]. S. Shladover, "PATH at 20 - History and Major Milestones," in Intelligent Transportation Systems Conference, 2006. ITSC '06. IEEE, 2006. [14]. P. Daviet and M. Parent, "Longitudinal and lateral servoing of vehicles in a platoon," in Intelligent Vehicles Symposium, 1996., Proceedings of the 1996 IEEE, 1996. [15]. C. Laugier, "Towards autonomous vehicles for future intelligent transportation systems," in Proc. 6th Conf. of Italian Association in Artificial Intelligence, 1998. [16]. S. HallΓ© , B. Chaib-draa and J. Laumonier, "Car Platoons Simulated As A Multiagent System," in In: Proc. 4th Workshop on Agent- Based Simulation, 2003. [17]. T. Robinson, E. Chan and E. Coelingh, "Operating Platoons On Public Motorways: An Introduction To The SARTRE Platooning Programme," in 17th World Congress on Intelligent Transport Systems (ITS) 2010, 2010. [18]. P. Fernandes and U. Nunes, "Platooning with DSRC-based IVC-enabled autonomous vehicles: Adding infrared communications for IVC reliability improvement," in Intelligent Vehicles Symposium (IV), 2012 IEEE, 2012. [19]. P. Resende, E. Pollard, H. Li and F. Nashashibi, "Low Speed Automation: technical feasibility of the driving sharing in urban areas," in IEEE ITSC 2013 - 16th International IEEE Conference on Intelligent Transportation Systems, La Hague, Netherlands, 2013. [20]. M. Abualhoul, M. Marouf, O. Shagdar and F. Nashashibi, "Platooning Control Using Visible Light Communications: A Feasibility Study," in Intelligent Transportation Systems - (ITSC), 2013 16th International IEEE Conference on, The Hague, 2013. [21]. "INTEMPORA," [Online]. Available: http://www.intempora.com. [22]. S. Eichler, "Performance Evaluation of the IEEE 802.11p WAVE Communication Standard," in Vehicular Technology Conference, 2007. VTC-2007 Fall. 2007 IEEE 66th, 2007.