An open API service providing repository metadata for many open source software ecosystems.

Topic: "astar-search-algorithm"

snrazavi/AI-Programming-using-Python

This repository contains implementation of different AI algorithms, based on the 4th edition of amazing AI Book, Artificial Intelligence A Modern Approach

Language: Jupyter Notebook - Size: 55.8 MB - Last synced at: almost 2 years ago - Pushed at: over 3 years ago - Stars: 56 - Forks: 26

devangi2000/Artificial-Intelligence-Algorithms

A repository containing codes and algorithms for the AI course 18CSC305J.

Language: Jupyter Notebook - Size: 257 KB - Last synced at: about 2 years ago - Pushed at: about 4 years ago - Stars: 29 - Forks: 11

Leonardpepa/Pathfinding-Visualizer

Pathfinding Visualizer application that visualizes graph based search algorithms used to find the shortest path. Algorithms used: Breadth first search, Depth first search, Best first search and A* search made with java swing

Language: Java - Size: 521 KB - Last synced at: 3 months ago - Pushed at: over 3 years ago - Stars: 25 - Forks: 14

Kilosoft/PathFindHexagon

Astar A* pathfinding Unity C#

Language: C# - Size: 2.28 MB - Last synced at: 3 months ago - Pushed at: about 5 years ago - Stars: 18 - Forks: 6

Pariasrz/N-Puzzle-solver-with-Search-Algorithms

N-Puzzle implementation with BFS, DFS, Greedy and A*

Language: Python - Size: 6.84 KB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 9 - Forks: 2

Leonardpepa/Freecell-solitaire-AI-Solver

Freecell solitaire Solver Project for Artificial Intelligence course from University of Macedonia

Language: Java - Size: 554 KB - Last synced at: 3 months ago - Pushed at: over 3 years ago - Stars: 8 - Forks: 0

FawadJawaid/8-puzzle-solver-AI

This is an Artificial Intelligence project which solves the 8-Puzzle problem using different Artificial Intelligence algorithms techniques like Uninformed-BFS, Uninformed-Iterative Deepening, Informed-Greedy Best First, Informed-A* and Beyond Classical search-Steepest hill climbing.

Language: C++ - Size: 108 KB - Last synced at: over 2 years ago - Pushed at: almost 6 years ago - Stars: 8 - Forks: 6

soumyaa1804/PathFinding-Visualization

Mangalyaan is a web application that helps a Mars rover to find the shortest path between two points on a surface while avoiding obstacles on the way using different searching algorithms.

Language: JavaScript - Size: 8.22 MB - Last synced at: over 2 years ago - Pushed at: over 2 years ago - Stars: 7 - Forks: 3

k0t9i/L2jGeodataPathFinder

L2j format geodata path finder

Language: C++ - Size: 1.54 MB - Last synced at: 3 months ago - Pushed at: 10 months ago - Stars: 6 - Forks: 2

Sinu-Tech/Galeraxxx-Search-Escape

Jogo com algoritmo de busca para fugir de uma ou várias IA em um labirinto

Language: Python - Size: 580 KB - Last synced at: about 1 year ago - Pushed at: almost 3 years ago - Stars: 6 - Forks: 1

andremion/SlidingPuzzle

A Kotlin multiplatform puzzle game based on the Sliding-Puzzle problem that uses A* search algorithm to solve it

Language: Kotlin - Size: 369 KB - Last synced at: 3 months ago - Pushed at: over 1 year ago - Stars: 5 - Forks: 1

alishhde/AISearchAlgorithm

In this algorithm, I have written a module which is consist of a couple of main searching algorithm that has been implemented on the 8 puzzle problem as default.

Language: Python - Size: 1.02 MB - Last synced at: over 2 years ago - Pushed at: over 2 years ago - Stars: 5 - Forks: 0

consequencesunintended/AStarSearch

A Simple Implementation of A Star Search Algorithm

Language: C++ - Size: 2.88 MB - Last synced at: almost 2 years ago - Pushed at: almost 3 years ago - Stars: 5 - Forks: 0

kshitizsaini113/RoutePlanner-with-OpenStreetMap

Route Planner with OpenStreetMap is a C++ based project which used the A* Search algorith for finding the distance between two points on a map.

Language: C++ - Size: 15.6 KB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 5 - Forks: 2

cybr17crwlr/A-Star-8-puzzle-Python

A code to solve 8 Puzzle game using A star algorithm.

Language: Python - Size: 4.88 KB - Last synced at: over 2 years ago - Pushed at: almost 6 years ago - Stars: 5 - Forks: 11

sondosaabed/Round-Table-Seating-Arrangement-Search-and-Heuristic

Round table arrangemnet solution using greedy, Astar and UCS algorithms on graph data structure.

Language: Jupyter Notebook - Size: 1.78 MB - Last synced at: 3 months ago - Pushed at: 12 months ago - Stars: 4 - Forks: 0

sukhdev01/Artificial-Intelligence-AI

Python codes for A* algo, RBFS algo and IDS algo on 8_PUZZLES problem.

Language: Jupyter Notebook - Size: 23.4 KB - Last synced at: 5 months ago - Pushed at: over 5 years ago - Stars: 4 - Forks: 1

JasonNumberThirteen/UnityAStarVisualiser

A project for visualising working of the A* algorithm made in "Unity".

Language: C# - Size: 1.02 MB - Last synced at: 16 days ago - Pushed at: 16 days ago - Stars: 3 - Forks: 2

MartinGurasvili/Maze-Pathfinding

This is a Maze Pathfinding Application that includes the A* Algo as-well as the BFS Algo

Language: Python - Size: 29.3 KB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 3 - Forks: 0

MortezaHagh/Astar-Path-Planning-MATLAB

Astar single robot path planning algorithm in MATLAB. For grid-based 2D environments.

Language: MATLAB - Size: 536 KB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 3 - Forks: 0

Rushour0/Path-Finding-Algorithms

Visualizer for various Path Finding Algorithms

Language: JavaScript - Size: 24.8 MB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 3 - Forks: 0

Anurag-kuswaha/Advance-Shortest-Path

. implement Bidirectional Dijkstra and use it to compute distances in social networks very quickly; 2. implement A* search algorithm and apply it to compute distances in road networks faster than the classic algorithms do; 3. implement Contraction Hierarchies algorithm and apply it to preprocess large road networks and then compute distances in them much faster;

Language: C++ - Size: 1.76 MB - Last synced at: over 1 year ago - Pushed at: about 4 years ago - Stars: 3 - Forks: 0

btknzn/Maze-Solving-A-star-search-algorithm

Language: Python - Size: 87.9 KB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 3 - Forks: 0

Barbany/IA-epfl

Repository for the programming exercises of the Intelligent Agents course (CS-430) at EPFL.

Language: Java - Size: 22.7 MB - Last synced at: 5 months ago - Pushed at: over 5 years ago - Stars: 3 - Forks: 0

Daemon6109/AStarPathfinding

A* search algorithm in luau

Language: Luau - Size: 1.08 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 2 - Forks: 0

leonlin276/PathPlanningAlgorithm

This is a project that applies the A* path planning algorithm to a target environment, programmed in MATLAB. The project includes two parts: generating environment data based on a monochromatic bitmap, and applying the A* path planning algorithm to this environment.

Language: MATLAB - Size: 135 KB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 2 - Forks: 0

BlackMagicAI/AStar

Java and Python implementations of the A* (A Star) path planning algorithm. Includes example test driver command line program.

Language: Java - Size: 189 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 2 - Forks: 3

MortezaHagh/LPAstar-Path-Planning-MATLAB

LPAstar single robot path planning algorithm in MATLAB. An Incremental search algorithm. For grid-based 2D environments.

Language: MATLAB - Size: 70.3 KB - Last synced at: over 2 years ago - Pushed at: about 3 years ago - Stars: 2 - Forks: 0

LukeProducts/AStar-Pathfinding-Cpp

A* Pathfinding C++ providing many additional features

Language: C++ - Size: 576 KB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 2 - Forks: 0

khalidsaifullaah/8-Puzzle-A-Star-Search

The 8-puzzle game and also lets the user get it solved by the (A* heuristics based) A.I

Language: JavaScript - Size: 45.9 KB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 2 - Forks: 0

bostoncleek/Astar

A* planner and control

Language: Python - Size: 1.42 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 2 - Forks: 0

CGQAQ/cc_astar

A* Algorithm written in pure c++ 17

Language: C++ - Size: 17.6 KB - Last synced at: about 20 hours ago - Pushed at: almost 5 years ago - Stars: 2 - Forks: 0

sgteja/Path-Planning

Popular algorithms used in path planning of robotics

Language: Python - Size: 28.8 MB - Last synced at: about 1 year ago - Pushed at: about 6 years ago - Stars: 2 - Forks: 0

gokul-gokz/Gokulnarayanan_sathyanarayanan_intern

Multi agent path planning

Language: C++ - Size: 446 KB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 2 - Forks: 0

kirillsimin/astar_alphabet

A* Alphabet is an innovative exploration of the A* search algorithm, transforming the alphabet into a dynamic graph where customizable heuristics and intelligent pathfinding reveal the most efficient routes between letters.

Language: Python - Size: 28.3 KB - Last synced at: 22 days ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

majumderarnob/BRACU_CSE422-Artificial_Intelligence

Language: Jupyter Notebook - Size: 2.88 MB - Last synced at: 7 months ago - Pushed at: 7 months ago - Stars: 1 - Forks: 0

hotungkhanh/A-star-search-agent

A simplified Tetris game where the goal is to remove a target token using the fewest moves. Implements A* search with heuristic optimization to find the shortest sequence of actions for the Red player.

Language: Python - Size: 531 KB - Last synced at: 8 months ago - Pushed at: 9 months ago - Stars: 1 - Forks: 0

Mohamed-Elnageeb/AI-algorithms

Implementations of common algorithms used in AI

Language: Jupyter Notebook - Size: 111 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

fazelelham32/AI-Programming-Medicine_Clinical_Imaging_Classification-Elevation-master

This repository contains implementation of different AI algorithms, based on the 4th edition of amazing AI Book, Artificial Intelligence A Modern Approach

Language: Python - Size: 47.7 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

sunnyallana/AStar-Threaded-Search

This repo implements A* search with multithreading for faster pathfinding.

Language: C++ - Size: 1.9 MB - Last synced at: 4 months ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

alexyzha/AStar-Visualizer 📦

A* Algorithm Visualizer || C++ Backend || Visualization on GitHub Pages

Language: C++ - Size: 902 KB - Last synced at: about 2 months ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 0

benny-abhishek/Infotainment-System

A software developed for automobiles to provide entertainment and information. Contains features like Easy access of contacts using Trie Data Structure, Navigation System where A-Star Algorithm is used.

Language: C++ - Size: 283 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 0

DADILabKIT/Path_Planning_in_OCCT

DADI Lab에서 진행 중인 길찾기 알고리즘 관련 알고리즘 스터디 및 구현 결과를 관리하는 프로젝트입니다. (A project to manage the study and implementation results of the algorithm related to the wayfinding algorithm in progress at DADI Lab.)

Language: Python - Size: 7.76 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 1 - Forks: 1

rshn1994/Cplusplus_OpenStreetMap_Project

Language: C++ - Size: 2.73 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 1 - Forks: 0

Zy8712/Shortest-Path-via-Search-Algorithms

Language: Python - Size: 10.7 KB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 0

arevish/A-PathFinding-Visualizer

This pathfinding algorithm find the shortest-path & Generate grid using maze-generation algorithm and add the ability of controlling the grid structure & distribution of the blocks and the position of the source and the destination.

Language: Python - Size: 7.81 KB - Last synced at: about 1 month ago - Pushed at: almost 3 years ago - Stars: 1 - Forks: 0

kylerifqi/pathfinderUI

A pathfinder with a UI that can be used in a browser, no installations needed.

Language: JavaScript - Size: 2.86 MB - Last synced at: over 2 years ago - Pushed at: almost 3 years ago - Stars: 1 - Forks: 0

bharadwaj-chukkala/Path-Planning-for-a-rigid-robot-using-A-Star-search-algorithm- Fork of bharadwajch123/A-star-path-planning-for-rigid-robot

ENPM 661 Project 3 Phase 2: A rigid robot traverses through a configuration space to find the goal node using A star search algorithm, while it avoid the obstacles in the map

Language: Python - Size: 103 KB - Last synced at: over 2 years ago - Pushed at: almost 3 years ago - Stars: 1 - Forks: 0

arrafi-musabbir/A-star-search-algorithm

Solves A-star search algorithm from a graph oh cities

Language: Python - Size: 8.79 KB - Last synced at: over 2 years ago - Pushed at: almost 3 years ago - Stars: 1 - Forks: 1

kushgupta-official/Graph-algo-visualizer

Language: JavaScript - Size: 4.55 MB - Last synced at: 10 days ago - Pushed at: about 3 years ago - Stars: 1 - Forks: 2

nkadekar/Ship-Balancing-Transfer Fork of ezhu010/CS179M-Project

CS179M Senior Design Project

Size: 1.55 MB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 1 - Forks: 0

radumicea/Visual-Pathfinder

A Dijkstra's and A* search algorithm visualizer

Language: C# - Size: 81.3 MB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 1 - Forks: 0

sababot/pathfinding

The A* pathfinding algorithm implemented in C++

Language: C++ - Size: 823 KB - Last synced at: over 2 years ago - Pushed at: over 3 years ago - Stars: 1 - Forks: 0

Kaledi03/A-Star-Random-Obstacles-Processing

A* algorithm in processing with random obstacle generation

Language: Processing - Size: 15.6 KB - Last synced at: almost 2 years ago - Pushed at: over 3 years ago - Stars: 1 - Forks: 0

Siya2704/AI-assignments

Implementation of BFS, DFS, Uniform cost search, greedy search, A* search for path finding in maze, Implementation of Water Jug problem with jugs having capacity m and n, resp.

Language: Jupyter Notebook - Size: 1.32 MB - Last synced at: 11 months ago - Pushed at: over 3 years ago - Stars: 1 - Forks: 2

nikhilchaudhary0126/image-path-finding

Path finding algorithms to find a path between pixels of images representing geographical features. Shows an OpenCV image output of traversal.

Language: Python - Size: 2.89 MB - Last synced at: over 2 years ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 0

FiryanulRizky/Program-NeuralNetwork-Astar-Hebb-McCullotchPitts

Projek C++ Neural Network

Language: C++ - Size: 238 KB - Last synced at: 4 months ago - Pushed at: about 4 years ago - Stars: 1 - Forks: 1

costvin15/8Puzzle

Trabalho avaliativo como parte da primeira nota de Inteligência Artificial no curso de Ciência da Computação - UFMA

Language: JavaScript - Size: 44.9 KB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

mandy1612/puzzles-in-AI

puzzles in AI is a collection of intelligent agents written in Python to solve different arcade games. This project was created for the purposes of experimenting with the implementation of game playing and puzzle solving using AI techniques.

Language: Jupyter Notebook - Size: 27.3 KB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

CybernetHacker14/ND-Cpp-Route-Planning

A C++ project for demonstrating route planning using A* Search

Language: C++ - Size: 50.6 MB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

gazdimi/Artificial-Intelligence

Solution for blocks world and water pouring problems using A* algorithm and Breadth First Search.

Language: Tcl - Size: 9.24 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

lkoshale/DA_STAR

A* ( Star) algorithm for dynamic graphs on GPU

Language: Cuda - Size: 10.7 MB - Last synced at: over 2 years ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 1

btknzn/Senior-Project-2019-Spring

Abstract: The main goal of this project is to create four robotic systems that can carry a flag in hurdle area. There are certain criterias supposed to follow are falling flag, collision with obstacle and each robot should find other robots. We are planning to achieve one centred system. This main system consists of one microcontroller, one camera and four robotics devices Each robot will find right direction for carrying the flag to the target robot. Additionally, the basic working principle of this system is to detect robots and obstacles at a certain height with a camera located out of the platform and to establish routes from color selection. With the routes calculated, we will establish a map for carrying the flag to another robot. The technical process of the Project is mainly based on the Image Processing, Embedded Systems, Robotics, artificial Intelligence and Control Systems.

Size: 125 KB - Last synced at: almost 2 years ago - Pushed at: almost 5 years ago - Stars: 1 - Forks: 0

MattIPv4/Dijkstrastar 📦

A Python, PyGame simulation of Dijkstra and A*, running at the same time.

Language: Python - Size: 1.63 MB - Last synced at: about 1 year ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

OliverKohl/Route-Planning-Project

A route planner built in C++ that uses OpenStreetMap data, A* search and the IO2D visualization library to find a path between two points on a real-world map.

Language: C++ - Size: 1.16 MB - Last synced at: about 1 year ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 2

LukasLeonardKoening/Route-Planner

C++ implementation of an A* route planner

Language: C++ - Size: 5.54 MB - Last synced at: over 1 year ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

DeepDuke/MotionPlanning-Course 📦

Demo code for motion planning algorithms

Language: Makefile - Size: 6.38 MB - Last synced at: almost 2 years ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

Ashley-Gibson/Path-Finder

*** IN PROGRESS *** - Path Finding Algorithm Project in C#

Language: C# - Size: 29.3 KB - Last synced at: over 1 year ago - Pushed at: about 5 years ago - Stars: 1 - Forks: 0

pprattis/generic-planner-for-minigames

A python script that implements a generic planner to solve a series of minigames using heuristic algorithms to generate the best possible moves to reach the goal state.

Language: Python - Size: 14.6 KB - Last synced at: 27 days ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 2

HudaF/Artificial-Intelligence-Course-work

CS 351: Introduction to Artificial Intelligence Assignments

Language: Jupyter Notebook - Size: 921 KB - Last synced at: almost 2 years ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 0

nicholasRenninger/Motion-Planning-Projects

A collection of motion planning projects in Python 3 and YAML

Size: 204 KB - Last synced at: over 2 years ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 1

cerule7/astar

Implementation of A* path finding in random grid worlds

Language: Python - Size: 4.77 MB - Last synced at: almost 2 years ago - Pushed at: over 5 years ago - Stars: 1 - Forks: 1

tjazerzen/a_star_algorithm

Implementation of A* algorithm in python

Language: Python - Size: 18.6 KB - Last synced at: about 2 years ago - Pushed at: almost 6 years ago - Stars: 1 - Forks: 0

mattnaichuan/8-puzzle

8 puzzle BFS in Java

Language: Java - Size: 1.95 KB - Last synced at: about 2 months ago - Pushed at: almost 6 years ago - Stars: 1 - Forks: 0

vbarbosavaz/A-Star_search_algorithm

A* (pronounced "A star") is a computer algorithm used in pathfinding and graph traversal. This repository is an implementation of this algorithm in Python.

Language: HTML - Size: 2.19 MB - Last synced at: over 2 years ago - Pushed at: over 6 years ago - Stars: 1 - Forks: 1

eveup/ARTIFICIAL-INTELLIGENCE-CSE422-BRACU

# ARTIFICIAL-INTELLIGENCE-CSE422-BRACUThis repository contains the implementation of the A* Search Algorithm for the CSE422 lab assignment, focusing on finding the optimal route from Arad to Bucharest. Explore the project and its structure through the provided links and images. 🐙🌐

Language: Python - Size: 13.7 KB - Last synced at: 20 days ago - Pushed at: 20 days ago - Stars: 0 - Forks: 0

grade12-CS/U5A2-Recursive-Maze-Navigator

A* search Maze Navigator with recursion instead of while loops

Language: Java - Size: 335 KB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 0 - Forks: 0

TonyManz1/FSR-Navigation-planning-Car-like-Robot

This repository contains the final technical project of the Field and Service Robotics course held by Prof. Fabio Ruggiero at Federico II, Naples.

Language: MATLAB - Size: 19.2 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

ishidur/path_planner

A star and Hybrid A star path planning algorithm written in Rust, Python

Language: Rust - Size: 745 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

Munkh09/Maze-and-N-Puzzle-AI-Agents

Maze and N-Puzzle AI Agents Development

Language: Python - Size: 6.84 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

Dark-joy369/ai-algorithms

This Repository contain Artificial Intelligence Algorithms Codes in Python

Size: 1.95 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

matajoh/4M26-postgrad

Lecture notes for 4M26 in the form of a video game

Language: Python - Size: 1.6 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

ojoaosoares/The-Lost-Woods

Dijkstra vs A* and Adjacency Matrix vs Lists comparison

Language: C++ - Size: 1.98 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 0 - Forks: 0

HaydenD100/MazeSolver

This program randomly generates a maze and then solves that maze using A* pathfinding algorithm

Language: C++ - Size: 181 KB - Last synced at: 29 days ago - Pushed at: 6 months ago - Stars: 0 - Forks: 0

shsiena/rubiks-cuber

A robot designed to scan and solve a Rubik's Cube using the IDA* pathfinding algorithm

Language: Python - Size: 54.7 KB - Last synced at: 3 months ago - Pushed at: 6 months ago - Stars: 0 - Forks: 0

XsnakezonX/AstarSolving8-puzzle

A university assignment to solve an 8-puzzle using A star as solution path searching algorithm.

Language: Python - Size: 315 KB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 0 - Forks: 0

ifrazaib/RobotDelivery

In this repo I have coded simple robot navigation system which deliver the product to cities with the use of algorithms like best first search algorithm and a star search algorithm

Language: Jupyter Notebook - Size: 197 KB - Last synced at: about 1 month ago - Pushed at: 10 months ago - Stars: 0 - Forks: 0

NekSfyris/astar_path_planning

A simple and interactive platform to test A* path planning.

Language: C++ - Size: 1.24 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

Tasneem-Selim-Researcher/AI-Lab-Material

Implementation of popular AI algorithms

Language: Jupyter Notebook - Size: 1.98 MB - Last synced at: about 2 months ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

mbuffa/elixir-pathfinding-demo

An Elixir/LiveView demo of the A* pathfinding algorithm

Language: Elixir - Size: 291 KB - Last synced at: about 2 months ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

lollocenne/PathFinder-A-Star-Extend

Exmple of the A star algorithm

Language: Python - Size: 37.1 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

Daksh2060/vacuum-cleaning-simulator

A simple search agent of an autonomous vacuum cleaner, trying to reach dirt spilled in different parts of a randomly generated room in the most efficient way possible. The project utilizes various search algorithms including, but not limited to; Greedy Search, Uniform Cost Search, and A* Search utilizing both path cost and a Manhattan heuristic.

Language: Python - Size: 128 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

LuciferDIot/Sliding-puzzles-A-Astar-

Usage of A*/Astar algorithm

Language: Java - Size: 736 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

meeshawn/projects

Meeshawn's completed projects in AI, CV, NLP and Multimodal AI

Language: Jupyter Notebook - Size: 153 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

Koukyosyumei/MyOptimizer

Implementations of popular optimization & search algorithms

Language: C++ - Size: 357 KB - Last synced at: 4 months ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

muhammad3245571106/AI-searching-techniques-using-Python-and-Tkinter-for-graphical-user-interface

This is a Python project that uses Tkinter to develop the front end of the application and Python to implement AI searches. This has a cool graphical interface and visualization to make the project look aesthetic.

Language: Python - Size: 21.5 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

Kartikay-Sharma/Path-Finding-Algorithms-Visualization

An interactive tool which visualizes path finding algorithms on a grid.

Language: Python - Size: 22.5 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

gateship1/rushhour

Rush Hour, a sliding block logic game.

Language: C++ - Size: 94.7 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 1

aravindsomaraj/aiproject-pacman

An Artificial Intelligence Project based on UC Berkeley's Pacman AI course

Language: Python - Size: 617 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 1

Shimaa118/Maze-Solver

Maze Solver with Searching Algorithms

Language: Python - Size: 4.88 KB - Last synced at: 12 months ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

Related Topics
astar-algorithm 73 astar-pathfinding 62 astar 34 python 27 astar-search 26 artificial-intelligence 25 pathfinding 22 breadth-first-search 20 ai 15 depth-first-search 14 bfs 13 python3 13 java 13 cpp 13 uniform-cost-search 13 bfs-search 11 dfs 10 path-planning 10 search-algorithm 9 pathfinding-algorithm 8 dfs-search 8 dijkstra-algorithm 8 algorithm 8 heuristic-search-algorithms 7 greedy-best-first-search 7 searching-algorithms 7 pathfinder 7 bfs-algorithm 7 visualization 6 algorithms 6 pygame 6 iterative-deepening-search 6 dfs-algorithm 6 artificial-intelligence-algorithms 6 game 6 alpha-beta-pruning 6 maze 6 8puzzle 6 dijkstra 5 maze-generator 5 cpp17 5 graph-algorithms 5 informed-search 5 8-puzzle 5 javascript 5 maze-solver 5 genetic-algorithm 5 greedy-search 5 robotics 5 dijkstra-shortest-path 4 matlab 4 machine-learning 4 best-first-search 4 shortest-path-algorithm 4 heuristics 4 8puzzle-game 4 csharp 4 pathplanning 4 unity 4 unity2d 3 minimax-algorithm 3 motion-planning 3 visualizer 3 simulated-annealing 3 state-space-search 3 openstreetmap 3 c-plus-plus 3 uninformed-search 3 n-puzzle 3 algorithms-and-data-structures 3 8-puzzle-solver 3 hill-climbing-search 3 search-algorithms 3 reactjs 3 bidirectional-search 3 pathfinding-visualizer 3 dijkstras-algorithm 3 8puzzle-solver 3 depth-limited-search 3 maze-generation 3 water-jug-problem 2 linked-list 2 constraint-satisfaction-problem 2 naive-bayes-classifier 2 agents 2 deep-learning 2 k-means-clustering 2 optimization 2 opencv 2 ucs-algorithm 2 graphs 2 matplotlib 2 pathfinding-algorithms 2 computer-vision 2 maze-generation-algorithms 2 natural-language-processing 2 maze-algorithms 2 puzzle-game 2 bestfirstsearch 2 astar-csharp 2