SlideShare a Scribd company logo
1 of 17
Download to read offline
Localization and Navigation
Localization and Navigation
• Localization and navigation are the two most important tasks for
mobile robots.
• We want to know where we are, and we need to be able to make a
plan for how to reach a goal destination.
• Localization, navigation, and mapping (in past)
• Whole problem complex at once
• SLAM (simultaneous localization and mapping)
Localization
• we need to know a robot’s position and orientation at all times.
• The localization problem can be solved by using a global positioning
system.
• Outdoor setting  the satellite-based GPS
• In an indoor setting  a global sensor network with infrared, sonar,
laser, or radio
Localization
• Global positioning system
Localization
• Using two beacons can narrow down the robot position to two
possibilities.
• Only the robot’s position can be determined by this method, not its
orientation.
• The orientation has to be deducted from the change in position
(difference between two subsequent positions)
• How to use local sensors:
• The sonar sensors can be mounted on the robot and the beacons are converted
to reflective markers, then we have an autonomous robot with local sensors.
• Another idea is to use light emitting homing beacons instead of sonar beacons.
Localization
• Homing beacons
• The robot has either to perform a 360° rotation, or to possess an omni-
directional vision system that allows it to determine the angle of a recognized
light beacon.
• The robot can determine its position and orientation.
Localization
• Dead reckoning
• Dead reckoning is a nautical term from the 1700s when ships did not have
modern navigation equipment.
• Dead reckoning can be described as local polar coordinates, or more
practically as turtle graphics geometry.
Well-known navigation
algorithms
Dijkstra’s Algorithm
• Description
Algorithm for computing all shortest paths from a given starting node in a
fully connected graph.
• Required:
Relative distance information between all nodes; distances must not be
negative.
• Algorithm
Start “ready set” with start node. In loop select node with shortest distance
in every step, then compute distances to all of its neighbors and store path
predecessors. Add current node to “ready set”; loop finishes when all nodes
are included.
A* Algorithm
• Description
Pronounced “A-Star”; heuristic algorithm for computing the shortest
path from one given start node to one given goal node.
• Required
Relative distance information between all nodes plus lower bound of
distance to goal from each node (e.g. air-line or linear distance).
• Algorithm
Maintain sorted list of paths to goal, in every step expand only the
currently shortest path by adding adjacent node with shortest distance
(including estimate of remaining distance to goal)
Potential Field Method
• Description
Global map generation algorithm with virtual forces.
• Required
Start and goal position, positions of all obstacles and walls.
• Algorithm
Generate a map with virtual attracting and repelling forces. Start point,
obstacles, and walls are repelling, goal is attracting; force strength is
inverse to object distance; robot simply follows force field.
Potential Field Method
Wandering Standpoint Algorithm
• Description
Local path planning algorithm.
• Required
Local distance sensor.
• Algorithm
Try to reach goal from start in direct line. When encountering an
obstacle, measure avoidance angle for turning left and for turning right,
turn to smaller angle. Continue with boundary-following around the
object, until goal direction is clear again.
Wandering Standpoint Algorithm
DistBug Algorithm
• Description
Local planning algorithm that guarantees convergence and will find
path if one exists.
• Required
Own position (odometry), goal position, and distance sensor data.
• Algorithm
Drive straight towards the goal when possible, otherwise do boundary-
following around an obstacle. If this brings the robot back to the same
previous collision point with the obstacle, then the goal is unreachable
DistBug Algorithm
Summary

More Related Content

What's hot

Robotics and Automation basic concepts
Robotics and Automation   basic conceptsRobotics and Automation   basic concepts
Robotics and Automation basic conceptsJAIGANESH SEKAR
 
Introduction to Mobile Robotics
Introduction to Mobile RoboticsIntroduction to Mobile Robotics
Introduction to Mobile RoboticsRobots Alive India
 
Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...
Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...
Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...Akira Taniguchi
 
Basics of Robotics
Basics of RoboticsBasics of Robotics
Basics of RoboticsAmeya Gandhi
 
Computer Vision sfm
Computer Vision sfmComputer Vision sfm
Computer Vision sfmWael Badawy
 
Unit 1 - Introduction to robotics
Unit 1 - Introduction to roboticsUnit 1 - Introduction to robotics
Unit 1 - Introduction to roboticsJonathan Fosdick
 
Machine Learning and Robotics
Machine Learning and RoboticsMachine Learning and Robotics
Machine Learning and Roboticsbutest
 
Feature detection and matching
Feature detection and matchingFeature detection and matching
Feature detection and matchingKuppusamy P
 
Introduction to ROBOTICS
Introduction to ROBOTICSIntroduction to ROBOTICS
Introduction to ROBOTICSelliando dias
 
Robotics pdf
Robotics pdfRobotics pdf
Robotics pdfAccies4
 
Presentation on Robotics
Presentation on RoboticsPresentation on Robotics
Presentation on RoboticsMuhammad Awais
 
Image restoration and enhancement #2
Image restoration and enhancement #2 Image restoration and enhancement #2
Image restoration and enhancement #2 Gera Paulos
 

What's hot (20)

Robotics and Automation basic concepts
Robotics and Automation   basic conceptsRobotics and Automation   basic concepts
Robotics and Automation basic concepts
 
Introduction to Mobile Robotics
Introduction to Mobile RoboticsIntroduction to Mobile Robotics
Introduction to Mobile Robotics
 
Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...
Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...
Simultaneous Localization, Mapping and Self-body Shape Estimation by a Mobile...
 
Basics of Robotics
Basics of RoboticsBasics of Robotics
Basics of Robotics
 
ppt on image processing
ppt on image processingppt on image processing
ppt on image processing
 
Robot Leg Mechanism.ppt
Robot Leg Mechanism.pptRobot Leg Mechanism.ppt
Robot Leg Mechanism.ppt
 
Computer Vision sfm
Computer Vision sfmComputer Vision sfm
Computer Vision sfm
 
Robotics
RoboticsRobotics
Robotics
 
Unit 1 - Introduction to robotics
Unit 1 - Introduction to roboticsUnit 1 - Introduction to robotics
Unit 1 - Introduction to robotics
 
Machine Learning and Robotics
Machine Learning and RoboticsMachine Learning and Robotics
Machine Learning and Robotics
 
Feature detection and matching
Feature detection and matchingFeature detection and matching
Feature detection and matching
 
Introduction to ROBOTICS
Introduction to ROBOTICSIntroduction to ROBOTICS
Introduction to ROBOTICS
 
Overview of Robotics
Overview of RoboticsOverview of Robotics
Overview of Robotics
 
Robotics pdf
Robotics pdfRobotics pdf
Robotics pdf
 
Presentation on Robotics
Presentation on RoboticsPresentation on Robotics
Presentation on Robotics
 
robotics ppt
robotics ppt robotics ppt
robotics ppt
 
Image restoration and enhancement #2
Image restoration and enhancement #2 Image restoration and enhancement #2
Image restoration and enhancement #2
 
Object tracking
Object trackingObject tracking
Object tracking
 
Trajectory
TrajectoryTrajectory
Trajectory
 
MOBILE ROBOTIC SYSTEM
MOBILE ROBOTIC SYSTEMMOBILE ROBOTIC SYSTEM
MOBILE ROBOTIC SYSTEM
 

Similar to Lecture 12 localization and navigation

Muhammad rizwan aqeel rlp.ppt
Muhammad rizwan aqeel rlp.pptMuhammad rizwan aqeel rlp.ppt
Muhammad rizwan aqeel rlp.pptM Rizwan Aqeel
 
Multiple UGV SLAM Map Sharing
Multiple UGV SLAM Map SharingMultiple UGV SLAM Map Sharing
Multiple UGV SLAM Map SharingAkash Borate
 
Dynamic Path Planning
Dynamic Path PlanningDynamic Path Planning
Dynamic Path Planningdare2kreate
 
Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...
Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...
Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...Aritra Sarkar
 
Autonomous laser guided vehicle for book deposition in a library
Autonomous laser guided vehicle for book deposition in a libraryAutonomous laser guided vehicle for book deposition in a library
Autonomous laser guided vehicle for book deposition in a libraryPushkar Limaye
 
Robotix & Industrial Robots
Robotix & Industrial RobotsRobotix & Industrial Robots
Robotix & Industrial Robotsparthbabariya151
 
IRJET- Simultaneous Localization and Mapping for Automatic Chair Re-Arran...
IRJET-  	  Simultaneous Localization and Mapping for Automatic Chair Re-Arran...IRJET-  	  Simultaneous Localization and Mapping for Automatic Chair Re-Arran...
IRJET- Simultaneous Localization and Mapping for Automatic Chair Re-Arran...IRJET Journal
 

Similar to Lecture 12 localization and navigation (20)

Muhammad rizwan aqeel rlp.ppt
Muhammad rizwan aqeel rlp.pptMuhammad rizwan aqeel rlp.ppt
Muhammad rizwan aqeel rlp.ppt
 
Multiple UGV SLAM Map Sharing
Multiple UGV SLAM Map SharingMultiple UGV SLAM Map Sharing
Multiple UGV SLAM Map Sharing
 
Lecture 7 robotics and ai
Lecture 7   robotics and ai Lecture 7   robotics and ai
Lecture 7 robotics and ai
 
Lps
LpsLps
Lps
 
Robotics Localization
Robotics LocalizationRobotics Localization
Robotics Localization
 
Dynamic Path Planning
Dynamic Path PlanningDynamic Path Planning
Dynamic Path Planning
 
Dgps
DgpsDgps
Dgps
 
Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...
Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...
Computer-Vision based Centralized Multi-agent System on Matlab and Arduino Du...
 
Autonomous laser guided vehicle for book deposition in a library
Autonomous laser guided vehicle for book deposition in a libraryAutonomous laser guided vehicle for book deposition in a library
Autonomous laser guided vehicle for book deposition in a library
 
B_gps.pdf
B_gps.pdfB_gps.pdf
B_gps.pdf
 
Sensor's inside
Sensor's insideSensor's inside
Sensor's inside
 
Robotix & Industrial Robots
Robotix & Industrial RobotsRobotix & Industrial Robots
Robotix & Industrial Robots
 
Path planning all algos
Path planning all algosPath planning all algos
Path planning all algos
 
Total Station.pptx
Total Station.pptxTotal Station.pptx
Total Station.pptx
 
IRJET- Simultaneous Localization and Mapping for Automatic Chair Re-Arran...
IRJET-  	  Simultaneous Localization and Mapping for Automatic Chair Re-Arran...IRJET-  	  Simultaneous Localization and Mapping for Automatic Chair Re-Arran...
IRJET- Simultaneous Localization and Mapping for Automatic Chair Re-Arran...
 
AI Robotics
AI RoboticsAI Robotics
AI Robotics
 
Presentation5
Presentation5Presentation5
Presentation5
 
Lecture2
Lecture2Lecture2
Lecture2
 
Introduction to TLS Workflow Presentation
Introduction to TLS Workflow PresentationIntroduction to TLS Workflow Presentation
Introduction to TLS Workflow Presentation
 
ROBOTICS - Introduction to Robotics
ROBOTICS -  Introduction to RoboticsROBOTICS -  Introduction to Robotics
ROBOTICS - Introduction to Robotics
 

More from Vajira Thambawita

Lecture 4 principles of parallel algorithm design updated
Lecture 4   principles of parallel algorithm design updatedLecture 4   principles of parallel algorithm design updated
Lecture 4 principles of parallel algorithm design updatedVajira Thambawita
 
Lecture 3 parallel programming platforms
Lecture 3   parallel programming platformsLecture 3   parallel programming platforms
Lecture 3 parallel programming platformsVajira Thambawita
 
Lecture 2 more about parallel computing
Lecture 2   more about parallel computingLecture 2   more about parallel computing
Lecture 2 more about parallel computingVajira Thambawita
 
Lecture 1 introduction to parallel and distributed computing
Lecture 1   introduction to parallel and distributed computingLecture 1   introduction to parallel and distributed computing
Lecture 1 introduction to parallel and distributed computingVajira Thambawita
 
Lecture 11 neural network principles
Lecture 11 neural network principlesLecture 11 neural network principles
Lecture 11 neural network principlesVajira Thambawita
 
Lecture 10 mobile robot design
Lecture 10 mobile robot designLecture 10 mobile robot design
Lecture 10 mobile robot designVajira Thambawita
 
Lecture 08 robots and controllers
Lecture 08 robots and controllersLecture 08 robots and controllers
Lecture 08 robots and controllersVajira Thambawita
 
Lecture 06 pic programming in c
Lecture 06 pic programming in cLecture 06 pic programming in c
Lecture 06 pic programming in cVajira Thambawita
 
Lecture 05 pic io port programming
Lecture 05 pic io port programmingLecture 05 pic io port programming
Lecture 05 pic io port programmingVajira Thambawita
 
Lecture 04 branch call and time delay
Lecture 04  branch call and time delayLecture 04  branch call and time delay
Lecture 04 branch call and time delayVajira Thambawita
 
Lecture 02 mechatronics systems
Lecture 02 mechatronics systemsLecture 02 mechatronics systems
Lecture 02 mechatronics systemsVajira Thambawita
 
Lecture 1 - Introduction to embedded system and Robotics
Lecture 1 - Introduction to embedded system and RoboticsLecture 1 - Introduction to embedded system and Robotics
Lecture 1 - Introduction to embedded system and RoboticsVajira Thambawita
 
Lec 09 - Registers and Counters
Lec 09 - Registers and CountersLec 09 - Registers and Counters
Lec 09 - Registers and CountersVajira Thambawita
 
Lec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITS
Lec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITSLec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITS
Lec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITSVajira Thambawita
 
Lec 06 - Synchronous Sequential Logic
Lec 06 - Synchronous Sequential LogicLec 06 - Synchronous Sequential Logic
Lec 06 - Synchronous Sequential LogicVajira Thambawita
 
Lec 05 - Combinational Logic
Lec 05 - Combinational LogicLec 05 - Combinational Logic
Lec 05 - Combinational LogicVajira Thambawita
 

More from Vajira Thambawita (20)

Lecture 4 principles of parallel algorithm design updated
Lecture 4   principles of parallel algorithm design updatedLecture 4   principles of parallel algorithm design updated
Lecture 4 principles of parallel algorithm design updated
 
Lecture 3 parallel programming platforms
Lecture 3   parallel programming platformsLecture 3   parallel programming platforms
Lecture 3 parallel programming platforms
 
Lecture 2 more about parallel computing
Lecture 2   more about parallel computingLecture 2   more about parallel computing
Lecture 2 more about parallel computing
 
Lecture 1 introduction to parallel and distributed computing
Lecture 1   introduction to parallel and distributed computingLecture 1   introduction to parallel and distributed computing
Lecture 1 introduction to parallel and distributed computing
 
Lecture 11 neural network principles
Lecture 11 neural network principlesLecture 11 neural network principles
Lecture 11 neural network principles
 
Lecture 10 mobile robot design
Lecture 10 mobile robot designLecture 10 mobile robot design
Lecture 10 mobile robot design
 
Lecture 09 control
Lecture 09 controlLecture 09 control
Lecture 09 control
 
Lecture 08 robots and controllers
Lecture 08 robots and controllersLecture 08 robots and controllers
Lecture 08 robots and controllers
 
Lecture 07 more about pic
Lecture 07 more about picLecture 07 more about pic
Lecture 07 more about pic
 
Lecture 06 pic programming in c
Lecture 06 pic programming in cLecture 06 pic programming in c
Lecture 06 pic programming in c
 
Lecture 05 pic io port programming
Lecture 05 pic io port programmingLecture 05 pic io port programming
Lecture 05 pic io port programming
 
Lecture 04 branch call and time delay
Lecture 04  branch call and time delayLecture 04  branch call and time delay
Lecture 04 branch call and time delay
 
Lecture 03 basics of pic
Lecture 03 basics of picLecture 03 basics of pic
Lecture 03 basics of pic
 
Lecture 02 mechatronics systems
Lecture 02 mechatronics systemsLecture 02 mechatronics systems
Lecture 02 mechatronics systems
 
Lecture 1 - Introduction to embedded system and Robotics
Lecture 1 - Introduction to embedded system and RoboticsLecture 1 - Introduction to embedded system and Robotics
Lecture 1 - Introduction to embedded system and Robotics
 
Lec 09 - Registers and Counters
Lec 09 - Registers and CountersLec 09 - Registers and Counters
Lec 09 - Registers and Counters
 
Lec 08 - DESIGN PROCEDURE
Lec 08 - DESIGN PROCEDURELec 08 - DESIGN PROCEDURE
Lec 08 - DESIGN PROCEDURE
 
Lec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITS
Lec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITSLec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITS
Lec 07 - ANALYSIS OF CLOCKED SEQUENTIAL CIRCUITS
 
Lec 06 - Synchronous Sequential Logic
Lec 06 - Synchronous Sequential LogicLec 06 - Synchronous Sequential Logic
Lec 06 - Synchronous Sequential Logic
 
Lec 05 - Combinational Logic
Lec 05 - Combinational LogicLec 05 - Combinational Logic
Lec 05 - Combinational Logic
 

Recently uploaded

POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptxPOINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptxSayali Powar
 
Employee wellbeing at the workplace.pptx
Employee wellbeing at the workplace.pptxEmployee wellbeing at the workplace.pptx
Employee wellbeing at the workplace.pptxNirmalaLoungPoorunde1
 
Introduction to AI in Higher Education_draft.pptx
Introduction to AI in Higher Education_draft.pptxIntroduction to AI in Higher Education_draft.pptx
Introduction to AI in Higher Education_draft.pptxpboyjonauth
 
microwave assisted reaction. General introduction
microwave assisted reaction. General introductionmicrowave assisted reaction. General introduction
microwave assisted reaction. General introductionMaksud Ahmed
 
URLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website AppURLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website AppCeline George
 
The basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptxThe basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptxheathfieldcps1
 
Accessible design: Minimum effort, maximum impact
Accessible design: Minimum effort, maximum impactAccessible design: Minimum effort, maximum impact
Accessible design: Minimum effort, maximum impactdawncurless
 
The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13Steve Thomason
 
Concept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.CompdfConcept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.CompdfUmakantAnnand
 
Sanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdfSanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdfsanyamsingh5019
 
Solving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptxSolving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptxOH TEIK BIN
 
Call Girls in Dwarka Mor Delhi Contact Us 9654467111
Call Girls in Dwarka Mor Delhi Contact Us 9654467111Call Girls in Dwarka Mor Delhi Contact Us 9654467111
Call Girls in Dwarka Mor Delhi Contact Us 9654467111Sapana Sha
 
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdfBASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdfSoniaTolstoy
 
How to Configure Email Server in Odoo 17
How to Configure Email Server in Odoo 17How to Configure Email Server in Odoo 17
How to Configure Email Server in Odoo 17Celine George
 
Separation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and ActinidesSeparation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and ActinidesFatimaKhan178732
 
Crayon Activity Handout For the Crayon A
Crayon Activity Handout For the Crayon ACrayon Activity Handout For the Crayon A
Crayon Activity Handout For the Crayon AUnboundStockton
 
Incoming and Outgoing Shipments in 1 STEP Using Odoo 17
Incoming and Outgoing Shipments in 1 STEP Using Odoo 17Incoming and Outgoing Shipments in 1 STEP Using Odoo 17
Incoming and Outgoing Shipments in 1 STEP Using Odoo 17Celine George
 

Recently uploaded (20)

POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptxPOINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
POINT- BIOCHEMISTRY SEM 2 ENZYMES UNIT 5.pptx
 
Employee wellbeing at the workplace.pptx
Employee wellbeing at the workplace.pptxEmployee wellbeing at the workplace.pptx
Employee wellbeing at the workplace.pptx
 
Staff of Color (SOC) Retention Efforts DDSD
Staff of Color (SOC) Retention Efforts DDSDStaff of Color (SOC) Retention Efforts DDSD
Staff of Color (SOC) Retention Efforts DDSD
 
Introduction to AI in Higher Education_draft.pptx
Introduction to AI in Higher Education_draft.pptxIntroduction to AI in Higher Education_draft.pptx
Introduction to AI in Higher Education_draft.pptx
 
microwave assisted reaction. General introduction
microwave assisted reaction. General introductionmicrowave assisted reaction. General introduction
microwave assisted reaction. General introduction
 
URLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website AppURLs and Routing in the Odoo 17 Website App
URLs and Routing in the Odoo 17 Website App
 
Código Creativo y Arte de Software | Unidad 1
Código Creativo y Arte de Software | Unidad 1Código Creativo y Arte de Software | Unidad 1
Código Creativo y Arte de Software | Unidad 1
 
The basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptxThe basics of sentences session 2pptx copy.pptx
The basics of sentences session 2pptx copy.pptx
 
Accessible design: Minimum effort, maximum impact
Accessible design: Minimum effort, maximum impactAccessible design: Minimum effort, maximum impact
Accessible design: Minimum effort, maximum impact
 
The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13The Most Excellent Way | 1 Corinthians 13
The Most Excellent Way | 1 Corinthians 13
 
Concept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.CompdfConcept of Vouching. B.Com(Hons) /B.Compdf
Concept of Vouching. B.Com(Hons) /B.Compdf
 
Sanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdfSanyam Choudhary Chemistry practical.pdf
Sanyam Choudhary Chemistry practical.pdf
 
Solving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptxSolving Puzzles Benefits Everyone (English).pptx
Solving Puzzles Benefits Everyone (English).pptx
 
Call Girls in Dwarka Mor Delhi Contact Us 9654467111
Call Girls in Dwarka Mor Delhi Contact Us 9654467111Call Girls in Dwarka Mor Delhi Contact Us 9654467111
Call Girls in Dwarka Mor Delhi Contact Us 9654467111
 
9953330565 Low Rate Call Girls In Rohini Delhi NCR
9953330565 Low Rate Call Girls In Rohini  Delhi NCR9953330565 Low Rate Call Girls In Rohini  Delhi NCR
9953330565 Low Rate Call Girls In Rohini Delhi NCR
 
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdfBASLIQ CURRENT LOOKBOOK  LOOKBOOK(1) (1).pdf
BASLIQ CURRENT LOOKBOOK LOOKBOOK(1) (1).pdf
 
How to Configure Email Server in Odoo 17
How to Configure Email Server in Odoo 17How to Configure Email Server in Odoo 17
How to Configure Email Server in Odoo 17
 
Separation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and ActinidesSeparation of Lanthanides/ Lanthanides and Actinides
Separation of Lanthanides/ Lanthanides and Actinides
 
Crayon Activity Handout For the Crayon A
Crayon Activity Handout For the Crayon ACrayon Activity Handout For the Crayon A
Crayon Activity Handout For the Crayon A
 
Incoming and Outgoing Shipments in 1 STEP Using Odoo 17
Incoming and Outgoing Shipments in 1 STEP Using Odoo 17Incoming and Outgoing Shipments in 1 STEP Using Odoo 17
Incoming and Outgoing Shipments in 1 STEP Using Odoo 17
 

Lecture 12 localization and navigation

  • 2. Localization and Navigation • Localization and navigation are the two most important tasks for mobile robots. • We want to know where we are, and we need to be able to make a plan for how to reach a goal destination. • Localization, navigation, and mapping (in past) • Whole problem complex at once • SLAM (simultaneous localization and mapping)
  • 3. Localization • we need to know a robot’s position and orientation at all times. • The localization problem can be solved by using a global positioning system. • Outdoor setting  the satellite-based GPS • In an indoor setting  a global sensor network with infrared, sonar, laser, or radio
  • 5. Localization • Using two beacons can narrow down the robot position to two possibilities. • Only the robot’s position can be determined by this method, not its orientation. • The orientation has to be deducted from the change in position (difference between two subsequent positions) • How to use local sensors: • The sonar sensors can be mounted on the robot and the beacons are converted to reflective markers, then we have an autonomous robot with local sensors. • Another idea is to use light emitting homing beacons instead of sonar beacons.
  • 6. Localization • Homing beacons • The robot has either to perform a 360° rotation, or to possess an omni- directional vision system that allows it to determine the angle of a recognized light beacon. • The robot can determine its position and orientation.
  • 7. Localization • Dead reckoning • Dead reckoning is a nautical term from the 1700s when ships did not have modern navigation equipment. • Dead reckoning can be described as local polar coordinates, or more practically as turtle graphics geometry.
  • 9. Dijkstra’s Algorithm • Description Algorithm for computing all shortest paths from a given starting node in a fully connected graph. • Required: Relative distance information between all nodes; distances must not be negative. • Algorithm Start “ready set” with start node. In loop select node with shortest distance in every step, then compute distances to all of its neighbors and store path predecessors. Add current node to “ready set”; loop finishes when all nodes are included.
  • 10. A* Algorithm • Description Pronounced “A-Star”; heuristic algorithm for computing the shortest path from one given start node to one given goal node. • Required Relative distance information between all nodes plus lower bound of distance to goal from each node (e.g. air-line or linear distance). • Algorithm Maintain sorted list of paths to goal, in every step expand only the currently shortest path by adding adjacent node with shortest distance (including estimate of remaining distance to goal)
  • 11. Potential Field Method • Description Global map generation algorithm with virtual forces. • Required Start and goal position, positions of all obstacles and walls. • Algorithm Generate a map with virtual attracting and repelling forces. Start point, obstacles, and walls are repelling, goal is attracting; force strength is inverse to object distance; robot simply follows force field.
  • 13. Wandering Standpoint Algorithm • Description Local path planning algorithm. • Required Local distance sensor. • Algorithm Try to reach goal from start in direct line. When encountering an obstacle, measure avoidance angle for turning left and for turning right, turn to smaller angle. Continue with boundary-following around the object, until goal direction is clear again.
  • 15. DistBug Algorithm • Description Local planning algorithm that guarantees convergence and will find path if one exists. • Required Own position (odometry), goal position, and distance sensor data. • Algorithm Drive straight towards the goal when possible, otherwise do boundary- following around an obstacle. If this brings the robot back to the same previous collision point with the obstacle, then the goal is unreachable