Topic: "a-star-algorithm"
honzaap/Pathfinding
Pathfinding on a real map anywhere in the world
Language: JavaScript - Size: 14.8 MB - Last synced at: 28 days ago - Pushed at: over 1 year ago - Stars: 368 - Forks: 38

brunomikoski/Simple-optimized-A-Pathfinder
An simple and optimized grid pathfinding
Language: C# - Size: 32.8 MB - Last synced at: 21 days ago - Pushed at: over 2 years ago - Stars: 254 - Forks: 40

pgeerkens/HexGridUtilitiesForGames
Hex-grid utilities for board and strategy games with path-finding, field-of-view, and more
Language: C# - Size: 29.7 MB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 125 - Forks: 30

seung-lab/dijkstra3d
Dijkstra's Shortest Path for 6, 18, and 26-Connected 3D (Volumetric) Image Volumes
Language: C++ - Size: 2.53 MB - Last synced at: about 1 month ago - Pushed at: 5 months ago - Stars: 80 - Forks: 14

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# - Size: 1.18 MB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 75 - Forks: 14

matthiaszarzecki/AStarPathfindingUnity
Implementation of the A*-Algorithm in Unity3D
Language: C# - Size: 12.2 MB - Last synced at: 8 days ago - Pushed at: 10 days ago - Stars: 46 - Forks: 18

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 Notebook - Size: 64.8 MB - Last synced at: about 1 year ago - Pushed at: over 3 years ago - Stars: 39 - Forks: 10

gsurma/sliding_puzzle
Swift implementation of the Sliding Puzzle game with Iterative Deepening A* AI Solver.
Language: Swift - Size: 4.05 MB - Last synced at: 2 days ago - Pushed at: almost 4 years ago - Stars: 37 - Forks: 14

syntnc/Artificial-Intelligence
IIIT Allahabad B. Tech. (IT) 5th Semester Artificial Intelligence Lab Assignments + HackerRank Artificial Intelligence Track
Language: Python - Size: 112 KB - Last synced at: about 1 year ago - Pushed at: almost 7 years ago - Stars: 32 - Forks: 25

darienmt/FCND-Term1-P2-3D-Motion-Planning
Udacity Flying Car Nanodegree - Term 1 - Project 2 - 3D Motion Planning
Language: Jupyter Notebook - Size: 479 MB - Last synced at: 3 months ago - Pushed at: over 6 years ago - Stars: 29 - Forks: 17

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: Python - Size: 2.29 MB - Last synced at: about 2 months ago - Pushed at: 4 months ago - Stars: 28 - Forks: 3

PrudhviGNV/pathFinderVisualizer
A react Application Used to visualize classical path finding algorithms like BFS, DFS, Dikstra's, A-star
Language: JavaScript - Size: 354 KB - Last synced at: over 2 years ago - Pushed at: over 2 years ago - Stars: 26 - Forks: 9

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: Java - Size: 31.8 MB - Last synced at: over 1 year ago - Pushed at: over 7 years ago - Stars: 26 - Forks: 15

eamontoyaa/pyBIMstab
Application software in Python 3 to evaluate the factor of safety against sliding of slopes made of Blocks-In-Matrix materials.
Language: Python - Size: 921 KB - Last synced at: 17 days ago - Pushed at: over 2 years ago - Stars: 25 - Forks: 10

shushrutsharma/18CSC305J-AI
All Lab experiments of 18CSC305J Artificial Intelligence.
Language: Jupyter Notebook - Size: 15.9 MB - Last synced at: over 2 years ago - Pushed at: about 4 years ago - Stars: 24 - Forks: 35

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: Python - Size: 8.79 KB - Last synced at: 2 months ago - Pushed at: 4 months ago - Stars: 23 - Forks: 3

gmac/constellation-js
A grid geometry toolkit for A* pathfinding and 2D sprite motion.
Language: JavaScript - Size: 1.28 MB - Last synced at: 5 days ago - Pushed at: over 2 years ago - Stars: 22 - Forks: 5

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: Rust - Size: 113 KB - Last synced at: about 2 months ago - Pushed at: over 2 years ago - Stars: 21 - Forks: 1

KTS-o7/AIML-Lab
Contains 5th Semester AIML Lab programs
Language: Python - Size: 127 KB - Last synced at: 2 months ago - Pushed at: about 1 year ago - Stars: 20 - Forks: 6

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: ShaderLab - Size: 1.57 MB - Last synced at: about 2 months ago - Pushed at: over 1 year ago - Stars: 20 - Forks: 9

spood/PCGPathfinding
An A* pathfinding implementation with PCG (Procedural Content Generation) to generate custom splines in unreal engine between two points
Language: C++ - Size: 42.6 MB - Last synced at: about 1 year ago - Pushed at: almost 2 years ago - Stars: 19 - Forks: 2

gabrieldrn/Java-Maze-Solver
Maze solving in java with BFS, DFS, A*
Language: Java - Size: 153 KB - Last synced at: 5 days ago - Pushed at: over 6 years ago - Stars: 19 - Forks: 6

GurkNathe/Pathfinding-Algorithms
A Python implementation and visualization of various pathfinding and graph search algorithms.
Language: Python - Size: 63.9 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 18 - Forks: 3

LaurentVeyssier/Route-planner-algorithm
Find the shortest route using A* algorithm and graphs (Route Planner application)
Language: Jupyter Notebook - Size: 288 KB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 18 - Forks: 1

YahyaAlaaMassoud/Sliding-Puzzle-A-Star-Solver
Implementation for A-star and BFS Algorithms to solve a NxN grid sliding puzzle problem.
Language: Python - Size: 120 KB - Last synced at: over 2 years ago - Pushed at: over 7 years ago - Stars: 18 - Forks: 9

C-Collamar/8-Puzzle-Solver
A BFS and A* implementation to the classic 8-puzzle problem
Language: C - Size: 426 KB - Last synced at: over 1 year ago - Pushed at: about 7 years ago - Stars: 17 - Forks: 7

arnav-t/Shooting-Game
Basic Shooting Game in C++ and OpenCV
Language: C++ - Size: 977 KB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 16 - Forks: 26

bengsfort/8-puzzle-solutions
Solutions to the classic 8 puzzle, implementing an A* best search algorithm to complete the puzzle in multiple languages.
Language: JavaScript - Size: 104 KB - Last synced at: 2 months ago - Pushed at: over 6 years ago - Stars: 16 - Forks: 6

etopuz/The-Prophecy
Top-Down Roguelite Game
Language: C# - Size: 5.74 MB - Last synced at: about 1 month ago - Pushed at: almost 3 years ago - Stars: 15 - Forks: 4

alwaysbyx/Optimization-and-Search
Implementation and visualization (some demos) of search and optimization algorithms.
Language: Python - Size: 79.1 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 15 - Forks: 2

CodeAltus/Snake-AI
Using the A* pathfinding algorithm to play the classic snake game perfectly
Language: JavaScript - Size: 6.84 KB - Last synced at: 5 days ago - Pushed at: about 4 years ago - Stars: 15 - Forks: 1

malkfilipp/maze-runner
Maze Runner is a maze generation and solving tool using the randomized Kruskal's algorithm and the A* algorithm
Language: Java - Size: 4.95 MB - Last synced at: about 1 month ago - Pushed at: almost 6 years ago - Stars: 15 - Forks: 7

hamed-rezaee/flutter_maze_generator
A maze generator written in Dart and Flutter.
Language: C++ - Size: 649 KB - Last synced at: 3 months ago - Pushed at: about 1 year ago - Stars: 14 - Forks: 1

cabustillo13/Ayuda-a-vendedores-ambulantes
Ayudar a vendedores ambulantes en un parque para llegar a sus clientes, recorriendo la menor distancia con el Algoritmo A*.
Language: Python - Size: 10.2 MB - Last synced at: over 2 years ago - Pushed at: almost 5 years ago - Stars: 14 - Forks: 3

WhizK1D/ros-a-star-vfh
Implement a navigational robot that performs global planning using A* and local planning using Vector Field Histogram (VFH) to help navigate the robot from start to end for a given map.
Language: Python - Size: 28.3 KB - Last synced at: 26 days ago - Pushed at: over 5 years ago - Stars: 14 - Forks: 2

jannomeister/pathfinder
A project for showing different kinds of pathfinding algorithms
Language: JavaScript - Size: 525 KB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 13 - Forks: 0

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++ - Size: 24.6 MB - Last synced at: 9 days ago - Pushed at: 9 days ago - Stars: 12 - Forks: 2

sondosaabed/Palestine-Cities-Map
Find shortest paths between Palestinian cities using A* or Greedy BFS algorithms. Note: Heuristic values may not be accurate for the showcased 15 cities. 🇵🇸
Language: Java - Size: 992 KB - Last synced at: 2 months ago - Pushed at: over 1 year ago - Stars: 12 - Forks: 0

salimt/GoogleMaps-Find-Fastest-Route-Algorithms
A simple fastest route finder written in Java includes BFS, Djikstra(Speed limits included) and A* Algortihms also has the feature of visualization of visited nodes.
Language: Java - Size: 809 KB - Last synced at: about 1 year ago - Pushed at: about 6 years ago - Stars: 12 - Forks: 9

mcnugets/ue5-pathfinding-implementation
The pathfinding implementation in the Unreal Engine 5
Language: C++ - Size: 119 MB - Last synced at: 2 months ago - Pushed at: over 1 year ago - Stars: 10 - Forks: 2

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: Python - Size: 66.2 MB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 10 - Forks: 0

rizanw/Romania-A-star-Algorithm
Romania Problem with A* Algorithm - AI Class Homework
Language: Python - Size: 9.77 KB - Last synced at: 2 months ago - Pushed at: almost 6 years ago - Stars: 10 - Forks: 8

nicholasRenninger/AStar_and_PRM_Planning_Analysis
Implementation of the A* / Dijkstra search algorithms, a Probabilistic Roadmap (PRM) Planner with path smoothing, and a statistical benchmarking suite
Language: Python - Size: 55.8 MB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 9 - Forks: 0

mahdizynali/Earth-Map-Route-Planning
Route planning on Earth map with opencv c++ through Greedy , A-start and etc. algorithm
Language: C++ - Size: 1.12 MB - Last synced at: 2 months ago - Pushed at: 10 months ago - Stars: 8 - Forks: 1

nkuwenjian/grid_path_planner
A global planner plugin of a grid-based A-star search algorithm for ROS navigation stack.
Language: C++ - Size: 108 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 8 - Forks: 4

hanmmmmm/robot-path-planning
This is a collection of my implementation of robotic 2D path planning algorithms.
Language: C++ - Size: 254 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 8 - Forks: 1

Moataz-Elmesmary/SLAM-Robotics
technological mapping method that allows robots and other autonomous vehicles to build a map , localize itself on that map at the same time and choose the best route avoiding obstacles.
Language: Python - Size: 1.62 MB - Last synced at: about 1 month ago - Pushed at: over 1 year ago - Stars: 8 - Forks: 0

loveCiForever/a_star_with_genetic_algorithm 📦
This is a MidTerm project solving 3 task: 8-Puzzle by A*, Pacman by A* and 16-Queens by Genetic Algorithm
Language: Jupyter Notebook - Size: 26.2 MB - Last synced at: 4 days ago - Pushed at: 4 days ago - Stars: 7 - Forks: 0

hugopallard/A-Star
A* Algorithm with a scalable GUI, "GPS" Find the shortest between X given Nodes, in order, like google maps steps
Language: Java - Size: 161 KB - Last synced at: about 2 years ago - Pushed at: over 3 years ago - Stars: 7 - Forks: 1

Miriam-Assraf/Unity3D_NPCs
Given a list of needs for four NPCs keep reaching the optimal state using A* algorithm.
Language: C# - Size: 1.52 GB - Last synced at: about 2 months ago - Pushed at: over 4 years ago - Stars: 7 - Forks: 3

MarAl15/TSI-PathPlanning
Implementation of the A* and Jump Point Search (JPS) algorithms
Language: C++ - Size: 3.96 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 7 - Forks: 1

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: Python - Size: 1.43 MB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 7 - Forks: 5

nikhilhenry/astar.rs
A* Pathfinding Visualisation in Rust
Language: Rust - Size: 1.34 MB - Last synced at: about 1 year ago - Pushed at: over 1 year ago - Stars: 6 - Forks: 1

AI-14/nqueens-astar-genetic-algorithm
N-Queens GUI solver using A* (A-Star) and Genetic Algorithm.
Language: Python - Size: 1.71 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 6 - Forks: 1

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
Language: Python - Size: 9.77 KB - Last synced at: about 2 months ago - Pushed at: almost 4 years ago - Stars: 6 - Forks: 1

sManohar201/SLAM-Claus-Brenner-Youtube
This repository contains solution for SLAM lectures taught by Claus Brenner on YouTube.
Language: Python - Size: 1.61 MB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 6 - Forks: 0

joaomota59/jogoDosOito
🕹 Algoritmo que resolve o jogo dos oito por busca em profundidade(sem estados visitados), busca em largura(com estados visitados), busca gulosa(com estados visitados) e busca a*(com estados visitados). Podendo mostrar passo a passo das escolhas dos nós e mostrando a árvore resultante(até um certo limite ou completa) do método de busca selecionado.
Language: Python - Size: 19.5 KB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 6 - Forks: 3

diegoavillegasg/a-star-route-planner
A Route Planner based on A* search algorithm implemented in C++ to find the best route in a given OpenStreetMap
Language: C++ - Size: 5.27 MB - Last synced at: about 2 years ago - Pushed at: about 5 years ago - Stars: 6 - Forks: 2

rasti37/A-Star-and-BFS-Searching-Visualization
Searching Visualization in a Graph using A* and BFS Algorithms. Imported GraphStream library for the GUI.
Language: Java - Size: 11.2 MB - Last synced at: 3 months ago - Pushed at: over 6 years ago - Stars: 6 - Forks: 1

psprawka/Mappy Fork of tle-huu/mappy
Explore and solve traffic problem via implementing a simulator for autonomous vehicles 🚙
Language: C - Size: 31 MB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 6 - Forks: 0

Kevin-QAQ/IntelligentSearch
Using breadth-first-search, depth-first-search, A* algorithm to solve 8-puzzle-problem and missionaries-cannibals-problem
Language: C - Size: 236 KB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 5 - Forks: 5

WaqarGhoto/A-Star-Route-Planing-Algorithm
Implementation of A Star algorithm to find the shortest path for ambulances. It's implementation is done in java Netbeans.
Size: 99.6 KB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 5 - Forks: 0

imadtoubal/Infinit-Pacman-with-JavaScript
Infinit Pacman with JavaScript. Using multiple path-finding algorithms: A*, Greedy Best First Search, and Hill Climbing Search
Language: JavaScript - Size: 175 KB - Last synced at: almost 2 years ago - Pushed at: almost 5 years ago - Stars: 5 - Forks: 1

Adamouization/AI-Search-Flight-Route-Planner
:airplane: Flight route planning agent using classic AI search algorithms (A*, Best-First, DFS, BFS).
Language: Java - Size: 2.2 MB - Last synced at: 2 months ago - Pushed at: over 5 years ago - Stars: 5 - Forks: 1

AmrSaber/8-Puzzle-Game-Solver-With-GUI 📦
Language: Java - Size: 30.3 KB - Last synced at: over 2 years ago - Pushed at: about 8 years ago - Stars: 5 - Forks: 3

w9PcJLyb/w9-pathfinding
Implementation of some pathfinding and multi-agent pathfinding algorithms
Language: C++ - Size: 8.1 MB - Last synced at: 4 days ago - Pushed at: 4 days ago - Stars: 4 - Forks: 0

FaisalAhmed21/CSE422-Artificial-Intelligence
Language: Jupyter Notebook - Size: 16.2 MB - Last synced at: 3 months ago - Pushed at: 7 months ago - Stars: 4 - Forks: 0

Amirreza81/Artificial-Intelligence
Solutions to practical assignments of Artificial Intelligence course (CE-417) at Sharif University of Technology
Language: Jupyter Notebook - Size: 25 MB - Last synced at: 7 days ago - Pushed at: 8 months ago - Stars: 4 - Forks: 1

HaleemaJamil/Rescue-1122-Route-Planner-using-A-star-algorithm
Rescue 1122 Route Planner is a Artificial Intelligence project which implements the A-star algorithm using Python and the simulation is done using Pygame.
Language: Python - Size: 3.39 MB - Last synced at: about 1 year ago - Pushed at: over 1 year ago - Stars: 4 - Forks: 0

akshayrb22/Conquest_IITKGP_2017
This project allows an Arduino driven bot to traverse a given area which has resource points and obstacles. The camera is positioned overhead.
Language: Python - Size: 9.07 MB - Last synced at: over 2 years ago - Pushed at: over 2 years ago - Stars: 4 - Forks: 4

MatinHosseinianFard/AI-projects
Artificial intelligence course projects
Language: Python - Size: 116 KB - Last synced at: 4 months ago - Pushed at: over 2 years ago - Stars: 4 - Forks: 0

qualuo/dijkstras-algorithm
Unity pathfinding visualization with web app demo. Can be used for educational purpose.
Language: C# - Size: 49.5 MB - Last synced at: 6 months ago - Pushed at: over 2 years ago - Stars: 4 - Forks: 1

urastogi885/optimal-path-finder
Explore a map to find an optimal path from start to goal using classical search-based methods
Language: Python - Size: 1.06 MB - Last synced at: almost 2 years ago - Pushed at: about 3 years ago - Stars: 4 - Forks: 2

mahmoud-drwsh/Mazes-Generator-And-Solver
A maze generator program and a solver agent implemented in python by Mahmoud Darwish (محمود درويش)
Language: Python - Size: 45.9 KB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 4 - Forks: 1

Elzawawy/risky
RISKY is a simple abstract version of the classic strategy Game (RISK), provided with a an easy to use web-based GUI.
Language: Python - Size: 4.8 MB - Last synced at: over 1 year ago - Pushed at: almost 5 years ago - Stars: 4 - Forks: 2

Elzawawy/eight-puzzle-solver
An 8-puzzle game solver implementation in Python, uses informed and uninformed search algorithms and is extensible to be used on an N-Puzzle game.
Language: Python - Size: 45.9 KB - Last synced at: over 1 year ago - Pushed at: almost 5 years ago - Stars: 4 - Forks: 1

AhmedNasr7/Route-Planning-Project
C++ implementation of A* Search Algorithm for finding the shortest path between two nodes on OpenStreetMap data.
Language: C++ - Size: 5.12 MB - Last synced at: over 2 years ago - Pushed at: about 5 years ago - Stars: 4 - Forks: 0

cocolico14/8Puzzle
solving 8 Puzzle with A*, Recursive Best First Search and BFS
Language: Java - Size: 588 KB - Last synced at: about 2 years ago - Pushed at: over 5 years ago - Stars: 4 - Forks: 1

PanosAntoniadis/AI-ntua
Lab exercise of Artificial Intelligence course in NTUA
Language: Java - Size: 1.99 MB - Last synced at: 5 months ago - Pushed at: over 6 years ago - Stars: 4 - Forks: 0

nishantHolla/a-star-visualizer
Visualizer for A* algorithm in c using raylib
Language: C - Size: 16.9 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 3 - Forks: 0

Tynab/Animal-Chess
Animal Chess
Language: Python - Size: 15.8 MB - Last synced at: 5 days ago - Pushed at: 5 months ago - Stars: 3 - Forks: 0

Gyakobo/Pathfinding-Algorithms
This project implements and compares various pathfinding algorithms, including A*, BFS, DFS, and Dijkstra, to find the shortest path on a 2D grid with obstacles.
Language: Python - Size: 66.4 KB - Last synced at: 3 months ago - Pushed at: 6 months ago - Stars: 3 - Forks: 0

mtrevisan/MapMatcher
Matches a sequence of GPS coordinates to road graph
Language: Java - Size: 42.5 MB - Last synced at: 7 months ago - Pushed at: 7 months ago - Stars: 3 - Forks: 0

luisalejandrobf/Prolog_BestFirst-A-Algorithm-BreadthFirstSearch
Implementation of the Best First/A* Algorithm and Breadth-first Search Algorithm for room and box manipulation. Efficient algorithms for solving room and box manipulation problems. Instructions are available in English and Spanish.
Language: Prolog - Size: 568 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 3 - Forks: 0

yousefkotp/8-Puzzle-Solver
8 Puzzle solver using uninformed and informed search algorithms as DFS, BFS and A*.
Language: Python - Size: 124 KB - Last synced at: over 2 years ago - Pushed at: over 2 years ago - Stars: 3 - Forks: 2

claud32/Rush-Hour-Puzzle-Solver
An AI Solver for Puzzle "Rush Hour"
Language: Python - Size: 6.84 KB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 3 - Forks: 0

ThanosM97/Artificial_Intelligence-NTUA
Implementation of a navigation system for a taxi company using A star algorithm for the course Artificial Intelligence of NTUA.
Language: Java - Size: 3.58 MB - Last synced at: about 1 year ago - Pushed at: over 3 years ago - Stars: 3 - Forks: 0

m3y54m/a-star-algorithm-in-c
A* Algorithm Implementation in C
Language: C - Size: 402 KB - Last synced at: 3 months ago - Pushed at: over 3 years ago - Stars: 3 - Forks: 0

abedinsherifi/ANA-Star
Anytime Nonparametric A* (ANA-Star) algorithm and comparison to BFS.
Language: Python - Size: 1.21 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 3 - Forks: 0

KabukiStarship/iGeek
An AI gym for building, measuring, and learning agents in massively parallel fuzzed environments using the Chinese Room Abstract Stack (Crabs) machine, ASCII Data Types, and Script2.
Language: C++ - Size: 2.68 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 3 - Forks: 0

ArjunBalamwar/PathFinder
A pathfinding visualizing project using Pygame that uses A* and other pathfinding algorithms. Along with that, there are various maze generation algorithms
Language: Jupyter Notebook - Size: 94.7 KB - Last synced at: over 1 year ago - Pushed at: about 4 years ago - Stars: 3 - Forks: 1

ap-atul/8-Puzzle
8 Puzzle problem solution with A* algorithm, BFS, and DFS.
Language: Python - Size: 25.4 KB - Last synced at: 3 months ago - Pushed at: over 4 years ago - Stars: 3 - Forks: 1

MartinLesser/Pathfinding-comparison
This project implements the dijkstra, A* and D* Lite algorithms and compares them.
Language: Python - Size: 181 KB - Last synced at: almost 2 years ago - Pushed at: almost 5 years ago - Stars: 3 - Forks: 1

fzehracetin/A-Star-and-Best-First-Search
This is the implementation of A* and Best First Search Algorithms in python language. The project comprimise two data structures: stack and heap.
Language: Python - Size: 919 KB - Last synced at: over 1 year ago - Pushed at: about 5 years ago - Stars: 3 - Forks: 0

takilevi/MSc-traffic-simulation
Language: C# - Size: 80.8 MB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 3 - Forks: 1

kejriwalrahul/A-Star-Visualization
Visualization of A* Search, Greedy BFS and Djikstra Search execution
Language: Python - Size: 413 KB - Last synced at: about 1 month ago - Pushed at: over 7 years ago - Stars: 3 - Forks: 0

chen0040/cpp-steering-behaviors
OpenGL Demo for Game Agent Steering + Flocking + Swarm Behaviors
Language: C - Size: 10.9 MB - Last synced at: 16 days ago - Pushed at: almost 8 years ago - Stars: 3 - Forks: 1

jmartinpizarro/eve-astar
A-Star Algorithm in C++ for optimising trips in EVE Online
Language: C++ - Size: 1.08 MB - Last synced at: 17 days ago - Pushed at: 2 months ago - Stars: 2 - Forks: 0

marceline-tavernier/path-finding
Artificial intelligence in games #2 : Path finding
Language: Processing - Size: 854 KB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 2 - Forks: 0

vtarale/Search
a star search, greedy best search and bfs and dfs lib
Language: Python - Size: 15.6 KB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 2 - Forks: 0
