SlideShare a Scribd company logo
1 of 3
Download to read offline
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 05 Issue: 04 | Apr-2018 www.irjet.net p-ISSN: 2395-0072
© 2018, IRJET | Impact Factor value: 6.171 | ISO 9001:2008 Certified Journal | Page 1345
Simultaneous Localization and Mapping for Automatic Chair Re-
arrangement System
Prof. Swapna Borde1, Reuben A. Fernandes2, Manoj S. Goregaonkar3, Kapilesh D. Gujarathi4
1,2,3,4 Department of Computer Engineering, VIDYAVARDHINI’S COLLEGE OF ENGINEERING AND TECHNOLOGY
K.T. MARG, VASAI ROAD (W), DIST-PALGHAR, PIN: 401202.
-----------------------------------------------------------------***--------------------------------------------------------------
Abstract- Mapping is the computational problem of
constructing or updating a map of an unknown
environment while simultaneously keeping track of an
agent's location within it. Localization means the process
of determining the location of an agent with respect to
some know reference .These techniques are cumulatively
termed as SLAM (simultaneous localization and mapping),
and can be used for the automation of any system. SLAM is
a topic of ongoing research in computer technology. There
are many know techniques to implement SLAM. Our goal is
to demonstrate a SLAM technique by implementing it in an
“Automatic Chair Re-arrangement system”. This system
automates the movement of a chair so that it can move
back to its original location post being displaced.[4]
Keywords- Mapping, Localization, Automation, SLAM,
Chair.
1. INTRODUCTION
THE solution to the simultaneous localization and map
building (SLAM) problem is, in many respects, a “Holy
Grail” of the autonomous vehicle research community.
The ability to place an autonomous vehicle at an
unknown location in an unknown environment and then
have it build a map, using only relative observations of
the environment, and then to use this map
simultaneously to navigate would indeed make such a
robot “autonomous”. Thus the main advantage of SLAM
is that it eliminates the need for artificial infrastructures
or a priori topological knowledge of the environment. A
solution to the SLAM problem would be of inestimable
value in a range of applications where absolute position
or precise map information is unobtainable, including,
amongst others, autonomous planetary exploration,
subsea autonomous vehicles, autonomous air-borne
vehicles The general SLAM problem has been the subject
of substantial research since the inception of a robotics
research community and indeed before this in areas such
as manned vehicle navigation systems and geophysical
surveying. A number of approaches have been proposed
to address both the SLAM problem and also more
simplified navigation problems.
2. EXISTING METHODOLOGIES
2.1 Dead Reckoning:
Dead reckoning, a method of navigation that uses on-
board sensors to measure speed and heading based on
the last known position to estimate its current position,
becomes important. On-board sensors, gyroscopes and a
compass, provide vehicle attitude and orientation
information. Speed is either measured in real time or is
determined empirically through testing. When
accelerometers are available on-board, a more advanced
form of dead reckoning known as inertial navigation is
possible. Inertial navigation integrates accelerations and
rotation rates of a body in time to determine attitude and
heading. [1]
Drawbacks:
Errors in dead reckoning result from many sources,
including inaccurate knowledge of the vehicle’s starting
position, a misalignment of the heading sensor, and the
time-varying effects of the sensors. Any errors present in
the initial conditions will be propagated throughout the
vehicle run. Similarly, a misaligned compass causes a
constant offset in all measurements and translates over
time into an estimated heading trajectory that deviates
from the actual vehicle trajectory. Finally, the constant
drift in gyroscopes becomes significant with time.
2.2. Odometry:
Odometry is the use of data from motion sensors to
estimate change in position over time. It is used
in robotics by some legged or wheeled robots to estimate
their position relative to a starting location. Each motor
has a rotary encoder, and so one can determine if either
wheel has travelled one "unit" forward or reverse along
the floor. This unit is the ratio of the circumference of the
wheel to the resolution of the encoder. [2]
Drawbacks:
The agent will always trace back the path described by it
to reach its current location. However if the agent were
displaced in an indefinite path, instead of following a
straight path to its original destination it will retrace that
path again, which is a waste of time and energy. Also if
the agent were displaced by not dragging but by lifting
the chair, then the rotary motor will not read any change
in location and hence will not able to retrace its path to
the destination.
2.3. Position triangulation using BLE beacons:
BLE Beacons are small devices available in a wide range
of shapes to be mounted on walls, tables, etc. These
devices are specially designed for indoor locations. A
robot can detect the BLE beacon signal and calculate its
position in the range of more than two beacons and
estimate the location. The beacons can run on a single
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 05 Issue: 04 | Apr-2018 www.irjet.net p-ISSN: 2395-0072
© 2018, IRJET | Impact Factor value: 6.171 | ISO 9001:2008 Certified Journal | Page 1346
battery charge for years, and this is one of its advantages
in front of other localization systems. Using BLE beacons
to calculate the indoor position should be easier, at least
in theory. The robot receives tiny and static pieces of
data within short distances. [3]
Drawbacks:
The accuracy of the pose estimation is only as good as
the camera being used. The tag detections were not able
to give reliable detections of tags, and when the camera
was being moved, the results worsen. Motion affects the
accuracy of the pose estimation. When the robot is
moving, especially while turning, it was found that the
pose estimation could be off by > 20 degrees, and vary in
range by up to 0.75 meters.
2.4. April Tags:
April Tags is a visual fiducial system, useful for a wide
variety of tasks including augmented reality, robotics,
and camera calibration. The tags provide a means of
identification and 3D positioning, even in low visibility
conditions. The tags act like barcodes, storing a small
amount of information (tag ID), while also enabling
simple and accurate 6D (x, y, z, roll, pitch, yaw) pose
estimation of the tag. [5]
Drawbacks:
This is a relatively good method but it was ruled out
since the selected method is easier to implement and is
less costly.
2.5. Global Positioning System (GPS):
The GPS system currently has 31 active satellites in
orbits inclined 55 degrees to the equator. The satellites
orbit about 20,000km from the earth's surface and make
two orbits per day. The orbits are designed so that there
are always 6 satellites in view, from most places on the
earth.The GPS receiver gets a signal from each GPS
satellite. The satellites transmit the exact time the signals
are sent. By subtracting the time the signal was
transmitted from the time it was received, the GPS can
tell how far it is from each satellite. The GPS receiver also
knows the exact position in the sky of the satellites, at
the moment they sent their signals. So given the travel
time of the GPS signals from three satellites and their
exact position in the sky, the GPS receiver can determine
your position in three dimensions - east, north and
altitude.[6]
Drawbacks:
GPS’ accuracy is not precise enough to determine the
location of the agent.
3. IMPLEMENTATION METHODOLOGY
We use an overhead camera that can view the entire area
on which the agent will move. The camera (using
OpenCV) can recognize the agent as a solid color (any
dark color other than red).The computer uses a code
(Python 2.7 and OpenCV code) is used to determine the
angle between the target (original location represented
by a “Red dot”).The agent has a magnetometer which
gives the heading of the bot w.r.t north (Fig I) (which is
set to top of the computer screen and not geometric
north). This heading is given to the computer program.
The program is coded to spin the bot so that the angle
inscribed with north is equal to the angle made by the
bot and the target. At this point, move the bot towards
the target. When the bot overlaps the target, the
movement is stopped. Using proximity sensors and IR
sensors, the bot a rotated about its position until it is
properly oriented. [7]
Fig 1: The red dot shows the target location to arrive at. Blue
dot represents the robot.
3. DESIGN OF THE SYSTEM
3.1. CIRCUIT DIAGRAM
Fig 2: The flowchart clearly shows a step by step functioning of
the entire system.
International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056
Volume: 05 Issue: 04 | Apr-2018 www.irjet.net p-ISSN: 2395-0072
© 2018, IRJET | Impact Factor value: 6.171 | ISO 9001:2008 Certified Journal | Page 1347
Webcam sends images of its field-of-view. OpenCV looks
for the largest red blob. It begins tracking the red blob's
X, Y. The PC averages these X, Y positions for around 150
camera frames. If the blob hasn't moved much, the PC
assumes the red blob is the robot. The PC gets frisky and
gives our robot a random target within the webcam's
field-of-view. The PC calculates the angle between the
bot and the target. Meanwhile, the robot's
microcontroller is taking readings from a magnetometer
on the robot. The robot, with a one time human
calibration, translates true North to "video-game north,"
aka, top of PC's screen. The microcontroller transmits
this code to the PC. The PC compares the angle of the bot
from the target with the robots angle. The PC sends a
code to the bot telling it to turn left, right, or move
forward (closer to the target).When the robot has made
it within an acceptable distance from the target he
"Munches the Dot." A new random dot appears. Rinse
repeat.
3.2. BLOCK DIAGRAM:
Fig 3: Figure illustrates the major blocks of operating hardware
components.
The arduino is the main processor, magnetometer is used to
find heading of the robot, HC-05 Bluetooth module for
communication with the computer and L93D motor shield for
voltage regulation of power supply
4. CONCLUSION
The objective of this project was to develop a technology
by which smart AI driven systems can communicate and
access the real world environment. This has been
achieved by implementing SLAM, by using image
processing. This system can control multiple robots as
long as they are in its field of vision. The proposed
method has been implemented for a “self-parking chair”,
however, various other implementations such as
automated vacuum cleaners, automatic parking system
for cars and other robots in general. This system
requires a closed environment in which the camera can
constantly see the environment in which the target
object must move.
5. REFERENCES
1. https://www.sciencedirect.com/science/article
/pii/S1474667017440882
2. Daniel Pizarro ⋆, Manuel Mazo, Enrique Santiso,
Marta Marron, David Jimenez, Santiago Cobreces
and Cristina Losada, “Localization of Mobile
Robots Using Odometry and an External Vision
Sensor”
www.mdpi.com/journal/sensors, 13thApril
2010.
3. Hyunwook Park, Jaewon Noh, Sunghyun Cho,”
Three-dimensional positioning system using
Bluetooth low-energy beacons”
https://doi.org/10.1177/1550147716671720.
4. https://en.wikipedia.org/wiki/Simultaneous_lo
calization_and_mapping
5. https://openmv.io/blogs/news/apriltag-
marker-tracking-the-future-is-here
6. https://en.wikipedia.org/wiki/Global_Positioni
ng_System
7. https://www.learnopencv.com/object-tracking-
using-opencv-cpp-python/

More Related Content

What's hot

Producing Geographic Data with LIDAR
Producing Geographic Data with LIDARProducing Geographic Data with LIDAR
Producing Geographic Data with LIDARKodi Volkmann
 
Intelligent Traffic light detection for individuals with CVD
Intelligent Traffic light detection for individuals with CVDIntelligent Traffic light detection for individuals with CVD
Intelligent Traffic light detection for individuals with CVDSwaroop Aradhya M C
 
Real-Time Map Building using Ultrasound Scanning
Real-Time Map Building using Ultrasound ScanningReal-Time Map Building using Ultrasound Scanning
Real-Time Map Building using Ultrasound ScanningIRJET Journal
 
Traffic Light Controller System using Optical Flow Estimation
Traffic Light Controller System using Optical Flow EstimationTraffic Light Controller System using Optical Flow Estimation
Traffic Light Controller System using Optical Flow EstimationEditor IJCATR
 
Vehicle detection through image processing
Vehicle detection through image processingVehicle detection through image processing
Vehicle detection through image processingGhazalpreet Kaur
 
Final Project Report on Image processing based intelligent traffic control sy...
Final Project Report on Image processing based intelligent traffic control sy...Final Project Report on Image processing based intelligent traffic control sy...
Final Project Report on Image processing based intelligent traffic control sy...Louise Antonio
 
Total station
Total stationTotal station
Total stationSumit Jha
 
Total station
Total stationTotal station
Total stationlbbinh
 
Welcome to the presentation on ‘total station
Welcome to the presentation on ‘total stationWelcome to the presentation on ‘total station
Welcome to the presentation on ‘total stationShashank Javalagi
 
Experience on using total station surveying for mapping and contouring
Experience on using total station surveying for mapping and contouringExperience on using total station surveying for mapping and contouring
Experience on using total station surveying for mapping and contouringIAEME Publication
 
Image Processing Applied To Traffic Queue Detection Algorithm
Image Processing Applied To Traffic Queue Detection AlgorithmImage Processing Applied To Traffic Queue Detection Algorithm
Image Processing Applied To Traffic Queue Detection Algorithmguest673189
 
Total station and its application to civil engineering
Total station and its application to civil engineeringTotal station and its application to civil engineering
Total station and its application to civil engineeringTushar Dholakia
 

What's hot (20)

Producing Geographic Data with LIDAR
Producing Geographic Data with LIDARProducing Geographic Data with LIDAR
Producing Geographic Data with LIDAR
 
Intelligent Traffic light detection for individuals with CVD
Intelligent Traffic light detection for individuals with CVDIntelligent Traffic light detection for individuals with CVD
Intelligent Traffic light detection for individuals with CVD
 
Real-Time Map Building using Ultrasound Scanning
Real-Time Map Building using Ultrasound ScanningReal-Time Map Building using Ultrasound Scanning
Real-Time Map Building using Ultrasound Scanning
 
Fz2410881090
Fz2410881090Fz2410881090
Fz2410881090
 
Traffic Light Controller System using Optical Flow Estimation
Traffic Light Controller System using Optical Flow EstimationTraffic Light Controller System using Optical Flow Estimation
Traffic Light Controller System using Optical Flow Estimation
 
Vehicle detection through image processing
Vehicle detection through image processingVehicle detection through image processing
Vehicle detection through image processing
 
Final Project Report on Image processing based intelligent traffic control sy...
Final Project Report on Image processing based intelligent traffic control sy...Final Project Report on Image processing based intelligent traffic control sy...
Final Project Report on Image processing based intelligent traffic control sy...
 
Total station
Total stationTotal station
Total station
 
Total station
Total stationTotal station
Total station
 
Total station
Total stationTotal station
Total station
 
Welcome to the presentation on ‘total station
Welcome to the presentation on ‘total stationWelcome to the presentation on ‘total station
Welcome to the presentation on ‘total station
 
Experience on using total station surveying for mapping and contouring
Experience on using total station surveying for mapping and contouringExperience on using total station surveying for mapping and contouring
Experience on using total station surveying for mapping and contouring
 
Total station
Total stationTotal station
Total station
 
C16_3rd review
C16_3rd reviewC16_3rd review
C16_3rd review
 
Image Processing Applied To Traffic Queue Detection Algorithm
Image Processing Applied To Traffic Queue Detection AlgorithmImage Processing Applied To Traffic Queue Detection Algorithm
Image Processing Applied To Traffic Queue Detection Algorithm
 
Total station
Total station Total station
Total station
 
Total Station & GPS
 Total Station & GPS Total Station & GPS
Total Station & GPS
 
Total station and its application to civil engineering
Total station and its application to civil engineeringTotal station and its application to civil engineering
Total station and its application to civil engineering
 
Gps and planimeter
Gps and planimeterGps and planimeter
Gps and planimeter
 
TcpET
TcpETTcpET
TcpET
 

Similar to IRJET- Simultaneous Localization and Mapping for Automatic Chair Re-Arrangement System

IRJET- Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...
IRJET-  	  Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...IRJET-  	  Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...
IRJET- Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...IRJET Journal
 
IRJET - Detection of Landmine using Robotic Vehicle
IRJET -  	  Detection of Landmine using Robotic VehicleIRJET -  	  Detection of Landmine using Robotic Vehicle
IRJET - Detection of Landmine using Robotic VehicleIRJET Journal
 
Application of Vision based Techniques for Position Estimation
Application of Vision based Techniques for Position EstimationApplication of Vision based Techniques for Position Estimation
Application of Vision based Techniques for Position EstimationIRJET Journal
 
LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...
LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...
LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...Minh Quan Nguyen
 
A cost-effective GPS-aided autonomous guided vehicle for global path planning
A cost-effective GPS-aided autonomous guided vehicle for global path planningA cost-effective GPS-aided autonomous guided vehicle for global path planning
A cost-effective GPS-aided autonomous guided vehicle for global path planningjournalBEEI
 
IRJET- Smart Bus Transportation System
IRJET- Smart Bus Transportation SystemIRJET- Smart Bus Transportation System
IRJET- Smart Bus Transportation SystemIRJET Journal
 
Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...
Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...
Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...IRJET Journal
 
Discernment Pothole with Autonomous Metropolitan Vehicle
	 Discernment Pothole with Autonomous Metropolitan  Vehicle	 Discernment Pothole with Autonomous Metropolitan  Vehicle
Discernment Pothole with Autonomous Metropolitan VehicleIRJET Journal
 
2D mapping using omni-directional mobile robot equipped with LiDAR
2D mapping using omni-directional mobile robot equipped with LiDAR2D mapping using omni-directional mobile robot equipped with LiDAR
2D mapping using omni-directional mobile robot equipped with LiDARTELKOMNIKA JOURNAL
 
Two wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigationTwo wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigationIAEME Publication
 
PC-based mobile robot navigation sytem
PC-based mobile robot navigation sytemPC-based mobile robot navigation sytem
PC-based mobile robot navigation sytemANKIT SURATI
 
DESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLE
DESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLEDESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLE
DESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLEIRJET Journal
 
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...CSCJournals
 
IRJET - A Review on Fully Autonomous Vehicle
IRJET - A Review on Fully Autonomous VehicleIRJET - A Review on Fully Autonomous Vehicle
IRJET - A Review on Fully Autonomous VehicleIRJET Journal
 
Visual and light detection and ranging-based simultaneous localization and m...
Visual and light detection and ranging-based simultaneous  localization and m...Visual and light detection and ranging-based simultaneous  localization and m...
Visual and light detection and ranging-based simultaneous localization and m...IJECEIAES
 
A comparative study on road traffic management systems
A comparative study on road traffic management systemsA comparative study on road traffic management systems
A comparative study on road traffic management systemseSAT Publishing House
 
AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...
AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...
AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...csandit
 
IRJET - Road Condition Improvement in Smart Cities using IoT
IRJET - Road Condition Improvement in Smart Cities using IoTIRJET - Road Condition Improvement in Smart Cities using IoT
IRJET - Road Condition Improvement in Smart Cities using IoTIRJET Journal
 
IRJET- Survey Paper on Human Following Robot
IRJET- Survey Paper on Human Following RobotIRJET- Survey Paper on Human Following Robot
IRJET- Survey Paper on Human Following RobotIRJET Journal
 

Similar to IRJET- Simultaneous Localization and Mapping for Automatic Chair Re-Arrangement System (20)

IRJET- Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...
IRJET-  	  Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...IRJET-  	  Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...
IRJET- Robust and Fast Detection of Moving Vechiles in Aerial Videos usin...
 
IRJET - Detection of Landmine using Robotic Vehicle
IRJET -  	  Detection of Landmine using Robotic VehicleIRJET -  	  Detection of Landmine using Robotic Vehicle
IRJET - Detection of Landmine using Robotic Vehicle
 
Seminar koushlendra saini
Seminar koushlendra sainiSeminar koushlendra saini
Seminar koushlendra saini
 
Application of Vision based Techniques for Position Estimation
Application of Vision based Techniques for Position EstimationApplication of Vision based Techniques for Position Estimation
Application of Vision based Techniques for Position Estimation
 
LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...
LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...
LocalizationandMappingforAutonomousNavigationin OutdoorTerrains: A StereoVisi...
 
A cost-effective GPS-aided autonomous guided vehicle for global path planning
A cost-effective GPS-aided autonomous guided vehicle for global path planningA cost-effective GPS-aided autonomous guided vehicle for global path planning
A cost-effective GPS-aided autonomous guided vehicle for global path planning
 
IRJET- Smart Bus Transportation System
IRJET- Smart Bus Transportation SystemIRJET- Smart Bus Transportation System
IRJET- Smart Bus Transportation System
 
Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...
Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...
Design and Development of a Semi-Autonomous Telerobotic Warehouse Management ...
 
Discernment Pothole with Autonomous Metropolitan Vehicle
	 Discernment Pothole with Autonomous Metropolitan  Vehicle	 Discernment Pothole with Autonomous Metropolitan  Vehicle
Discernment Pothole with Autonomous Metropolitan Vehicle
 
2D mapping using omni-directional mobile robot equipped with LiDAR
2D mapping using omni-directional mobile robot equipped with LiDAR2D mapping using omni-directional mobile robot equipped with LiDAR
2D mapping using omni-directional mobile robot equipped with LiDAR
 
Two wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigationTwo wheeled self balancing robot for autonomous navigation
Two wheeled self balancing robot for autonomous navigation
 
PC-based mobile robot navigation sytem
PC-based mobile robot navigation sytemPC-based mobile robot navigation sytem
PC-based mobile robot navigation sytem
 
DESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLE
DESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLEDESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLE
DESIGN & DEVELOPMENT OF UNMANNED GROUND VEHICLE
 
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...
Autonomous Path Planning and Navigation of a Mobile Robot with Multi-Sensors ...
 
IRJET - A Review on Fully Autonomous Vehicle
IRJET - A Review on Fully Autonomous VehicleIRJET - A Review on Fully Autonomous Vehicle
IRJET - A Review on Fully Autonomous Vehicle
 
Visual and light detection and ranging-based simultaneous localization and m...
Visual and light detection and ranging-based simultaneous  localization and m...Visual and light detection and ranging-based simultaneous  localization and m...
Visual and light detection and ranging-based simultaneous localization and m...
 
A comparative study on road traffic management systems
A comparative study on road traffic management systemsA comparative study on road traffic management systems
A comparative study on road traffic management systems
 
AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...
AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...
AUTO LANDING PROCESS FOR AUTONOMOUS FLYING ROBOT BY USING IMAGE PROCESSING BA...
 
IRJET - Road Condition Improvement in Smart Cities using IoT
IRJET - Road Condition Improvement in Smart Cities using IoTIRJET - Road Condition Improvement in Smart Cities using IoT
IRJET - Road Condition Improvement in Smart Cities using IoT
 
IRJET- Survey Paper on Human Following Robot
IRJET- Survey Paper on Human Following RobotIRJET- Survey Paper on Human Following Robot
IRJET- Survey Paper on Human Following Robot
 

More from IRJET Journal

TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...IRJET Journal
 
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURESTUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTUREIRJET Journal
 
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...IRJET Journal
 
Effect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil CharacteristicsEffect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil CharacteristicsIRJET Journal
 
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...IRJET Journal
 
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...IRJET Journal
 
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...IRJET Journal
 
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...IRJET Journal
 
A REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADASA REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADASIRJET Journal
 
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...IRJET Journal
 
P.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD ProP.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD ProIRJET Journal
 
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...IRJET Journal
 
Survey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare SystemSurvey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare SystemIRJET Journal
 
Review on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridgesReview on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridgesIRJET Journal
 
React based fullstack edtech web application
React based fullstack edtech web applicationReact based fullstack edtech web application
React based fullstack edtech web applicationIRJET Journal
 
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...IRJET Journal
 
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.IRJET Journal
 
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...IRJET Journal
 
Multistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic DesignMultistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic DesignIRJET Journal
 
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...IRJET Journal
 

More from IRJET Journal (20)

TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
TUNNELING IN HIMALAYAS WITH NATM METHOD: A SPECIAL REFERENCES TO SUNGAL TUNNE...
 
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURESTUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
STUDY THE EFFECT OF RESPONSE REDUCTION FACTOR ON RC FRAMED STRUCTURE
 
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
A COMPARATIVE ANALYSIS OF RCC ELEMENT OF SLAB WITH STARK STEEL (HYSD STEEL) A...
 
Effect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil CharacteristicsEffect of Camber and Angles of Attack on Airfoil Characteristics
Effect of Camber and Angles of Attack on Airfoil Characteristics
 
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
A Review on the Progress and Challenges of Aluminum-Based Metal Matrix Compos...
 
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
Dynamic Urban Transit Optimization: A Graph Neural Network Approach for Real-...
 
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
Structural Analysis and Design of Multi-Storey Symmetric and Asymmetric Shape...
 
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
A Review of “Seismic Response of RC Structures Having Plan and Vertical Irreg...
 
A REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADASA REVIEW ON MACHINE LEARNING IN ADAS
A REVIEW ON MACHINE LEARNING IN ADAS
 
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
Long Term Trend Analysis of Precipitation and Temperature for Asosa district,...
 
P.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD ProP.E.B. Framed Structure Design and Analysis Using STAAD Pro
P.E.B. Framed Structure Design and Analysis Using STAAD Pro
 
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
A Review on Innovative Fiber Integration for Enhanced Reinforcement of Concre...
 
Survey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare SystemSurvey Paper on Cloud-Based Secured Healthcare System
Survey Paper on Cloud-Based Secured Healthcare System
 
Review on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridgesReview on studies and research on widening of existing concrete bridges
Review on studies and research on widening of existing concrete bridges
 
React based fullstack edtech web application
React based fullstack edtech web applicationReact based fullstack edtech web application
React based fullstack edtech web application
 
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
A Comprehensive Review of Integrating IoT and Blockchain Technologies in the ...
 
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
A REVIEW ON THE PERFORMANCE OF COCONUT FIBRE REINFORCED CONCRETE.
 
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
Optimizing Business Management Process Workflows: The Dynamic Influence of Mi...
 
Multistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic DesignMultistoried and Multi Bay Steel Building Frame by using Seismic Design
Multistoried and Multi Bay Steel Building Frame by using Seismic Design
 
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
Cost Optimization of Construction Using Plastic Waste as a Sustainable Constr...
 

Recently uploaded

INFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETE
INFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETEINFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETE
INFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETEroselinkalist12
 
Concrete Mix Design - IS 10262-2019 - .pptx
Concrete Mix Design - IS 10262-2019 - .pptxConcrete Mix Design - IS 10262-2019 - .pptx
Concrete Mix Design - IS 10262-2019 - .pptxKartikeyaDwivedi3
 
Architect Hassan Khalil Portfolio for 2024
Architect Hassan Khalil Portfolio for 2024Architect Hassan Khalil Portfolio for 2024
Architect Hassan Khalil Portfolio for 2024hassan khalil
 
HARMONY IN THE HUMAN BEING - Unit-II UHV-2
HARMONY IN THE HUMAN BEING - Unit-II UHV-2HARMONY IN THE HUMAN BEING - Unit-II UHV-2
HARMONY IN THE HUMAN BEING - Unit-II UHV-2RajaP95
 
Past, Present and Future of Generative AI
Past, Present and Future of Generative AIPast, Present and Future of Generative AI
Past, Present and Future of Generative AIabhishek36461
 
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdfCCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdfAsst.prof M.Gokilavani
 
Heart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptxHeart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptxPoojaBan
 
Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...VICTOR MAESTRE RAMIREZ
 
Study on Air-Water & Water-Water Heat Exchange in a Finned Tube Exchanger
Study on Air-Water & Water-Water Heat Exchange in a Finned Tube ExchangerStudy on Air-Water & Water-Water Heat Exchange in a Finned Tube Exchanger
Study on Air-Water & Water-Water Heat Exchange in a Finned Tube ExchangerAnamika Sarkar
 
complete construction, environmental and economics information of biomass com...
complete construction, environmental and economics information of biomass com...complete construction, environmental and economics information of biomass com...
complete construction, environmental and economics information of biomass com...asadnawaz62
 
Call Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile serviceCall Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile servicerehmti665
 
power system scada applications and uses
power system scada applications and usespower system scada applications and uses
power system scada applications and usesDevarapalliHaritha
 
VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...
VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...
VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...VICTOR MAESTRE RAMIREZ
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxpurnimasatapathy1234
 
Internship report on mechanical engineering
Internship report on mechanical engineeringInternship report on mechanical engineering
Internship report on mechanical engineeringmalavadedarshan25
 
Introduction-To-Agricultural-Surveillance-Rover.pptx
Introduction-To-Agricultural-Surveillance-Rover.pptxIntroduction-To-Agricultural-Surveillance-Rover.pptx
Introduction-To-Agricultural-Surveillance-Rover.pptxk795866
 
Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.eptoze12
 
Introduction to Microprocesso programming and interfacing.pptx
Introduction to Microprocesso programming and interfacing.pptxIntroduction to Microprocesso programming and interfacing.pptx
Introduction to Microprocesso programming and interfacing.pptxvipinkmenon1
 

Recently uploaded (20)

Exploring_Network_Security_with_JA3_by_Rakesh Seal.pptx
Exploring_Network_Security_with_JA3_by_Rakesh Seal.pptxExploring_Network_Security_with_JA3_by_Rakesh Seal.pptx
Exploring_Network_Security_with_JA3_by_Rakesh Seal.pptx
 
INFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETE
INFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETEINFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETE
INFLUENCE OF NANOSILICA ON THE PROPERTIES OF CONCRETE
 
Concrete Mix Design - IS 10262-2019 - .pptx
Concrete Mix Design - IS 10262-2019 - .pptxConcrete Mix Design - IS 10262-2019 - .pptx
Concrete Mix Design - IS 10262-2019 - .pptx
 
Architect Hassan Khalil Portfolio for 2024
Architect Hassan Khalil Portfolio for 2024Architect Hassan Khalil Portfolio for 2024
Architect Hassan Khalil Portfolio for 2024
 
HARMONY IN THE HUMAN BEING - Unit-II UHV-2
HARMONY IN THE HUMAN BEING - Unit-II UHV-2HARMONY IN THE HUMAN BEING - Unit-II UHV-2
HARMONY IN THE HUMAN BEING - Unit-II UHV-2
 
Past, Present and Future of Generative AI
Past, Present and Future of Generative AIPast, Present and Future of Generative AI
Past, Present and Future of Generative AI
 
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdfCCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
CCS355 Neural Network & Deep Learning Unit II Notes with Question bank .pdf
 
Heart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptxHeart Disease Prediction using machine learning.pptx
Heart Disease Prediction using machine learning.pptx
 
Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...Software and Systems Engineering Standards: Verification and Validation of Sy...
Software and Systems Engineering Standards: Verification and Validation of Sy...
 
Study on Air-Water & Water-Water Heat Exchange in a Finned Tube Exchanger
Study on Air-Water & Water-Water Heat Exchange in a Finned Tube ExchangerStudy on Air-Water & Water-Water Heat Exchange in a Finned Tube Exchanger
Study on Air-Water & Water-Water Heat Exchange in a Finned Tube Exchanger
 
complete construction, environmental and economics information of biomass com...
complete construction, environmental and economics information of biomass com...complete construction, environmental and economics information of biomass com...
complete construction, environmental and economics information of biomass com...
 
Call Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile serviceCall Girls Delhi {Jodhpur} 9711199012 high profile service
Call Girls Delhi {Jodhpur} 9711199012 high profile service
 
power system scada applications and uses
power system scada applications and usespower system scada applications and uses
power system scada applications and uses
 
VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...
VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...
VICTOR MAESTRE RAMIREZ - Planetary Defender on NASA's Double Asteroid Redirec...
 
Microscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptxMicroscopic Analysis of Ceramic Materials.pptx
Microscopic Analysis of Ceramic Materials.pptx
 
young call girls in Green Park🔝 9953056974 🔝 escort Service
young call girls in Green Park🔝 9953056974 🔝 escort Serviceyoung call girls in Green Park🔝 9953056974 🔝 escort Service
young call girls in Green Park🔝 9953056974 🔝 escort Service
 
Internship report on mechanical engineering
Internship report on mechanical engineeringInternship report on mechanical engineering
Internship report on mechanical engineering
 
Introduction-To-Agricultural-Surveillance-Rover.pptx
Introduction-To-Agricultural-Surveillance-Rover.pptxIntroduction-To-Agricultural-Surveillance-Rover.pptx
Introduction-To-Agricultural-Surveillance-Rover.pptx
 
Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.Oxy acetylene welding presentation note.
Oxy acetylene welding presentation note.
 
Introduction to Microprocesso programming and interfacing.pptx
Introduction to Microprocesso programming and interfacing.pptxIntroduction to Microprocesso programming and interfacing.pptx
Introduction to Microprocesso programming and interfacing.pptx
 

IRJET- Simultaneous Localization and Mapping for Automatic Chair Re-Arrangement System

  • 1. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 05 Issue: 04 | Apr-2018 www.irjet.net p-ISSN: 2395-0072 © 2018, IRJET | Impact Factor value: 6.171 | ISO 9001:2008 Certified Journal | Page 1345 Simultaneous Localization and Mapping for Automatic Chair Re- arrangement System Prof. Swapna Borde1, Reuben A. Fernandes2, Manoj S. Goregaonkar3, Kapilesh D. Gujarathi4 1,2,3,4 Department of Computer Engineering, VIDYAVARDHINI’S COLLEGE OF ENGINEERING AND TECHNOLOGY K.T. MARG, VASAI ROAD (W), DIST-PALGHAR, PIN: 401202. -----------------------------------------------------------------***-------------------------------------------------------------- Abstract- Mapping is the computational problem of constructing or updating a map of an unknown environment while simultaneously keeping track of an agent's location within it. Localization means the process of determining the location of an agent with respect to some know reference .These techniques are cumulatively termed as SLAM (simultaneous localization and mapping), and can be used for the automation of any system. SLAM is a topic of ongoing research in computer technology. There are many know techniques to implement SLAM. Our goal is to demonstrate a SLAM technique by implementing it in an “Automatic Chair Re-arrangement system”. This system automates the movement of a chair so that it can move back to its original location post being displaced.[4] Keywords- Mapping, Localization, Automation, SLAM, Chair. 1. INTRODUCTION THE solution to the simultaneous localization and map building (SLAM) problem is, in many respects, a “Holy Grail” of the autonomous vehicle research community. The ability to place an autonomous vehicle at an unknown location in an unknown environment and then have it build a map, using only relative observations of the environment, and then to use this map simultaneously to navigate would indeed make such a robot “autonomous”. Thus the main advantage of SLAM is that it eliminates the need for artificial infrastructures or a priori topological knowledge of the environment. A solution to the SLAM problem would be of inestimable value in a range of applications where absolute position or precise map information is unobtainable, including, amongst others, autonomous planetary exploration, subsea autonomous vehicles, autonomous air-borne vehicles The general SLAM problem has been the subject of substantial research since the inception of a robotics research community and indeed before this in areas such as manned vehicle navigation systems and geophysical surveying. A number of approaches have been proposed to address both the SLAM problem and also more simplified navigation problems. 2. EXISTING METHODOLOGIES 2.1 Dead Reckoning: Dead reckoning, a method of navigation that uses on- board sensors to measure speed and heading based on the last known position to estimate its current position, becomes important. On-board sensors, gyroscopes and a compass, provide vehicle attitude and orientation information. Speed is either measured in real time or is determined empirically through testing. When accelerometers are available on-board, a more advanced form of dead reckoning known as inertial navigation is possible. Inertial navigation integrates accelerations and rotation rates of a body in time to determine attitude and heading. [1] Drawbacks: Errors in dead reckoning result from many sources, including inaccurate knowledge of the vehicle’s starting position, a misalignment of the heading sensor, and the time-varying effects of the sensors. Any errors present in the initial conditions will be propagated throughout the vehicle run. Similarly, a misaligned compass causes a constant offset in all measurements and translates over time into an estimated heading trajectory that deviates from the actual vehicle trajectory. Finally, the constant drift in gyroscopes becomes significant with time. 2.2. Odometry: Odometry is the use of data from motion sensors to estimate change in position over time. It is used in robotics by some legged or wheeled robots to estimate their position relative to a starting location. Each motor has a rotary encoder, and so one can determine if either wheel has travelled one "unit" forward or reverse along the floor. This unit is the ratio of the circumference of the wheel to the resolution of the encoder. [2] Drawbacks: The agent will always trace back the path described by it to reach its current location. However if the agent were displaced in an indefinite path, instead of following a straight path to its original destination it will retrace that path again, which is a waste of time and energy. Also if the agent were displaced by not dragging but by lifting the chair, then the rotary motor will not read any change in location and hence will not able to retrace its path to the destination. 2.3. Position triangulation using BLE beacons: BLE Beacons are small devices available in a wide range of shapes to be mounted on walls, tables, etc. These devices are specially designed for indoor locations. A robot can detect the BLE beacon signal and calculate its position in the range of more than two beacons and estimate the location. The beacons can run on a single
  • 2. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 05 Issue: 04 | Apr-2018 www.irjet.net p-ISSN: 2395-0072 © 2018, IRJET | Impact Factor value: 6.171 | ISO 9001:2008 Certified Journal | Page 1346 battery charge for years, and this is one of its advantages in front of other localization systems. Using BLE beacons to calculate the indoor position should be easier, at least in theory. The robot receives tiny and static pieces of data within short distances. [3] Drawbacks: The accuracy of the pose estimation is only as good as the camera being used. The tag detections were not able to give reliable detections of tags, and when the camera was being moved, the results worsen. Motion affects the accuracy of the pose estimation. When the robot is moving, especially while turning, it was found that the pose estimation could be off by > 20 degrees, and vary in range by up to 0.75 meters. 2.4. April Tags: April Tags is a visual fiducial system, useful for a wide variety of tasks including augmented reality, robotics, and camera calibration. The tags provide a means of identification and 3D positioning, even in low visibility conditions. The tags act like barcodes, storing a small amount of information (tag ID), while also enabling simple and accurate 6D (x, y, z, roll, pitch, yaw) pose estimation of the tag. [5] Drawbacks: This is a relatively good method but it was ruled out since the selected method is easier to implement and is less costly. 2.5. Global Positioning System (GPS): The GPS system currently has 31 active satellites in orbits inclined 55 degrees to the equator. The satellites orbit about 20,000km from the earth's surface and make two orbits per day. The orbits are designed so that there are always 6 satellites in view, from most places on the earth.The GPS receiver gets a signal from each GPS satellite. The satellites transmit the exact time the signals are sent. By subtracting the time the signal was transmitted from the time it was received, the GPS can tell how far it is from each satellite. The GPS receiver also knows the exact position in the sky of the satellites, at the moment they sent their signals. So given the travel time of the GPS signals from three satellites and their exact position in the sky, the GPS receiver can determine your position in three dimensions - east, north and altitude.[6] Drawbacks: GPS’ accuracy is not precise enough to determine the location of the agent. 3. IMPLEMENTATION METHODOLOGY We use an overhead camera that can view the entire area on which the agent will move. The camera (using OpenCV) can recognize the agent as a solid color (any dark color other than red).The computer uses a code (Python 2.7 and OpenCV code) is used to determine the angle between the target (original location represented by a “Red dot”).The agent has a magnetometer which gives the heading of the bot w.r.t north (Fig I) (which is set to top of the computer screen and not geometric north). This heading is given to the computer program. The program is coded to spin the bot so that the angle inscribed with north is equal to the angle made by the bot and the target. At this point, move the bot towards the target. When the bot overlaps the target, the movement is stopped. Using proximity sensors and IR sensors, the bot a rotated about its position until it is properly oriented. [7] Fig 1: The red dot shows the target location to arrive at. Blue dot represents the robot. 3. DESIGN OF THE SYSTEM 3.1. CIRCUIT DIAGRAM Fig 2: The flowchart clearly shows a step by step functioning of the entire system.
  • 3. International Research Journal of Engineering and Technology (IRJET) e-ISSN: 2395-0056 Volume: 05 Issue: 04 | Apr-2018 www.irjet.net p-ISSN: 2395-0072 © 2018, IRJET | Impact Factor value: 6.171 | ISO 9001:2008 Certified Journal | Page 1347 Webcam sends images of its field-of-view. OpenCV looks for the largest red blob. It begins tracking the red blob's X, Y. The PC averages these X, Y positions for around 150 camera frames. If the blob hasn't moved much, the PC assumes the red blob is the robot. The PC gets frisky and gives our robot a random target within the webcam's field-of-view. The PC calculates the angle between the bot and the target. Meanwhile, the robot's microcontroller is taking readings from a magnetometer on the robot. The robot, with a one time human calibration, translates true North to "video-game north," aka, top of PC's screen. The microcontroller transmits this code to the PC. The PC compares the angle of the bot from the target with the robots angle. The PC sends a code to the bot telling it to turn left, right, or move forward (closer to the target).When the robot has made it within an acceptable distance from the target he "Munches the Dot." A new random dot appears. Rinse repeat. 3.2. BLOCK DIAGRAM: Fig 3: Figure illustrates the major blocks of operating hardware components. The arduino is the main processor, magnetometer is used to find heading of the robot, HC-05 Bluetooth module for communication with the computer and L93D motor shield for voltage regulation of power supply 4. CONCLUSION The objective of this project was to develop a technology by which smart AI driven systems can communicate and access the real world environment. This has been achieved by implementing SLAM, by using image processing. This system can control multiple robots as long as they are in its field of vision. The proposed method has been implemented for a “self-parking chair”, however, various other implementations such as automated vacuum cleaners, automatic parking system for cars and other robots in general. This system requires a closed environment in which the camera can constantly see the environment in which the target object must move. 5. REFERENCES 1. https://www.sciencedirect.com/science/article /pii/S1474667017440882 2. Daniel Pizarro ⋆, Manuel Mazo, Enrique Santiso, Marta Marron, David Jimenez, Santiago Cobreces and Cristina Losada, “Localization of Mobile Robots Using Odometry and an External Vision Sensor” www.mdpi.com/journal/sensors, 13thApril 2010. 3. Hyunwook Park, Jaewon Noh, Sunghyun Cho,” Three-dimensional positioning system using Bluetooth low-energy beacons” https://doi.org/10.1177/1550147716671720. 4. https://en.wikipedia.org/wiki/Simultaneous_lo calization_and_mapping 5. https://openmv.io/blogs/news/apriltag- marker-tracking-the-future-is-here 6. https://en.wikipedia.org/wiki/Global_Positioni ng_System 7. https://www.learnopencv.com/object-tracking- using-opencv-cpp-python/