a-star-algorithm

There are 650 repositories under a-star-algorithm topic.

  • Pathfinding

    honzaap/Pathfinding

    Pathfinding on a real map anywhere in the world

    Language:JavaScript3795740
  • brunomikoski/Simple-optimized-A-Pathfinder

    An simple and optimized grid pathfinding

    Language:C#25916141
  • pgeerkens/HexGridUtilitiesForGames

    Hex-grid utilities for board and strategy games with path-finding, field-of-view, and more

    Language:C#14414830
  • kbrizov/Pathfinding-Algorithms

    A visualizer for the core search algorithms used in AI and game development. Special thanks to Amit Patel and his cool tutorials for providing me with the inspiration. #MadeWithUnity

    Language:C#992014
  • seung-lab/dijkstra3d

    Dijkstra's Shortest Path for 6, 18, and 26-Connected 3D (Volumetric) Image Volumes

    Language:C++83212014
  • spood/PCGPathfinding

    An A* pathfinding implementation with PCG (Procedural Content Generation) to generate custom splines in unreal engine between two points

    Language:C++59204
  • windsuzu/Robotic-Navigation

    This repo implemented the core technology of the self-driving car, including the basic concepts such as path tracking, path planning, SLAM, etc., and deep learning techniques such as computer vision and reinforcement learning. Finally, we practiced with NVIDIA JetBot in both the simulator and the real world.

    Language:Jupyter Notebook512010
  • matthiaszarzecki/AStarPathfindingUnity

    Implementation of the A*-Algorithm in Unity3D

    Language:C#463118
  • parshva45/Vehicle-Monitoring-And-Routing-System

    The Vehicle Monitoring And Routing System (VMARS) makes use of GPS to provide the exact location of the vehicle. It allows a parent to monitor the vehicle in real-time using a GPS-based device possessed by its driver. It is also capable of finding the shortest route to reach the destination passing through all the checkpoints which uses our proposed algorithm to find the same. This system also possesses the facility of speed monitoring and giving sound alerts to the driver if he over speeds his vehicle. Also, the system gives accident alerts to the vehicle admin via SMS.

    Language:Java452020
  • PrudhviGNV/pathFinderVisualizer

    A react Application Used to visualize classical path finding algorithms like BFS, DFS, Dikstra's, A-star

    Language:JavaScript411112
  • sliding_puzzle

    gsurma/sliding_puzzle

    Swift implementation of the Sliding Puzzle game with Iterative Deepening A* AI Solver.

    Language:Swift373014
  • syntnc/Artificial-Intelligence

    IIIT Allahabad B. Tech. (IT) 5th Semester Artificial Intelligence Lab Assignments + HackerRank Artificial Intelligence Track

    Language:Python312125
  • alwaysbyx/Optimization-and-Search

    Implementation and visualization (some demos) of search and optimization algorithms.

    Language:Python30104
  • darienmt/FCND-Term1-P2-3D-Motion-Planning

    Udacity Flying Car Nanodegree - Term 1 - Project 2 - 3D Motion Planning

    Language:Jupyter Notebook303317
  • YahyaAlaaMassoud/Sliding-Puzzle-A-Star-Solver

    Implementation for A-star and BFS Algorithms to solve a NxN grid sliding puzzle problem.

    Language:Python291110
  • Chase-AI

    Zhuagenborn/Chase-AI

    🎮 An artificial intelligence game to demonstrate the A* pathfinding. The enemy will try to get close to the agent and make it stuck between walls.(用于演示A*寻路算法的人工智能游戏,敌人会追踪宝藏并尝试将其困在围墙之间。)

    Language:Python28213
  • LaurentVeyssier/Route-planner-algorithm

    Find the shortest route using A* algorithm and graphs (Route Planner application)

    Language:Jupyter Notebook27101
  • shushrutsharma/18CSC305J-AI

    All Lab experiments of 18CSC305J Artificial Intelligence.

    Language:Jupyter Notebook262145
  • eamontoyaa/pyBIMstab

    Application software in Python 3 to evaluate the factor of safety against sliding of slopes made of Blocks-In-Matrix materials.

    Language:Python254210
  • GurkNathe/Pathfinding-Algorithms

    A Python implementation and visualization of various pathfinding and graph search algorithms.

    Language:Python252213
  • ivanbgd/A-Star_Algorithm

    Several different implementations of the A-Star search algorithm, including a Bidirectional version - used for finding the shortest path in a graph.

    Language:Python23003
  • gmac/constellation-js

    A grid geometry toolkit for A* pathfinding and 2D sprite motion.

    Language:JavaScript22115
  • BlondeBurrito/hexagonal_pathfinding_astar

    An implementation of the A-Star pathfinding algorithm tailored for traversing a bespoke collection of weighted hexagons. It's intended to calculate the most optimal path to a target hexagon where you are traversing from the centre of one hexagon to the next along a line orthogonal to a hexagon edge

    Language:Rust21141
  • ForlornU/A-Star-pathfinding

    A small demo for the A* Pathfinding algorithm in unity3d. Characters in this scene act "turn based" walking one at a time to wherever you point them to

    Language:ShaderLab20108
  • gabrieldrn/Java-Maze-Solver

    Maze solving in java with BFS, DFS, A*

    Language:Java20106
  • KTS-o7/AIML-Lab

    Contains 5th Semester AIML Lab programs

    Language:Python19106
  • arnav-t/Shooting-Game

    Basic Shooting Game in C++ and OpenCV

    Language:C++1843827
  • C-Collamar/8-Puzzle-Solver

    A BFS and A* implementation to the classic 8-puzzle problem

    Language:C18108
  • bengsfort/8-puzzle-solutions

    Solutions to the classic 8 puzzle, implementing an A* best search algorithm to complete the puzzle in multiple languages.

    Language:JavaScript16206
  • CodeAltus/Snake-AI

    Using the A* pathfinding algorithm to play the classic snake game perfectly

    Language:JavaScript16101
  • etopuz/The-Prophecy

    Top-Down Roguelite Game

    Language:C#16104
  • multirobotplayground/Noetic-Multi-Robot-Sandbox

    This workspace is a sandbox for multi-robot research. Initially, it includes a fully opperational multi-robot exploration stack for ROS Noetic and Ubuntu 20.04 that allows them to keep intermittent communication in Gazebo 11 simulations.

    Language:C++16202
  • Shaswat2001/Motion_planning_of_Robots

    This repository implements various Search Based (Heuristic and Incremental) and Sampling Based (Multi Query and Single Query) motion planning algorithms using ROS and turtlebot

    Language:Python16201
  • bluedistro/Graph-Traversal

    A fine-tuned visual implementation of Informed and Uninformed Search Algorithms such as Breadth First Search, Depth First Search, Uniform Cost Search, A* Search, Greedy First Search

    Language:Python15106
  • maze-runner

    malkfilipp/maze-runner

    Maze Runner is a maze generation and solving tool using the randomized Kruskal's algorithm and the A* algorithm

    Language:Java15007
  • hamed-rezaee/flutter_maze_generator

    A maze generator written in Dart and Flutter.

    Language:C++14201