GitHub topics: a-star-algorithm
hamed-rezaee/flutter_maze_generator
A maze generator written in Dart and Flutter.
Language: C++ - Size: 649 KB - Last synced at: about 2 months ago - Pushed at: 12 months ago - Stars: 14 - Forks: 1

MohamedAIsmail/Sliding-Puzzle-Game
Sliding Puzzle Game with A-Star Fast Solving Algorithm
Language: JavaScript - Size: 271 KB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 0 - Forks: 1

ant-louis/pacman-agent Fork of tcrasset/Pacman
👻 Implementation of intelligent agents for the Pacman game.
Language: Python - Size: 1.65 MB - Last synced at: 7 months ago - Pushed at: about 5 years ago - Stars: 2 - Forks: 3

krichelj/AI_BGU_2021
Artificial Intelligence course, Computer Science M.Sc., Ben Gurion University of the Negev, 2021
Language: Python - Size: 463 KB - Last synced at: 3 months ago - Pushed at: over 2 years ago - Stars: 1 - 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: about 2 months ago - Pushed at: over 4 years ago - Stars: 3 - Forks: 1

george10hany77/Path_Finding_Turtlesim
Implementation for the path finding algorithm using A*.
Language: Python - Size: 5.86 KB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 0 - 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

tbtiberiu/SlidingPuzzleSolver
The SlidingPuzzleSolver is a C++ project that solves sliding puzzles, such as the classic 3x3 and 4x4 puzzle, using the A* search algorithm.
Language: C++ - Size: 13.7 KB - Last synced at: 3 months ago - Pushed at: 10 months ago - Stars: 0 - Forks: 0

rvnandwani/ENPM661-P5_Easy-Shopper-i.e.-Path-Planning-for-Shopping-Robot
This project represents a novel method to calculate the path. It is a combination of A* and dynamic A* which is implemented on the common task of the shopping cart. Please review the PDF for more info.
Language: Python - Size: 416 KB - Last synced at: 10 months ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 0

rvnandwani/ENPM661-P3-Implementation-of-A-star-algorithm-on-Turtlebot
This project involves navigating a differential drive robot (TurtleBot 2) in a virtual environment from a given start point to a given goal point, with simulation carried out on V-REP
Language: Python - Size: 9.15 MB - Last synced at: 10 months ago - Pushed at: almost 3 years ago - Stars: 1 - Forks: 0

zainsiddiqui/AI-Maze-Runner
This program explores various Artificial Intelligence pathfinding algorithms, both in the traditional application of path planning, and more abstractly in the construction and design of complex objects. The program generates a maze of a given density and runs an pathfinding algorithm on the maze.
Language: Python - Size: 2.34 MB - Last synced at: 10 months ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 1

Redtius/PathFinder
👾🛣️Explore Optimal Paths with Vanilla JavaScript's A* Algorithm.
Language: JavaScript - Size: 240 KB - Last synced at: 3 months ago - Pushed at: 10 months ago - Stars: 1 - Forks: 0

RobinMeneust/CY-Path
The Quoridor game in java
Language: Java - Size: 178 MB - Last synced at: 10 months ago - Pushed at: about 2 years ago - Stars: 2 - Forks: 0

basaris/8-puzzle
Algorithm that solves the classic 8-puzzle game with the use of Uniform Cost Search Algorithm (UCS) and A-star(A*) method in both Python and Java.
Language: Java - Size: 15.6 KB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 0 - Forks: 0

ADolbyB/ai-search-methods
AI Search methods from CAP 4630: Intro to AI
Language: Jupyter Notebook - Size: 506 KB - Last synced at: 3 months ago - Pushed at: about 2 years ago - Stars: 1 - Forks: 0

hanadiasfour/SearchAlgorithms
Implementation of Greedy, Uniform Cost Search (UCS), and A* Search algorithms to find seating arrangements with minimal conflict.
Language: Java - Size: 221 KB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

vazConnected/cefet-ai-a_star-path-finder 📦
Aplicação do algoritmo A* (A-estrela) para a obtenção de um caminho ótimo.
Language: Python - Size: 5.86 KB - Last synced at: 11 months ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

ADNANE-RBT/metaheuristics
This project implements two nature-inspired optimization algorithms: Moth Flame Optimization (MFO) and Honey Badger Optimization (HBO). Both algorithms are designed to solve complex optimization problems by mimicking behaviors observed in nature. also it includes a path finding algorithm, A-star
Language: Python - Size: 10.8 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

thesahirahmed/A_Star_Ai-Game
In this game, you control a jet trying to avoid enemy missiles using arrow keys. The enemies intelligently pursue your jet using A* pathfinding, making it challenging to evade them. Dodge the missiles for as long as possible to survive!
Language: Python - Size: 416 KB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

KMilkevych/A-Star-Pathfinding-Visualizer
A visualization program showing various pathfinding algorithms in action, including A* pathfinding.
Language: Java - Size: 208 KB - Last synced at: 3 months ago - Pushed at: about 3 years ago - Stars: 0 - Forks: 0

tharushaudana/search-algorithm-visualization-python
This Python project offers real-time visualizations of key search algorithms like DFS, BFS, GBFS, and ASTAR. Users can observe these algorithms in action, providing insights into their workings and efficiency.
Language: Python - Size: 618 KB - Last synced at: 3 months ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

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

kunalPisolkar24/AI_Lab
Collection of practical codes for Savitribai Phule Pune University's Artificial Intelligence (310258) .
Language: Java - Size: 133 KB - Last synced at: 3 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

nataliakoliou/Taxi-Dispatching-System-using-JADE
Java-based taxi dispatching system for single and multi-agent coordination in grid world environments
Language: Java - Size: 99.6 KB - Last synced at: 12 months ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 0

Hamzeh01/path-finder
Go to Bucharest in the fastest way
Language: JavaScript - Size: 105 KB - Last synced at: 12 months ago - Pushed at: 12 months ago - Stars: 0 - Forks: 0

ax4w/pathfinding
pathfinding visualization in go using raylib
Language: Go - Size: 7.81 KB - Last synced at: 12 months ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

officio-indrajeet/Artificial_Intelligence_CS7IS2
Artificial Intelligence assignments taught at Trinity College Dublin.
Language: Python - Size: 5.68 MB - Last synced at: 3 months ago - Pushed at: 12 months ago - Stars: 0 - Forks: 0

Computer-Science-Classes/MazeLab
This Java-based GUI program lets users generate and solve mazes. It employs the Depth-First Search (DFS) algorithm for maze generation and A* algorithm with Manhattan distance heuristic for solving. The program provides a visual representation of the maze, allowing users to visualize the process of maze creation and solving.
Language: Java - Size: 545 KB - Last synced at: 12 months ago - Pushed at: 12 months ago - Stars: 0 - Forks: 0

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: 12 months ago - Pushed at: 12 months ago - Stars: 8 - Forks: 4

ericgtkb/shortest-path
Shortest path algorithms
Language: C++ - Size: 13.7 KB - Last synced at: 12 months ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

johnnyawesome/A-Star
A* / A-Star Search Algorithm
Language: JavaScript - Size: 5.24 MB - Last synced at: 12 months ago - Pushed at: 12 months ago - Stars: 0 - Forks: 0

beacastroos/Unequal-Lenght-Maze-Game
Language: Python - Size: 218 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

DinohRatiarisandy/8-puzzle-game
8-puzzle-game made with pygame and use A* to solve the game
Language: Python - Size: 19.5 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

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

Mhijazi16/SOKOBAN.AI
Building and Solving Sokoban game using AI
Language: C++ - Size: 36.1 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - 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: 5 months ago - Pushed at: over 2 years ago - Stars: 4 - Forks: 1

LucasPeixotg/aStarPathfinding
A pathfinder in python using the A* algorithm.
Language: Python - Size: 9.77 KB - Last synced at: about 1 year ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

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

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: about 3 years ago - Stars: 3 - Forks: 0

cristianpjensen/pathfinding-visualizer
A visualiser that shows how different *pathfinding algorithms* find a path.
Language: Python - Size: 1.57 MB - Last synced at: about 1 year ago - Pushed at: almost 5 years ago - Stars: 1 - Forks: 0

RiccardoLionetto/aerial-robotics Fork of lis-epfl/micro-502
Drone control algorithm: A* obstacle avoidance, grid search and image recognition (OpenCV)
Language: Python - Size: 164 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

ntran26/Path-planning
Language: Python - Size: 258 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

FilipeLopesPires/PacmanAgent-AI
Pacman Agent: an artificial intelligent agent that plays Pacman.
Language: Python - Size: 8.75 MB - Last synced at: 9 days ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 1

mahmoudgamalhafez/Route_Planner_Project
my work through the c++ nanodegree udacity
Language: C++ - Size: 2.41 MB - Last synced at: about 1 year ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 0

stefanhuber/osm-astar-demo
A* Demo with leaflet and osm data
Language: JavaScript - Size: 1.87 MB - Last synced at: about 2 months ago - Pushed at: about 2 years ago - Stars: 2 - Forks: 1

adarshanand67/Google-Maps-0.5 Fork of AniketChaudhri/Google-Maps-0.5
Path Finding Visualiser using Dijkstra, A* and BackTracking
Language: Jupyter Notebook - Size: 20.5 MB - Last synced at: about 1 year ago - Pushed at: almost 3 years ago - Stars: 0 - Forks: 0

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

vinit714/Optimizing-Real-Time-Path-Planning-for-NPC-Navigation-Leveraging-CentA--Algorithm
CentA*, an A* algorithm extension, revolutionizes NPC pathfinding in Unreal Engine 5. Optimal start and end node selection improves efficiency. Developed with Blueprints and C++, it introduces diverse enemy behaviors via a behavior tree. Balancing accuracy and efficiency accommodates obstacles, dynamic environments, and multiple agents.
Language: C++ - Size: 271 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 1

Chan-dre-yi/19MIY0031_Chandreyi_AI_LAB
This is a cloned repository, original one by: fakemonk1 named: AI-Search-Algorithm-Implementations. We used this repository to implement and document several commits to the existing code for our LAB EXPERIMENTS of the subject ARTIFICIAL INTELLIGENCE FOR DATA SCIENCE.
Language: Python - Size: 596 KB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

adityam31/AIR-assignments
Artificial Intelligence and Robotics Assignments
Language: Jupyter Notebook - Size: 264 KB - Last synced at: about 1 year ago - Pushed at: almost 5 years ago - Stars: 1 - Forks: 0

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

shamiul94/Artificial-Intelligence-Sessional-Cannibal-Missionary-Problem-and-n-Puzzle-problem-
AI Lab Offlines and Onlines
Language: Java - Size: 657 KB - Last synced at: about 1 year ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 3

phantomf4321/The-waiter-robot
Implementation of artificial intelligence search algorithms for robot movement on the table.
Language: Python - Size: 482 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 2 - Forks: 0

Adidem23/8PuzzleSolver-Final
This is 8-Puzzle-Problem Solver In which We can Input any intermediate State in it and because of it will generate solution of this state and give us goal state based on input state .
Language: HTML - Size: 252 KB - Last synced at: 3 months ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

natashasaki/CS237A_Autonomous_Delivery
Final group project for CS237A (Principles of Robot Autonomy I).
Language: Python - Size: 66.5 MB - Last synced at: 4 months ago - Pushed at: over 4 years ago - Stars: 2 - Forks: 0

vmsaif/ant-path-finding-using-A-Star-algorithm
The world of ants and their incredible pathfinding abilities. This program, written in Java, uses the A* algorithm to determine the shortest path for an ant to reach its food. Witness the efficiency and precision of the A* algorithm in action, as the ant navigates through various terrains and obstacles.
Language: Java - Size: 1.66 MB - Last synced at: about 1 year ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 1

lamnguyen5464/8-Queens-by-SAT
Language: Python - Size: 11.7 KB - Last synced at: about 1 year ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

piketrcechillas/A-Star-Visualizer
Visualizer for A-Star
Language: Java - Size: 79.1 KB - Last synced at: about 1 year ago - Pushed at: almost 5 years ago - Stars: 1 - Forks: 0

gchacaltana/A_Star_Search_Algorithm
Implementación de algoritmo de búsqueda A*
Language: Python - Size: 16.6 KB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 2 - Forks: 0

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

BY571/A-star-search
A-Star-search example with individual search room creation
Language: Python - Size: 361 KB - Last synced at: about 1 year ago - Pushed at: about 6 years ago - Stars: 0 - Forks: 0

PranjalAgni/cuddly-octo-robot
This is A* Algorithm visualization and how it works to find the shortest path using Heuristics
Language: JavaScript - Size: 559 KB - Last synced at: about 1 year ago - Pushed at: almost 6 years ago - Stars: 0 - Forks: 0

romz-pl/sliding-puzzle-game
Solves sliding puzzle game for the board of size 5x5, i.e. puzzle 24 game.
Language: C++ - Size: 119 KB - Last synced at: about 1 year ago - Pushed at: about 4 years ago - Stars: 1 - Forks: 0

overtane/udacity-aind-p3
Domain independent planner
Language: Python - Size: 2.57 MB - Last synced at: about 1 year ago - Pushed at: over 7 years ago - Stars: 0 - Forks: 0

mustafamerttunali/comp303-project2
Comparison of Two Shortest Path Algorithms using Python.
Language: Python - Size: 36.1 KB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 2 - Forks: 1

sukhmancs/maze-solver
Language: Python - Size: 6.84 KB - Last synced at: 5 days ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

qr34t0r/BRP
A Bresenham's line based global path planning algorithm. A recursive path planning algorithm was developed that operates on the grid maps represented by a masked array and solves potential looping problems using a state machine-based loop breaking mechanism.
Language: Python - Size: 18.6 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

N-Harsha/Path-finding-visualizer
path finder in maze using graph algos
Language: TypeScript - Size: 396 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - 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: almost 6 years ago - Stars: 12 - Forks: 9

pri1311/Dyce-and-Dyne
Dyce&Dyne is a modern-day food ordering website. Instead of the traditional PROMO Code technique, we introduce games & quizzes. A user can play games and earn rewards in the ratio of their respective score. The games are 8 Puzzle and connect4. Algorithms like minimax with alpha-beta pruning, A* are used for these games. We have also solved the vehicle routing problem or the TSP using genetic algorithm.
Language: EJS - Size: 50.8 MB - Last synced at: about 1 year ago - Pushed at: over 3 years ago - Stars: 1 - 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: about 1 year ago - Stars: 4 - Forks: 0

SameetAsadullah/Graph-Based-A-Star-in-Python
Python program to implement graph based A* algorithm on a map of Romania
Language: Python - Size: 2.93 KB - Last synced at: 3 days ago - Pushed at: almost 3 years ago - Stars: 2 - Forks: 0

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

sksuryan/astar
This is visualization of A-Star Algorithm with the help of Binary Search Trees.
Language: JavaScript - Size: 158 KB - Last synced at: about 2 months ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 0

brahmnoor/Hermes
Programmatically find the path which keeps you socially distant and is shortest to your destination anywhere. Computer Vision + Shortest Path Finding Algorithm
Language: JavaScript - Size: 2.33 MB - Last synced at: about 1 year ago - Pushed at: about 4 years ago - Stars: 1 - Forks: 2

plamenabrezova/8puzzle
4️⃣ Coursera: Algorithms Part 1 - Princeton University | Week 4
Language: Java - Size: 260 KB - Last synced at: 6 months ago - Pushed at: about 2 years ago - Stars: 0 - Forks: 0

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

ShubhamPatil7-zz/Path-Finder-using-A-star
Language: Python - Size: 888 KB - Last synced at: about 1 year ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 0

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: about 2 months ago - Pushed at: over 6 years ago - Stars: 29 - Forks: 17

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: about 1 year ago - Pushed at: about 1 year ago - Stars: 8 - Forks: 1

abdelfetah18/PathFindingAlgorithm
A-star is a graph traversal and path search algorithm
Language: JavaScript - Size: 4.88 KB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

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: about 1 year ago - Pushed at: about 5 years ago - Stars: 3 - Forks: 0

fredlacis/ZodiacAI
:robot: A project that implements an A* pathfinding algorithm and a Genetic Algorithm to find the best combination to beat the 12 zodiac houses from the Knights of the Zodiac show.
Language: Python - Size: 210 KB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 0 - Forks: 0

ragvri/Artificial-Intelligence-Lab Fork of aagrawal207/Artificial-Intelligence-Lab
For all the examples, test programs and assignments
Language: Jupyter Notebook - Size: 16 MB - Last synced at: about 1 year ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

peakyquest/Path-Planning-ROS
This package is developed as part of a ROS (Robot Operating System) project for path planning. It includes implementations of A* (A star), Dijkstra, and Greedy algorithms for path planning in robotic applications.
Language: CMake - Size: 5.6 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

PrideInt/a-star-search-mta
A* search path-finding algorithm used to determine the best path from one station to another. A reiteration of my previous project: https://github.com/PrideInt/mta-graphing.
Language: Python - Size: 16.6 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

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

ant-louis/pancakes-sorting
Implementing of 2 algorithms to sort a vector of integers by prefix reversal.
Language: C++ - Size: 142 KB - Last synced at: over 1 year ago - Pushed at: about 5 years ago - Stars: 0 - Forks: 0

Mickeyo0o/ObjectOrientedHuntingSimulation
Language: Java - Size: 37.7 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

ChiragRadhakrishna43-7/Pacman
Implementation of different search algorithms for the Pacman game.
Language: Python - Size: 408 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

MAbdelhamid2001/8-Puzzle-Solver
8-Puzzle-Solver
Language: Python - Size: 3.91 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

imehrdadmahdavi/street-route-planner
Using real map data and A* search to find a path between two points - implemented using C++17
Language: C++ - Size: 2.21 MB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 0 - Forks: 1

mciccale/practica-ia
A* Algorithm Implementation and Test with the Athenas Metro Lines
Language: Python - Size: 157 KB - Last synced at: about 2 months ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 1

nxsaken/graph-search-algorithms
Graph search algorithms implemented in Common Lisp
Language: Common Lisp - Size: 4.88 KB - Last synced at: 3 months ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

natehalsey/A-Star-Pathfinding 📦
Another A* pathfinding algorithm implementation
Language: Java - Size: 2.52 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

ahmad-thewhiz/Project-102-Path-Prediction-using-A-Algorithm
Data Structures - I, Semester - II, Project
Language: C - Size: 4.88 KB - Last synced at: about 1 year ago - Pushed at: almost 2 years ago - Stars: 1 - Forks: 0

SheidaAbedpour/Search-Algorithms-and-Multiple-Linear-Regression
optimizing flight planning and predicting flight prices, showcasing the application of cutting-edge algorithms and machine learning techniques
Language: Jupyter Notebook - Size: 9.16 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

CodeByAidan/A-Star-Path
A* Algorithm Path Visualizer Website! CC-BY-SA-4.0
Language: JavaScript - Size: 22.5 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 2 - Forks: 0

SpeedyE1780/Tower-Defence
Project 2 of my FUNDAMENTALS OF COMPUTER PROGRAMMING WITH PYTHON course. Made in April 2019
Language: Python - Size: 113 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

dramos2001/The-Eight-Puzzle-Solver
Program that uses artificial intelligence principles to solve an eight square puzzle; frontend app w/ flask currently in progress
Language: Python - Size: 207 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 0
