SlideShare a Scribd company logo
APPLICATION OF ROBOTICS
FOR PATH PLANNING
Hitesh Mohapatra
https://www.linkedin.com/in/hiteshmohapatra/
WHAT IS ROBOTICS?
 Robotics is the engineering science and technology which
involves the conception , design , operation and manufacture of
robots and computer system for their control , sensory
feedback, and information processing .
 Electronics , mechanics and software are brought together by
robotics .
APPLICATION OF ROBOTICS
 Robots are used for jobs that are dirty ,dull and dangerous.
 Today robotics have many different application areas. some of those
are
 Outer space applications
 Military applications
 Intelligent home applications
 Industry
 Health service
Robotics of path planning
 Path planning is an important primitive for autonomous mobile robots
that lets robots find the shortest or otherwise optimal path between
two points .
 Path planning requires a map of the environment and the robot to be
aware of its location with respect the map.
 The goals of the path planning are
 Introduce suitable map representation
 Explain basic path-planning algorithms ranging from Dijkstra, to
A*, D* and RRT
 Introduce variation of the path planning problem, such as
coverage path planning .
Map representation
 Map representation have two complementary approaches: discrete
and continuous approximations.
 In a discrete approximation, a map is sub-divided into chunks of
equal (e.g., a grid or hexagonal map) or differing sizes (e.g., rooms in
a building). The latter maps are also known as topological maps.
Discrete maps lend themselves well to a graph representation. Here,
every chunk of the map corresponds to a vertex (also known as
“node”), which are connected by edges, if a robot can navigate from
one vertex to the other. For example a road-map is a topological map,
with intersections as vertices and roads as edges. Computationally, a
graph might be stored as an adjacency or incidence list/matrix.
A continuous approximation requires the definition of inner (obstacles)
and outer boundaries, typically in the form of a polygon, whereas paths
can be encoded as sequences of real numbers. Discrete maps are the
dominant representation in robotics.
 The most common map is the occupancy grid map. In a grid map, the
environment is discretized into squares of arbitrary resolution, e.g.
1cm x 1cm, on which obstacles are marked. In a probabilistic
occupancy grid, grid cells can also be marked with the probability
that they contain an obstacle. This is particularly important when the
position of the robot that senses an obstacle is uncertain.
Disadvantages of grid maps are their large memory requirements as
well as computational time to traverse data structures with large
numbers of vertices. A solution to the latter problem are topological
maps that encode entire rooms as vertices and use edges to indicate
navigable connections between them. There is no silver bullet, and
each application might require a different solution that could be a
combination of different map types.
Path-Planning Algorithms
 The problem to find a “shortest” path from one vertex to another
through a connected graph is of interest in multiple domains, most
prominently in the internet, where it is used to find an optimal route
for a data packet. The term “shortest” refers here to the minimum
cumulative edge cost, which could be physical distance (in a robotic
application), delay (in a networking application) or any other metric
that is important for a specific application.
One of the earliest and simplest algorithms is Dijkstra’s
algorithm. Starting from the initial vertex where the path
should start, the algorithm marks all direct neighbours of the
initial vertex with the cost to get there. It then proceeds from
the vertex with the lowest cost to all of its adjacent vertices
and marks them with the cost to get to them via itself if this
cost is lower.
Once all neighbours of a vertex have been checked, the
algorithm proceeds to the vertex with the next lowest cost. A
more detailed description of this algorithm is provided here .
Once the algorithm reaches the goal vertex, it terminates and
the robot can follow the edges pointing towards the lowest
edge cost.
Dijkstra’s algorithm for robotic path
planning,
Illustration of A* planning,
A* and D* become computationally expensive when either the search space is
large, e.g., due to a fine-grain resolution required for the task, or the dimensions
of the search problem are high, e.g. when planning for an arm with multiple
degrees of freedom. A more recent development known as Rapidly-Exploring
Random Trees (RRT) addresses this problem by using a randomized approach that
aims at quickly exploring a large area of the search space with iterative
refinement. For this, the algorithm selects a random point in the environment
and connects it to the initial vertex.
 Subsequent random points are then connected to the closest vertex in the
emerging graph. The graph is then connected to the goal node, whenever a
point in the tree comes close enough given some threshold. Although
generally a coverage algorithm (see also below), RRT can be used for path-
planning by maintaining the cost-to-start on each added point, and biasing
the selection of points to occasionally falling close to the goal. RRT can also
be used to take into account non-holonomic contraints of a specific platform
when generating the next random way-point. One way to implement this is to
calculate the next random point by applying random values to the robot’s
actuators and use the forward kinematics to calculate the next point. Most
recently, variations of RRT have been proposed that will eventually find an
optimal solution. Nevertheless, although RRT quickly finds some solution,
smooth paths usually require additional search algorithms that start from an
initial estimate provided by RRT.
Example of RRT
Robot embodiment
 In order to deal with the physical embodiment of the robot, which
complicates the path-planning process, the robot is reduced to a
point-mass and all the obstacles in the environment are grown by half
of the longest extension of the robot from its centre. This
representation is known as configuration space as it reduces the
representation of the robot to its x and y coordinates in the plane.
Most planning algorithms also do not consider the orientation of the
robot. If this is desired, an additional dimension needs to be
introduced into the configuration space.
Other path-planning applications
 Once the environment has been discretized into a graph we can employ other
algorithms from graph theory to plan desirable robot trajectories
 For example, floor coverage can be achieved by performing a depth-first
search (DFS) or a breadth-first-search (BFS) on a graph where each vertex has
the size of the coverage tool of the robot.
THANK YOU

More Related Content

What's hot

Inverse Kinematics
Inverse KinematicsInverse Kinematics
Inverse Kinematics
Hitesh Mohapatra
 
Motion Planning
Motion PlanningMotion Planning
Motion Planning
Alaa Khamis, PhD, SMIEEE
 
Introduction to Mobile Robotics
Introduction to Mobile RoboticsIntroduction to Mobile Robotics
Introduction to Mobile Robotics
Robots Alive India
 
Manipulator kinematics
Manipulator kinematicsManipulator kinematics
Manipulator kinematics
Sudhir Reddy
 
Robot motion planning
Robot motion planningRobot motion planning
Robot motion planning
AJAL A J
 
Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
nguyendattdh
 
Dh parameters robotics
Dh  parameters roboticsDh  parameters robotics
Dh parameters robotics
Mahmoud Hussein
 
An introduction to robotics classification, kinematics and hardware
An introduction to robotics classification, kinematics and hardwareAn introduction to robotics classification, kinematics and hardware
An introduction to robotics classification, kinematics and hardware
Nikhil Shrivas
 
Robot Path Control
Robot Path ControlRobot Path Control
Robotics
RoboticsRobotics
Robotics
Madugula Kumar
 
Industrial robotics
Industrial roboticsIndustrial robotics
Industrial robotics
Home
 
Robot kinematics
Robot kinematicsRobot kinematics
Robot kinematics
Varinder Singh
 
robot classification
robot classificationrobot classification
robot classification
Mohit Jain
 
Robotics and automation _ power sources and sensors
Robotics and automation _  power sources and sensorsRobotics and automation _  power sources and sensors
Robotics and automation _ power sources and sensors
JAIGANESH SEKAR
 
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Waqas Tariq
 
Ec6003 robotics and automation notes
Ec6003   robotics and automation notesEc6003   robotics and automation notes
Ec6003 robotics and automation notes
JAIGANESH SEKAR
 
Introduction to ROBOTICS
Introduction to ROBOTICSIntroduction to ROBOTICS
Introduction to ROBOTICS
elliando dias
 
Manipulator Jacobian
Manipulator JacobianManipulator Jacobian
Manipulator Jacobian
Hitesh Mohapatra
 
Robot programming
Robot programmingRobot programming
Robot programming
Gopal Saini
 
Robots
Robots Robots

What's hot (20)

Inverse Kinematics
Inverse KinematicsInverse Kinematics
Inverse Kinematics
 
Motion Planning
Motion PlanningMotion Planning
Motion Planning
 
Introduction to Mobile Robotics
Introduction to Mobile RoboticsIntroduction to Mobile Robotics
Introduction to Mobile Robotics
 
Manipulator kinematics
Manipulator kinematicsManipulator kinematics
Manipulator kinematics
 
Robot motion planning
Robot motion planningRobot motion planning
Robot motion planning
 
Chapter 2 robot kinematics
Chapter 2   robot kinematicsChapter 2   robot kinematics
Chapter 2 robot kinematics
 
Dh parameters robotics
Dh  parameters roboticsDh  parameters robotics
Dh parameters robotics
 
An introduction to robotics classification, kinematics and hardware
An introduction to robotics classification, kinematics and hardwareAn introduction to robotics classification, kinematics and hardware
An introduction to robotics classification, kinematics and hardware
 
Robot Path Control
Robot Path ControlRobot Path Control
Robot Path Control
 
Robotics
RoboticsRobotics
Robotics
 
Industrial robotics
Industrial roboticsIndustrial robotics
Industrial robotics
 
Robot kinematics
Robot kinematicsRobot kinematics
Robot kinematics
 
robot classification
robot classificationrobot classification
robot classification
 
Robotics and automation _ power sources and sensors
Robotics and automation _  power sources and sensorsRobotics and automation _  power sources and sensors
Robotics and automation _ power sources and sensors
 
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
Path Planning for Mobile Robot Navigation Using Voronoi Diagram and Fast Marc...
 
Ec6003 robotics and automation notes
Ec6003   robotics and automation notesEc6003   robotics and automation notes
Ec6003 robotics and automation notes
 
Introduction to ROBOTICS
Introduction to ROBOTICSIntroduction to ROBOTICS
Introduction to ROBOTICS
 
Manipulator Jacobian
Manipulator JacobianManipulator Jacobian
Manipulator Jacobian
 
Robot programming
Robot programmingRobot programming
Robot programming
 
Robots
Robots Robots
Robots
 

Similar to Robotics for Path Planning

artifical intelligence final paper
artifical intelligence final paperartifical intelligence final paper
artifical intelligence final paper
shiva karthik reddy koyya
 
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
CSCJournals
 
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
NITISH K
 
A simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 dA simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 d
ijaia
 
Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...
Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...
Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...
IJERA Editor
 
AbstractWe design an software to find optimal(shortest) path .docx
AbstractWe design an software to find optimal(shortest) path .docxAbstractWe design an software to find optimal(shortest) path .docx
AbstractWe design an software to find optimal(shortest) path .docx
aryan532920
 
Path planning all algos
Path planning all algosPath planning all algos
Path planning all algos
satwikchivukula
 
Iaetsd modified artificial potential fields algorithm for mobile robot path ...
Iaetsd modified  artificial potential fields algorithm for mobile robot path ...Iaetsd modified  artificial potential fields algorithm for mobile robot path ...
Iaetsd modified artificial potential fields algorithm for mobile robot path ...
Iaetsd Iaetsd
 
Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...
Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...
Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...
IRJET Journal
 
Trajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial EquationTrajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial Equation
gummaavinash7
 
What is an occupancy grid and how can it be used What are some of t.pdf
What is an occupancy grid and how can it be used What are some of t.pdfWhat is an occupancy grid and how can it be used What are some of t.pdf
What is an occupancy grid and how can it be used What are some of t.pdf
rbjain2007
 
Optimizing GIS based Systems
Optimizing GIS based SystemsOptimizing GIS based Systems
Optimizing GIS based Systems
Ajinkya Deshpande
 
Mobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimizationMobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimization
eSAT Publishing House
 
Shortest route finding using an object oriented database approach
Shortest route finding using an object oriented database approachShortest route finding using an object oriented database approach
Shortest route finding using an object oriented database approach
Alexander Decker
 
Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...
eSAT Journals
 
Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...
eSAT Publishing House
 
Robotics Navigation
Robotics NavigationRobotics Navigation
Robotics Navigation
cairo university
 
Motion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular WorkspaceMotion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular Workspace
International Journal of Engineering Inventions www.ijeijournal.com
 
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
idescitation
 
A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)
A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)
A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)
Gabriel Balderas
 

Similar to Robotics for Path Planning (20)

artifical intelligence final paper
artifical intelligence final paperartifical intelligence final paper
artifical intelligence final paper
 
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
A Path Planning Technique For Autonomous Mobile Robot Using Free-Configuratio...
 
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
DESIGN AND IMPLEMENTATION OF PATH PLANNING ALGORITHM
 
A simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 dA simulated motion planning algorithm in 2 d
A simulated motion planning algorithm in 2 d
 
Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...
Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...
Optimized Robot Path Planning Using Parallel Genetic Algorithm Based on Visib...
 
AbstractWe design an software to find optimal(shortest) path .docx
AbstractWe design an software to find optimal(shortest) path .docxAbstractWe design an software to find optimal(shortest) path .docx
AbstractWe design an software to find optimal(shortest) path .docx
 
Path planning all algos
Path planning all algosPath planning all algos
Path planning all algos
 
Iaetsd modified artificial potential fields algorithm for mobile robot path ...
Iaetsd modified  artificial potential fields algorithm for mobile robot path ...Iaetsd modified  artificial potential fields algorithm for mobile robot path ...
Iaetsd modified artificial potential fields algorithm for mobile robot path ...
 
Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...
Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...
Urban Bus Route Planning Using Reverse Labeling Dijkstra Algorithm for Tempor...
 
Trajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial EquationTrajectory Planning Through Polynomial Equation
Trajectory Planning Through Polynomial Equation
 
What is an occupancy grid and how can it be used What are some of t.pdf
What is an occupancy grid and how can it be used What are some of t.pdfWhat is an occupancy grid and how can it be used What are some of t.pdf
What is an occupancy grid and how can it be used What are some of t.pdf
 
Optimizing GIS based Systems
Optimizing GIS based SystemsOptimizing GIS based Systems
Optimizing GIS based Systems
 
Mobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimizationMobile robot path planning using ant colony optimization
Mobile robot path planning using ant colony optimization
 
Shortest route finding using an object oriented database approach
Shortest route finding using an object oriented database approachShortest route finding using an object oriented database approach
Shortest route finding using an object oriented database approach
 
Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...
 
Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...Design and implementation of path planning algorithm for wheeled mobile robot...
Design and implementation of path planning algorithm for wheeled mobile robot...
 
Robotics Navigation
Robotics NavigationRobotics Navigation
Robotics Navigation
 
Motion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular WorkspaceMotion of Robots in a Non Rectangular Workspace
Motion of Robots in a Non Rectangular Workspace
 
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
Implementation of D* Path Planning Algorithm with NXT LEGO Mindstorms Kit for...
 
A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)
A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)
A survey of geographic routing protocols for Vehicular Ad Hoc Networks (VANETs)
 

More from Hitesh Mohapatra

Generative AI leverages algorithms to create various forms of content
Generative AI leverages algorithms to create various forms of contentGenerative AI leverages algorithms to create various forms of content
Generative AI leverages algorithms to create various forms of content
Hitesh Mohapatra
 
Virtualization: A Key to Efficient Cloud Computing
Virtualization: A Key to Efficient Cloud ComputingVirtualization: A Key to Efficient Cloud Computing
Virtualization: A Key to Efficient Cloud Computing
Hitesh Mohapatra
 
Automating the Cloud: A Deep Dive into Virtual Machine Provisioning
Automating the Cloud: A Deep Dive into Virtual Machine ProvisioningAutomating the Cloud: A Deep Dive into Virtual Machine Provisioning
Automating the Cloud: A Deep Dive into Virtual Machine Provisioning
Hitesh Mohapatra
 
Harnessing the Power of Google Cloud Platform: Strategies and Applications
Harnessing the Power of Google Cloud Platform: Strategies and ApplicationsHarnessing the Power of Google Cloud Platform: Strategies and Applications
Harnessing the Power of Google Cloud Platform: Strategies and Applications
Hitesh Mohapatra
 
Scheduling in Cloud Computing
Scheduling in Cloud ComputingScheduling in Cloud Computing
Scheduling in Cloud Computing
Hitesh Mohapatra
 
Cloud-Case study
Cloud-Case study Cloud-Case study
Cloud-Case study
Hitesh Mohapatra
 
RAID
RAIDRAID
Load balancing in cloud computing.pptx
Load balancing in cloud computing.pptxLoad balancing in cloud computing.pptx
Load balancing in cloud computing.pptx
Hitesh Mohapatra
 
Cluster Computing
Cluster ComputingCluster Computing
Cluster Computing
Hitesh Mohapatra
 
ITU-T requirement for cloud and cloud deployment model
ITU-T requirement for cloud and cloud deployment modelITU-T requirement for cloud and cloud deployment model
ITU-T requirement for cloud and cloud deployment model
Hitesh Mohapatra
 
Leetcode Problem Solution
Leetcode Problem SolutionLeetcode Problem Solution
Leetcode Problem Solution
Hitesh Mohapatra
 
Leetcode Problem Solution
Leetcode Problem SolutionLeetcode Problem Solution
Leetcode Problem Solution
Hitesh Mohapatra
 
Trie Data Structure
Trie Data Structure Trie Data Structure
Trie Data Structure
Hitesh Mohapatra
 
Reviewing basic concepts of relational database
Reviewing basic concepts of relational databaseReviewing basic concepts of relational database
Reviewing basic concepts of relational database
Hitesh Mohapatra
 
Reviewing SQL Concepts
Reviewing SQL ConceptsReviewing SQL Concepts
Reviewing SQL Concepts
Hitesh Mohapatra
 
Advanced database protocols
Advanced database protocolsAdvanced database protocols
Advanced database protocols
Hitesh Mohapatra
 
Measures of query cost
Measures of query costMeasures of query cost
Measures of query cost
Hitesh Mohapatra
 
Involvement of WSN in Smart Cities
Involvement of WSN in Smart CitiesInvolvement of WSN in Smart Cities
Involvement of WSN in Smart Cities
Hitesh Mohapatra
 
Data Structure and its Fundamentals
Data Structure and its FundamentalsData Structure and its Fundamentals
Data Structure and its Fundamentals
Hitesh Mohapatra
 
WORKING WITH FILE AND PIPELINE PARAMETER BINDING
WORKING WITH FILE AND PIPELINE PARAMETER BINDINGWORKING WITH FILE AND PIPELINE PARAMETER BINDING
WORKING WITH FILE AND PIPELINE PARAMETER BINDING
Hitesh Mohapatra
 

More from Hitesh Mohapatra (20)

Generative AI leverages algorithms to create various forms of content
Generative AI leverages algorithms to create various forms of contentGenerative AI leverages algorithms to create various forms of content
Generative AI leverages algorithms to create various forms of content
 
Virtualization: A Key to Efficient Cloud Computing
Virtualization: A Key to Efficient Cloud ComputingVirtualization: A Key to Efficient Cloud Computing
Virtualization: A Key to Efficient Cloud Computing
 
Automating the Cloud: A Deep Dive into Virtual Machine Provisioning
Automating the Cloud: A Deep Dive into Virtual Machine ProvisioningAutomating the Cloud: A Deep Dive into Virtual Machine Provisioning
Automating the Cloud: A Deep Dive into Virtual Machine Provisioning
 
Harnessing the Power of Google Cloud Platform: Strategies and Applications
Harnessing the Power of Google Cloud Platform: Strategies and ApplicationsHarnessing the Power of Google Cloud Platform: Strategies and Applications
Harnessing the Power of Google Cloud Platform: Strategies and Applications
 
Scheduling in Cloud Computing
Scheduling in Cloud ComputingScheduling in Cloud Computing
Scheduling in Cloud Computing
 
Cloud-Case study
Cloud-Case study Cloud-Case study
Cloud-Case study
 
RAID
RAIDRAID
RAID
 
Load balancing in cloud computing.pptx
Load balancing in cloud computing.pptxLoad balancing in cloud computing.pptx
Load balancing in cloud computing.pptx
 
Cluster Computing
Cluster ComputingCluster Computing
Cluster Computing
 
ITU-T requirement for cloud and cloud deployment model
ITU-T requirement for cloud and cloud deployment modelITU-T requirement for cloud and cloud deployment model
ITU-T requirement for cloud and cloud deployment model
 
Leetcode Problem Solution
Leetcode Problem SolutionLeetcode Problem Solution
Leetcode Problem Solution
 
Leetcode Problem Solution
Leetcode Problem SolutionLeetcode Problem Solution
Leetcode Problem Solution
 
Trie Data Structure
Trie Data Structure Trie Data Structure
Trie Data Structure
 
Reviewing basic concepts of relational database
Reviewing basic concepts of relational databaseReviewing basic concepts of relational database
Reviewing basic concepts of relational database
 
Reviewing SQL Concepts
Reviewing SQL ConceptsReviewing SQL Concepts
Reviewing SQL Concepts
 
Advanced database protocols
Advanced database protocolsAdvanced database protocols
Advanced database protocols
 
Measures of query cost
Measures of query costMeasures of query cost
Measures of query cost
 
Involvement of WSN in Smart Cities
Involvement of WSN in Smart CitiesInvolvement of WSN in Smart Cities
Involvement of WSN in Smart Cities
 
Data Structure and its Fundamentals
Data Structure and its FundamentalsData Structure and its Fundamentals
Data Structure and its Fundamentals
 
WORKING WITH FILE AND PIPELINE PARAMETER BINDING
WORKING WITH FILE AND PIPELINE PARAMETER BINDINGWORKING WITH FILE AND PIPELINE PARAMETER BINDING
WORKING WITH FILE AND PIPELINE PARAMETER BINDING
 

Recently uploaded

Hematology Analyzer Machine - Complete Blood Count
Hematology Analyzer Machine - Complete Blood CountHematology Analyzer Machine - Complete Blood Count
Hematology Analyzer Machine - Complete Blood Count
shahdabdulbaset
 
Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...
Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...
Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...
shadow0702a
 
Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024
Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024
Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024
Sinan KOZAK
 
CEC 352 - SATELLITE COMMUNICATION UNIT 1
CEC 352 - SATELLITE COMMUNICATION UNIT 1CEC 352 - SATELLITE COMMUNICATION UNIT 1
CEC 352 - SATELLITE COMMUNICATION UNIT 1
PKavitha10
 
Properties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptxProperties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptx
MDSABBIROJJAMANPAYEL
 
Introduction to AI Safety (public presentation).pptx
Introduction to AI Safety (public presentation).pptxIntroduction to AI Safety (public presentation).pptx
Introduction to AI Safety (public presentation).pptx
MiscAnnoy1
 
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
Yasser Mahgoub
 
cnn.pptx Convolutional neural network used for image classication
cnn.pptx Convolutional neural network used for image classicationcnn.pptx Convolutional neural network used for image classication
cnn.pptx Convolutional neural network used for image classication
SakkaravarthiShanmug
 
The Python for beginners. This is an advance computer language.
The Python for beginners. This is an advance computer language.The Python for beginners. This is an advance computer language.
The Python for beginners. This is an advance computer language.
sachin chaurasia
 
CHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECT
CHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECTCHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECT
CHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECT
jpsjournal1
 
john krisinger-the science and history of the alcoholic beverage.pptx
john krisinger-the science and history of the alcoholic beverage.pptxjohn krisinger-the science and history of the alcoholic beverage.pptx
john krisinger-the science and history of the alcoholic beverage.pptx
Madan Karki
 
Unit-III-ELECTROCHEMICAL STORAGE DEVICES.ppt
Unit-III-ELECTROCHEMICAL STORAGE DEVICES.pptUnit-III-ELECTROCHEMICAL STORAGE DEVICES.ppt
Unit-III-ELECTROCHEMICAL STORAGE DEVICES.ppt
KrishnaveniKrishnara1
 
Embedded machine learning-based road conditions and driving behavior monitoring
Embedded machine learning-based road conditions and driving behavior monitoringEmbedded machine learning-based road conditions and driving behavior monitoring
Embedded machine learning-based road conditions and driving behavior monitoring
IJECEIAES
 
Software Quality Assurance-se412-v11.ppt
Software Quality Assurance-se412-v11.pptSoftware Quality Assurance-se412-v11.ppt
Software Quality Assurance-se412-v11.ppt
TaghreedAltamimi
 
Welding Metallurgy Ferrous Materials.pdf
Welding Metallurgy Ferrous Materials.pdfWelding Metallurgy Ferrous Materials.pdf
Welding Metallurgy Ferrous Materials.pdf
AjmalKhan50578
 
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
171ticu
 
Seminar on Distillation study-mafia.pptx
Seminar on Distillation study-mafia.pptxSeminar on Distillation study-mafia.pptx
Seminar on Distillation study-mafia.pptx
Madan Karki
 
Material for memory and display system h
Material for memory and display system hMaterial for memory and display system h
Material for memory and display system h
gowrishankartb2005
 
132/33KV substation case study Presentation
132/33KV substation case study Presentation132/33KV substation case study Presentation
132/33KV substation case study Presentation
kandramariana6
 
Mechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdfMechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdf
21UME003TUSHARDEB
 

Recently uploaded (20)

Hematology Analyzer Machine - Complete Blood Count
Hematology Analyzer Machine - Complete Blood CountHematology Analyzer Machine - Complete Blood Count
Hematology Analyzer Machine - Complete Blood Count
 
Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...
Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...
Use PyCharm for remote debugging of WSL on a Windo cf5c162d672e4e58b4dde5d797...
 
Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024
Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024
Optimizing Gradle Builds - Gradle DPE Tour Berlin 2024
 
CEC 352 - SATELLITE COMMUNICATION UNIT 1
CEC 352 - SATELLITE COMMUNICATION UNIT 1CEC 352 - SATELLITE COMMUNICATION UNIT 1
CEC 352 - SATELLITE COMMUNICATION UNIT 1
 
Properties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptxProperties Railway Sleepers and Test.pptx
Properties Railway Sleepers and Test.pptx
 
Introduction to AI Safety (public presentation).pptx
Introduction to AI Safety (public presentation).pptxIntroduction to AI Safety (public presentation).pptx
Introduction to AI Safety (public presentation).pptx
 
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
2008 BUILDING CONSTRUCTION Illustrated - Ching Chapter 02 The Building.pdf
 
cnn.pptx Convolutional neural network used for image classication
cnn.pptx Convolutional neural network used for image classicationcnn.pptx Convolutional neural network used for image classication
cnn.pptx Convolutional neural network used for image classication
 
The Python for beginners. This is an advance computer language.
The Python for beginners. This is an advance computer language.The Python for beginners. This is an advance computer language.
The Python for beginners. This is an advance computer language.
 
CHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECT
CHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECTCHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECT
CHINA’S GEO-ECONOMIC OUTREACH IN CENTRAL ASIAN COUNTRIES AND FUTURE PROSPECT
 
john krisinger-the science and history of the alcoholic beverage.pptx
john krisinger-the science and history of the alcoholic beverage.pptxjohn krisinger-the science and history of the alcoholic beverage.pptx
john krisinger-the science and history of the alcoholic beverage.pptx
 
Unit-III-ELECTROCHEMICAL STORAGE DEVICES.ppt
Unit-III-ELECTROCHEMICAL STORAGE DEVICES.pptUnit-III-ELECTROCHEMICAL STORAGE DEVICES.ppt
Unit-III-ELECTROCHEMICAL STORAGE DEVICES.ppt
 
Embedded machine learning-based road conditions and driving behavior monitoring
Embedded machine learning-based road conditions and driving behavior monitoringEmbedded machine learning-based road conditions and driving behavior monitoring
Embedded machine learning-based road conditions and driving behavior monitoring
 
Software Quality Assurance-se412-v11.ppt
Software Quality Assurance-se412-v11.pptSoftware Quality Assurance-se412-v11.ppt
Software Quality Assurance-se412-v11.ppt
 
Welding Metallurgy Ferrous Materials.pdf
Welding Metallurgy Ferrous Materials.pdfWelding Metallurgy Ferrous Materials.pdf
Welding Metallurgy Ferrous Materials.pdf
 
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样官方认证美国密歇根州立大学毕业证学位证书原版一模一样
官方认证美国密歇根州立大学毕业证学位证书原版一模一样
 
Seminar on Distillation study-mafia.pptx
Seminar on Distillation study-mafia.pptxSeminar on Distillation study-mafia.pptx
Seminar on Distillation study-mafia.pptx
 
Material for memory and display system h
Material for memory and display system hMaterial for memory and display system h
Material for memory and display system h
 
132/33KV substation case study Presentation
132/33KV substation case study Presentation132/33KV substation case study Presentation
132/33KV substation case study Presentation
 
Mechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdfMechanical Engineering on AAI Summer Training Report-003.pdf
Mechanical Engineering on AAI Summer Training Report-003.pdf
 

Robotics for Path Planning

  • 1. APPLICATION OF ROBOTICS FOR PATH PLANNING Hitesh Mohapatra https://www.linkedin.com/in/hiteshmohapatra/
  • 2. WHAT IS ROBOTICS?  Robotics is the engineering science and technology which involves the conception , design , operation and manufacture of robots and computer system for their control , sensory feedback, and information processing .  Electronics , mechanics and software are brought together by robotics .
  • 3. APPLICATION OF ROBOTICS  Robots are used for jobs that are dirty ,dull and dangerous.  Today robotics have many different application areas. some of those are  Outer space applications  Military applications  Intelligent home applications  Industry  Health service
  • 4. Robotics of path planning  Path planning is an important primitive for autonomous mobile robots that lets robots find the shortest or otherwise optimal path between two points .  Path planning requires a map of the environment and the robot to be aware of its location with respect the map.  The goals of the path planning are  Introduce suitable map representation  Explain basic path-planning algorithms ranging from Dijkstra, to A*, D* and RRT  Introduce variation of the path planning problem, such as coverage path planning .
  • 5. Map representation  Map representation have two complementary approaches: discrete and continuous approximations.  In a discrete approximation, a map is sub-divided into chunks of equal (e.g., a grid or hexagonal map) or differing sizes (e.g., rooms in a building). The latter maps are also known as topological maps. Discrete maps lend themselves well to a graph representation. Here, every chunk of the map corresponds to a vertex (also known as “node”), which are connected by edges, if a robot can navigate from one vertex to the other. For example a road-map is a topological map, with intersections as vertices and roads as edges. Computationally, a graph might be stored as an adjacency or incidence list/matrix.
  • 6. A continuous approximation requires the definition of inner (obstacles) and outer boundaries, typically in the form of a polygon, whereas paths can be encoded as sequences of real numbers. Discrete maps are the dominant representation in robotics.  The most common map is the occupancy grid map. In a grid map, the environment is discretized into squares of arbitrary resolution, e.g. 1cm x 1cm, on which obstacles are marked. In a probabilistic occupancy grid, grid cells can also be marked with the probability that they contain an obstacle. This is particularly important when the position of the robot that senses an obstacle is uncertain. Disadvantages of grid maps are their large memory requirements as well as computational time to traverse data structures with large numbers of vertices. A solution to the latter problem are topological maps that encode entire rooms as vertices and use edges to indicate navigable connections between them. There is no silver bullet, and each application might require a different solution that could be a combination of different map types.
  • 7. Path-Planning Algorithms  The problem to find a “shortest” path from one vertex to another through a connected graph is of interest in multiple domains, most prominently in the internet, where it is used to find an optimal route for a data packet. The term “shortest” refers here to the minimum cumulative edge cost, which could be physical distance (in a robotic application), delay (in a networking application) or any other metric that is important for a specific application.
  • 8. One of the earliest and simplest algorithms is Dijkstra’s algorithm. Starting from the initial vertex where the path should start, the algorithm marks all direct neighbours of the initial vertex with the cost to get there. It then proceeds from the vertex with the lowest cost to all of its adjacent vertices and marks them with the cost to get to them via itself if this cost is lower. Once all neighbours of a vertex have been checked, the algorithm proceeds to the vertex with the next lowest cost. A more detailed description of this algorithm is provided here . Once the algorithm reaches the goal vertex, it terminates and the robot can follow the edges pointing towards the lowest edge cost.
  • 9. Dijkstra’s algorithm for robotic path planning,
  • 10. Illustration of A* planning,
  • 11. A* and D* become computationally expensive when either the search space is large, e.g., due to a fine-grain resolution required for the task, or the dimensions of the search problem are high, e.g. when planning for an arm with multiple degrees of freedom. A more recent development known as Rapidly-Exploring Random Trees (RRT) addresses this problem by using a randomized approach that aims at quickly exploring a large area of the search space with iterative refinement. For this, the algorithm selects a random point in the environment and connects it to the initial vertex.  Subsequent random points are then connected to the closest vertex in the emerging graph. The graph is then connected to the goal node, whenever a point in the tree comes close enough given some threshold. Although generally a coverage algorithm (see also below), RRT can be used for path- planning by maintaining the cost-to-start on each added point, and biasing the selection of points to occasionally falling close to the goal. RRT can also be used to take into account non-holonomic contraints of a specific platform when generating the next random way-point. One way to implement this is to calculate the next random point by applying random values to the robot’s actuators and use the forward kinematics to calculate the next point. Most recently, variations of RRT have been proposed that will eventually find an optimal solution. Nevertheless, although RRT quickly finds some solution, smooth paths usually require additional search algorithms that start from an initial estimate provided by RRT.
  • 13. Robot embodiment  In order to deal with the physical embodiment of the robot, which complicates the path-planning process, the robot is reduced to a point-mass and all the obstacles in the environment are grown by half of the longest extension of the robot from its centre. This representation is known as configuration space as it reduces the representation of the robot to its x and y coordinates in the plane. Most planning algorithms also do not consider the orientation of the robot. If this is desired, an additional dimension needs to be introduced into the configuration space.
  • 14. Other path-planning applications  Once the environment has been discretized into a graph we can employ other algorithms from graph theory to plan desirable robot trajectories  For example, floor coverage can be achieved by performing a depth-first search (DFS) or a breadth-first-search (BFS) on a graph where each vertex has the size of the coverage tool of the robot.