Projects in Awesome Lists tagged with a-star
A curated list of projects in awesome lists tagged with a-star .
https://github.com/afshinea/stanford-cs-221-artificial-intelligence
VIP cheatsheets for Stanford's CS 221 Artificial Intelligence
a-star artificial-intelligence bayesian-networks cheatsheet constraint-satisfaction-problem data-science markov-decision-processes
Last synced: 06 Jul 2025
https://github.com/ai-winter/matlab_motion_planning
Motion planning and Navigation of AGV/AMR:matlab implementation of Dijkstra, A*, Theta*, JPS, D*, LPA*, D* Lite, RRT, RRT*, RRT-Connect, Informed RRT*, ACO, Voronoi, PID, LQR, MPC, APF, RPP, DWA, DDPG, Bezier, B-spline, Dubins, Reeds-Shepp etc.
a-star ant-colony-optimization artificial-potential-field d-star dijkstra dynamic-window-approach informed-rrt-star jump-point-search lqr-controller motion-planning mpc-control pid-control rrt rrt-connect rrt-star theta-star voronoi
Last synced: 05 Apr 2025
https://github.com/mehrdadn/sota-py
A discrete-time Python-based solver for the Stochastic On-Time Arrival routing problem
a-star arrival convolution dijkstra-shortest-path pathfinding-algorithm reliable-routing routing routing-algorithm shortest-path-problem shortest-path-routing-algorithm shortest-pathfinding-algorithm stochastic-dynamic-programming stochastic-models transportation transportation-network transportation-planning transportation-problem
Last synced: 14 Apr 2025
https://github.com/mehrdadn/SOTA-Py
A discrete-time Python-based solver for the Stochastic On-Time Arrival routing problem
a-star arrival convolution dijkstra-shortest-path pathfinding-algorithm reliable-routing routing routing-algorithm shortest-path-problem shortest-path-routing-algorithm shortest-pathfinding-algorithm stochastic-dynamic-programming stochastic-models transportation transportation-network transportation-planning transportation-problem
Last synced: 19 Jul 2025
https://github.com/dbrizov/unity-pathfindingalgorithms
BFS, Greedy Best-First Search, Dijkstra and A* path finding algorithms
a-star bfs dijkstra greedy-bfs pathfinding unity3d
Last synced: 09 Apr 2025
https://github.com/dbrizov/Unity-PathFindingAlgorithms
BFS, Greedy Best-First Search, Dijkstra and A* path finding algorithms
a-star bfs dijkstra greedy-bfs pathfinding unity3d
Last synced: 25 Apr 2025
https://github.com/brunomikoski/simple-optimized-a-pathfinder
An simple and optimized grid pathfinding
a-star a-star-algorithm c-sharp pathfinder pathfinding unity unity3d
Last synced: 09 Apr 2025
https://github.com/brunomikoski/Simple-optimized-A-Pathfinder
An simple and optimized grid pathfinding
a-star a-star-algorithm c-sharp pathfinder pathfinding unity unity3d
Last synced: 25 Apr 2025
https://github.com/ai-winter/python_motion_planning
Motion planning and Navigation of AGV/AMR:ROS planner plugin implementation of A*, JPS, D*, LPA*, D* Lite, (Lazy)Theta*, RRT, RRT*, RRT-Connect, Informed RRT*, ACO, Voronoi, PID, DWA, APF, LQR, MPC, Bezier, Dubins etc.
a-star ant-colony-optimization artificial-potential-field bezier-curve d-star d-star-lite dijkstra dubins-curve informed-rrt-star jump-point-search lazy-theta-star lpa-star model-predictive-control motion-planning python rrt rrt-connect rrt-star theta-star voronoi
Last synced: 31 Mar 2025
https://github.com/quasilyte/pathing
A very fast & zero-allocation, grid-based, pathfinding library for Go.
a-star ebiten ebitengine game-development gamedev go golang greedy-bfs library pathfinding performance
Last synced: 16 Mar 2025
https://github.com/digitsensitive/astar-typescript
A* search algorithm in TypeScript
a-star a-star-path-finding a-star-search astar astar-typescript game path-finding pathfinding search-algorithm typescript
Last synced: 13 Apr 2025
https://github.com/selimanac/defold-astar
Pathfinder and A* solver (astar or a-star) native extension for Defold Engine build on MicroPather.
a-star astar astar-algorithm astar-pathfinding defold defold-game-engine defold-library micropather pather pathfinder pathfinding
Last synced: 12 Apr 2025
https://github.com/ty0x2333/a-star
A* search algorithm for Cocos Creator.
a-star cocos-creator search-algorithm
Last synced: 04 May 2025
https://github.com/minhaskamal/algorithmimplementations
Implementation of Elementary Algorithms (infix-prefix-postfix-evaluation-to-longest-common-increasing-sub-sequence-activity-selection-balance-kd-binary-heap-binomial-tree-breath-depth-first-search-max-flow-shortest-path-topological-sort-calculus-derivative-integration-forward-interpolation-simpson-rule-intersecting-area-non-linear-equation-jacobis-gauss-seidal-bisection-false-position-newton-raphson-fixed-point-secant-cigarette-smokers-genetic-huffman-a-a*-star-binary-knuth-morris-pratt-kmp-quick-thread-priority-based-premitive-shortest-job-non-primitive-arithmetic-expression-data-structures-list-node-implementation-one-two-way-linked-stack-string-graph-numerical-methods-equation-solving-solve-process-problem-search-sort-prime-ugly-friend-perfect-fibonacci-factorial-factor-number)
a-star algorithm algorithms assembly c c-plus-plus factor factorial fibonacci-numbers friend-number genetic-algorithm graph huffman java prime-numbers sort tree
Last synced: 11 Apr 2025
https://github.com/seung-lab/dijkstra3d
Dijkstra's Shortest Path for 6, 18, and 26-Connected 3D (Volumetric) Image Volumes
2d 3d 3d-image-volumes a-star a-star-algorithm a-star-search bidirectional-dijkstra bidirectional-search biomedical-image-processing cpp dijkstra dijkstra-algorithm dijkstra-shortest-path path-planning pathfinding python shortest-path skeletonization unidirectional-search
Last synced: 07 Apr 2025
https://github.com/riscy/a_star_on_grids
Best practices for implementing A* with a focus on four- and eight-connected grid worlds.
a-star best-practices fringe-search game-ai pathfinding
Last synced: 17 Jun 2025
https://github.com/matthiaszarzecki/AStarPathfindingUnity
Implementation of the A*-Algorithm in Unity3D
a-star a-star-algorithm pathfinding unity unity3d
Last synced: 25 Apr 2025
https://github.com/gsurma/sliding_puzzle
Swift implementation of the Sliding Puzzle game with Iterative Deepening A* AI Solver.
a-star a-star-algorithm ai artificial-intelligence ida ios iterative-deepening-a-star iterative-deepening-search sliding-puzzle-game swift
Last synced: 21 Jun 2025
https://github.com/coryleeio/gridpath
Gridpath is a MIT licensed multithreaded 2D implementation of A*
a-star gamdev pathfinding pathfinding-framework pathfinding-library
Last synced: 13 Apr 2025
https://github.com/ovflowd/yupi
:game_die: open source gaming emulator for flash based games
a-star big-integer-in-c c-sharp emulation flash habbo rc4 swf
Last synced: 21 Aug 2025
https://github.com/gmac/constellation-js
A grid geometry toolkit for A* pathfinding and 2D sprite motion.
2d a-star a-star-algorithm a-star-path-finding a-star-search geometry pathfinding sprite
Last synced: 13 Apr 2025
https://github.com/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
a-star a-star-algorithm pathfinding pathfinding-algorithm rust
Last synced: 07 Oct 2025
https://github.com/demonstrandum/crystal_maze
A* Path finding for PNG mazes, from Ruby now in Crystal. Using StumpyPNG
a-star algorithm crystal labyrinth maze maze-solver png solver stumpy
Last synced: 07 Apr 2025
https://github.com/Demonstrandum/crystal_maze
A* Path finding for PNG mazes, from Ruby now in Crystal. Using StumpyPNG
a-star algorithm crystal labyrinth maze maze-solver png solver stumpy
Last synced: 02 May 2025
https://github.com/yashbansod/cpp_planning
This is a C++ repository containing various algorithms implemented by me for solving robotics problems
a-star ana-star ara-star d-star-lite dijkstra kalman-filter motion-planning motion-prediction path-planning robotics rrt weighted-a-star
Last synced: 11 Jun 2025
https://github.com/justbuchanan/graph-algorithms-qt
Basic graph algorithms + Qt GUI
a-star algorithms bazel dijkstra qml qt5
Last synced: 20 Oct 2025
https://github.com/etopuz/the-prophecy
Top-Down Roguelite Game
a-star a-star-algorithm a-star-path-finding dungeon-generator pathfinding procedural-generation random-generation top-down top-down-game top-down-movement top-down-shooter unity unity-2d unity-2d-game unity-2d-pathfinding unity2d unity2d-character-movement
Last synced: 13 May 2025
https://github.com/atlou/route
Winner of Swift Student Challenge 2024. Pathfinding visualization iOS app built with SwiftUI.
a-star dijkstra greedy-best-first-search pathfinding swift swift-student-challenge swift-student-challenge-winner swiftui wwdc24
Last synced: 11 Apr 2025
https://github.com/memgonzales/sliding-puzzle
8-puzzle game that features a walkthrough of the optimal solution and allows users to customize the tiles using photos from their Gallery
8-puzzle 8-puzzle-solver a-star android android-app gradle heuristics informed-search intelligent-systems junit4 kotlin manhattan-distance mobile-development pathfinding puzzle puzzle-game
Last synced: 15 May 2025
https://github.com/shakadak/lua-astar
A simple generic Lua implementation of the A* (A star) pathfinding algorithm
a-star agnostic-pathfinding agnostic-pathfinding-algorithm astar generic graph lua pathfinding pathfinding-algorithm
Last synced: 16 Sep 2025
https://github.com/yeyom/mazesolver
Maze Solver built with python. Using DFS, BFS, Dijkstra, A* Star.
a-star bfs dfs dijkstra-algorithm maze maze-algorithms maze-generator maze-generator-solver maze-solver search-algorithm
Last synced: 15 Oct 2025
https://github.com/quantumlib/tesseract-decoder
A search-based decoder for quantum error correction (QEC)
a-star algorithms color-code cpp google-quantum qec-codes quantum quantum-computing quantum-error-correction surface-code syndrome-decoding
Last synced: 18 Mar 2025
https://github.com/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
a-star a-star-algorithm a-star-path-finding game-development pathfinding unity3d
Last synced: 30 Apr 2025
https://github.com/gkonovalov/algorithms
Algorithms and Data Structures a comprehensive collection of fundamental Algorithms and Data structures organized into various categories to cater to the needs of software engineers and computer science students.
a-star algorithm algorithms algorithms-and-data-structures bellman-ford binary-search convex-hull data-structures dijkstra dynamic-programming floyd-warshall huffman-coding interview-questions kruskal levenshtein-distance merge-sort network-flow prim quick-sort topological-sort
Last synced: 18 Sep 2025
https://github.com/mahdizynali/earth-map-route-planning
Route planning on Earth map with opencv c++ through Greedy , A-start and etc. algorithm
a-star a-star-algorithm ai artificial-intelligence bfs-algorithm cpp11 dfs-algorithm greedy-algorithm map map-planning opencv4 planning route-planning routes
Last synced: 24 Apr 2025
https://github.com/airstrike/pathfinder
Interactive pathfinding visualization demonstrating optimal path discovery around polygonal obstacles.
a-star iced iced-rs pathfinding pathfinding-visualizer
Last synced: 30 Aug 2025
https://github.com/dkruchinin/spdemo
Shortest path finding algorithms visualized
a-star bfs dijkstra graph-algorithms pygame python visualisation
Last synced: 22 Jun 2025
https://github.com/Miriam-Assraf/Unity3D_NPCs
Given a list of needs for four NPCs keep reaching the optimal state using A* algorithm.
a-star a-star-algorithm csharp npc unity unity3d
Last synced: 25 Apr 2025
https://github.com/fenomas/abstract-pathfinder
Completely agnostic A* pathfinding
Last synced: 31 Oct 2025
https://github.com/zabuzard/pathweaver
PathWeaver is an API for creating path-networks like road- or traffic-networks. It offers method like computing shortest paths.
a-star api arc-flag-algorithm dijkstra-algorithm heuristic-algorithm metrics road-network shortest-path-routing-algorithm shortest-paths traffic-networks web-demo
Last synced: 11 Oct 2025
https://github.com/hxndev/finding-optimal-path-of-map-of-romania-using-a-star
A* is a graph traversal and path search algorithm, which is often used in many fields of computer science due to its completeness, optimality, and optimal efficiency
a-star a-star-algorithm a-star-path-finding code graph map optimal-path python romania shortest-paths
Last synced: 01 Jul 2025
https://github.com/mcnugets/unity-pathfinding-methods
Project provides a basic application of different path searching algorithms like A *, Dijkstra
a-star algorithm algorithms breadth-first-search c-sharp dijkstra-algorithm game-development game-engine pathfinding pathfinding-algorithms unity unity3d unity3d-plugin
Last synced: 27 Apr 2025
https://github.com/suwadith/a-star-shortest-pathfinding-algorithm-square-grid-java
Java based solution to find the shortest path between 2 Grid Cells. [A* Shortest Pathfinding Algorithm]
a-star java shortest-pathfinding-algorithm
Last synced: 06 May 2025
https://github.com/rodneyshag/mazesearch
An optimal maze solver... Pacman style.
a-star heuristics maze-algorithms
Last synced: 11 Apr 2025
https://github.com/drgfreeman/raspibot202v2
A simple differential drive robot project based on Pololu Romi chassis and A-Star 32U4 SV w Raspberry Pi bridge
a-star differential-drive pololu pololu-a-star pololu-romi-chassis raspberry-pi raspberry-pi-bridge robot robotics romi
Last synced: 22 Mar 2025
https://github.com/adamouization/ai-search-flight-route-planner
:airplane: Flight route planning agent using classic AI search algorithms (A*, Best-First, DFS, BFS).
a-star a-star-algorithm artificial-intelligence best-first-search breadth-first-search depth-first-search flight-planning route-planner search search-algorithm
Last synced: 04 Aug 2025
https://github.com/amirreza81/artificial-intelligence
Solutions to practical assignments of Artificial Intelligence course (CE-417) at Sharif University of Technology
a-star a-star-algorithm adversarial-search ai alpha-beta-pruning artificial-intelligence bayesian-networks cryptarithmetic decision-trees deep-learning logistic-regression machine-learning minimax-algorithm pytorch q-learning q-learning-vs-sarsa rainforcement-learning rl simulated-annealing simulated-annealing-algorithm
Last synced: 16 Jun 2025
https://github.com/willigarneau/astar-pathfinding
🗺📌 Implementation of the A* pathfinding algorithm with OpenCV and Cuda in C++ 💪
a-star algorithm axis-camera cuda detection implementation opencv pathfinding
Last synced: 14 Jul 2025
https://github.com/danieldidiobalsamo/maze_generator
Maze generator and solver | C++ / Web Assembly / Vue.js
a-star cpp dijkstra emscripten emscritpen maze-generator vue wasm webassembly
Last synced: 26 Oct 2025
https://github.com/dphilipson/graphs-and-paths
Tools for graphs representing 2-D spatial points and links between them.
a-star graph graph-algorithms shortest-path typescript
Last synced: 10 Apr 2025
https://github.com/notkamui/dungeontest
Procedural Generation in Godot
a-star game godot godot-engine procedural-generation
Last synced: 25 Jun 2025
https://github.com/we-gold/algernon-js
Algernon is a JS library for efficiently generating, solving, and rendering mazes.
a-star ant-colony-optimization bfs canvas d-star-lite dfs javascript maze maze-algorithms maze-generator maze-solver occupancy-grid-map p5js serialization
Last synced: 23 Apr 2025
https://github.com/sergiss/a-star
:mag_right: A* search algorithm written in Javascript
Last synced: 26 Mar 2025
https://github.com/kim366/pathplanning
Various Pathplanning Algorithms Derived off Dijkstra's in mulitple situations visualized by SFML. Paper: https://schmider.kim/vwa/main.pdf
a-star cmake cpp17 d-star dijkstra-shortest-path path-planning pathfinding pathplanning sfml sfml-graphics-library
Last synced: 22 Mar 2025
https://github.com/rvhuang/heuristic-suite
The generic implementation of heuristic algorithms in C#
a-star algorithm generic-programming heuristic-algorithm net netcore
Last synced: 28 Jul 2025
https://github.com/mohammadrezaamani/pacman
Pacman Solver is an advanced implementation of the classic Pacman game, featuring a fast solver utilizing the Minimax algorithm, Alpha-Beta pruning, and A* heuristic.
a-star ai alpha-beta-pruning minimax python
Last synced: 03 Mar 2025
https://github.com/demonstrandum/a-star
A* path finding algorithm for images, in Ruby.
a-star algorithm chunky-png image labyrinth linux macos maze maze-solver pathfinding pixel png ruby unix windows
Last synced: 07 Apr 2025
https://github.com/tynab/animal-chess
Animal Chess
a-star a-star-algorithm animal-chess bfs bfs-algorithm board-game breadth-first-search breadth-first-search-algorithm chess chess-game cnn deep-learning game keras numpy pandas scikit-learn search-algorithm sklearn tensorflow
Last synced: 16 Oct 2025
https://github.com/martin-t/sokoban-solver
A toy Sokoban solver that draws graphs of the searched state space - mirror of https://gitlab.com/martin-t/sokoban-solver
a-star rust search-algorithm sokoban
Last synced: 29 Oct 2025
https://github.com/dev-michael-schmidt/ai-rubik-cube
Sovle a rubik's cube using an A* algorithm
a-star python3 rubiks-cube-scrambler rubiks-cube-solver
Last synced: 04 Mar 2025
https://github.com/nikhilcodes/pathfinder-algovisual
Program to visually simulate the working of Path Finding Algorithms (i.e. Dijkstra and A*)
Last synced: 04 Apr 2025
https://github.com/hamidb80/maze-vis
A* BFS DFS visualization
a-star bfs dfs karax nim path-finding-algorithms path-finding-visualizer spa web web-app
Last synced: 07 Oct 2025
https://github.com/hxndev/solving-a-maze-using-gbfs-and-a-star
In this, we solved a maze using both Greedy Best First Search Algortihm and A* Algorithm
a-star a-star-algorithm a-star-path-finding a-star-search code gbfs gbfs-algorithm greedy-best-first-search maze maze-solver python
Last synced: 16 Jun 2025
https://github.com/piflyer/bluefish3-open-sourced
A science project that models the foot traffic of Boston Latin School using A*. Now open-sourced and ready to be used for any campus with a rotating schedule.
a-star a-star-algorithm a-star-path-finding congestion-control machine-learning-algorithms python3 science-fair traffic traffic-modelling traffic-simulation
Last synced: 27 Jul 2025
https://github.com/reala10n/car-pathfinding-problem
פרויקט חמש יחידות הבגרות שלי במדעי המחשב, כחלק מתוכנית אלפא בטכניון
a-star a-star-algorithm algorithm car dijkstra-algorithm pathfinding pathfinding-algorithm prm probabilistic-road-map rrt
Last synced: 13 Jun 2025
https://github.com/sameetasadullah/graph-based-a-star-in-python
Python program to implement graph based A* algorithm on a map of Romania
a-star a-star-algorithm a-star-path-finding a-star-search artificial-intelligence pycharm pycharm-ide python python3
Last synced: 06 Apr 2025
https://github.com/a----/sigma-pathfinding-astar
An A* implementation for Sigma.js
a-star javascript pathfinding sigma
Last synced: 21 Jun 2025
https://github.com/jiaweihu08/visualize-pathing-and-maze-generation-algorithms
Visualizing Path Finding Algorithms with Pygame!
a-star dfs dijkstra-algorithm recursive-division
Last synced: 14 Aug 2025
https://github.com/hrshtpurohit/8-puzzle-solver
Optimised 8-puzzle solver using BFS, DFS, and A* Algorithms
8-puzzle a-star bfs dfs search-paths
Last synced: 02 Jul 2025
https://github.com/rand-asswad/taquin
15-puzzle a-star graph-search-algorithms iterative-deepening-search prolog swi-prolog
Last synced: 25 Feb 2025
https://github.com/coac/gempuzzle
:gem: Gem Puzzle, 15-puzzle, Boss Puzzle, Game of Fifteen, Mystic Square
15puzzle a-star boss-puzzle breadth-first-search depth-first-search mystic-square tree-search
Last synced: 09 Sep 2025
https://github.com/jasonw4331/ext-pathfinding
A PHP extension which binds the following library:
a-star bfs dijkstra pathfinding theta-star
Last synced: 12 Oct 2025
https://github.com/adeelh/block_a_star
Python implementation of Block A* search (class project, Robotics, Spring 2019)
a-star a-star-algorithm algorithms block-a-star python robotics search-algorithm
Last synced: 13 Oct 2025
https://github.com/teixdavide/FEUP_IA_Cogito
🐦 | Cogito retro game clone featuring Search Problem algorithm implementations
a-star ai artificial-intelligence cogito feup game greedy-search ia iart retro-game search-algorithm
Last synced: 05 Jan 2026
https://github.com/sourhub226/a-star-algo-visualizer-python
A visual representation of A* path finding algorithm made in python
a-star algorithm artificial-intelligence astar astar-algorithm gui pathfinding pygame python python-pygame visualization
Last synced: 05 Mar 2025
https://github.com/yakuza8/sliding-block-puzzle
Sliding Block Puzzle with A* Search
a-star a-star-algorithm a-star-search sliding-block-puzzle sliding-puzzle-game
Last synced: 22 Mar 2025
https://github.com/sksuryan/astar
This is visualization of A-Star Algorithm with the help of Binary Search Trees.
a-star a-star-algorithm a-star-path-finding a-star-search binary-search-tree javascript p5js
Last synced: 04 Apr 2025
https://github.com/timofurrer/hslu-aiso
HSLU AISO Class Exercises
a-star aiso bfs constraint-programming dfs exercises graph graph-problem hslu search-optimization
Last synced: 04 Apr 2025
https://github.com/sameetasadullah/maze-solver-using-a-star
Implemented Maze Solver using A-Star (A*) in Python Language
a-star a-star-algorithm a-star-path-finding a-star-search artificial-intelligence maze-solver pycharm pycharm-ide python python3
Last synced: 20 Feb 2025
https://github.com/jdleung/jdastar
A simple path finding library based on the A*(A-Star) algorithm.
a-star algorithm astar ios macos pathfinding swift
Last synced: 23 Oct 2025
https://github.com/shashwatkathuria/artificial-intelligence-search-algorithms
Implemented AI Search Algorithms - BFS, DFS, UCS, A* and some heuristics and state spaces.
a-star a-star-search artificial-intelligence bfs breadth-first-search depth-first-search dfs heuristics pacman python searching-algorithms ucs uniform-cost-search
Last synced: 21 Mar 2025
https://github.com/marceline-tavernier/path-finding
Artificial intelligence in games #2 : Path finding
a-star a-star-algorithm a-star-path-finding ai-in-games marceline-tavernier path-finding pathfinding processing
Last synced: 29 Mar 2025
https://github.com/d0x2f/libtaquinsolve
C++ library for solving taquin picture puzzles
15puzzle a-star heuristic-search iterative-deepening-a-star taquin
Last synced: 08 Apr 2025
https://github.com/matteogreek/a-star-parallel
Repository concerning the implementation of the A-star parallel algorithm developed for the High Performance Computing course at the Master's degree in Computer Science at University of Trento
a-star mpi-library parallel-computing
Last synced: 23 Feb 2025
https://github.com/dev-michael-schmidt/ai-sliding-puzzle
Solve an NxN sliding puzzle problem using the A* algorithm
a-star artifical-intelligense sliding-puzzle-game
Last synced: 06 Sep 2025
https://github.com/ranimeshehata/8-puzzle-ai-agent
This repository contains an 8-Puzzle AI Solver implemented using various search algorithms including Depth-First Search (DFS), Breadth-First Search (BFS), Iterative Deepening Depth-First Search (IDFS), and A* Search. The project also includes a graphical user interface (GUI) built with PyQt5 to visualize the puzzle and the solution steps..
a-star ai-agent bfs dfs gui idfs pyqt5 python3 searching-algorithms
Last synced: 03 Apr 2025
https://github.com/sohnryang/16-puzzle-solver
A 16-puzzle solver with graph search algorithms
15-puzzle 16-puzzle a-star bfs graph-algorithms hana-academy-seoul math-homework python3
Last synced: 25 Dec 2025
https://github.com/zacharyweiss/me570-hw5
Visibility roadmaps and A* planning in polygonal worlds
Last synced: 11 Dec 2025
https://github.com/tryomar/ai-search-algorithms
A comprehensive collection of AI algorithms including search algorithms, machine learning implementations, and game AI solutions in Python. Features informed/uninformed search, Naive Bayes, object detection, and classic game implementations.
a-star artificial-intelligence bfs dfs dijkstra game-ai machine-learning minimax naive-bayes python search-algorithms
Last synced: 28 Oct 2025
https://github.com/mirzaim/card-game-ai-agent
AI agent that solves a card sorting game using search algorithms like BFS, IDS, and A-Star.
a-star bfs card-game ids ids-algorithm
Last synced: 08 Oct 2025
https://github.com/nathancordeiro/a-star-visualizer
This project is a visualizer for the A* pathfinding algorithm implemented using Python and PyQt5.
a-star a-star-algorithm graphtheory pathfinding pyqt5 python visualization
Last synced: 08 Oct 2025
https://github.com/klima7/tsp-common-algs
Comparison of common algorithms for solving Traveling Salesman Problem.
a-star bfs dfs nearest-insertion nearest-neighbor traveling-salesman tsp
Last synced: 11 Oct 2025
https://github.com/jayexdesigns/a-star-visualizer
A visualizer for the popular A* algorithm
a-star algorithm pathfinding visualizer
Last synced: 04 May 2025