Skip to content

Commit

Permalink
WIP #8: added astar library
Browse files Browse the repository at this point in the history
  • Loading branch information
BaibhaVatsa committed Mar 25, 2019
1 parent e13feaf commit 33d7c1e
Showing 1 changed file with 4 additions and 1 deletion.
5 changes: 4 additions & 1 deletion robot_navigation/scripts/path_planning.py
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,7 @@

# Import ROS packages
import rospy
import astar
from geometry_msgs.msg import Pose, PoseStamped
from nav_msgs.msg import Path, OccupancyGrid
from nav_msgs.srv import GetMap
Expand Down Expand Up @@ -51,7 +52,9 @@ def update_map(self):
# Compute a new route from start_pose to goal_pose and publish
# Uses A* search algorithm to compute the route
def generate_route(self):
pass
path = astar.AStar()
self.map = path.astar(self.start_pose,self.goal_pose)
print path


if __name__ == "__main__":
Expand Down

0 comments on commit 33d7c1e

Please sign in to comment.