An open API service indexing awesome lists of open source software.

Projects in Awesome Lists tagged with astar

A curated list of projects in awesome lists tagged with astar .

https://github.com/graphhopper/graphhopper

Open source routing engine for OpenStreetMap. Use it as Java library or standalone web server.

astar dijkstra directions geospatial graphhopper isochrones java map-matching openstreetmap pathfinding public-transportation routing routing-engine

Last synced: 13 May 2025

https://github.com/ai-winter/ros_motion_planning

Motion planning and Navigation of AGV/AMR:ROS planner plugin implementation of A*, JPS, D*, LPA*, D* Lite, Theta*, RRT, RRT*, RRT-Connect, Informed RRT*, ACO, PSO, Voronoi, PID, LQR, MPC, DWA, APF, Pure Pursuit etc.

artificial-potential-field astar autonomous-vehicles dstar-lite jump-point-search lpa-star model-predictive-control motion-planning path-planning path-tracking pure-pursuit robotics ros ros-navigation rrt rrt-star trajectory-planning voronoi

Last synced: 14 May 2025

https://github.com/prettymuchbryce/easystarjs

An asynchronous A* pathfinding API written in Javascript.

astar asynchronous easystar game grid javascript pathfinding

Last synced: 14 May 2025

https://github.com/habrador/self-driving-vehicle

Simulation of path planning for self-driving vehicles in Unity. This is also an implementation of the Hybrid A* pathfinding algorithm which is useful if you are interested in pathfinding for vehicles.

astar autonomous-car autonomous-navigation autonomous-vehicles dubins-path flowfield hybrid-a-star open-source path-planning pathfinding reeds-shepp-curves self-driving-car selfdriving summon tesla teslamotors unit3d unity unity-library

Last synced: 05 Apr 2025

https://github.com/Habrador/Self-driving-vehicle

Simulation of path planning for self-driving vehicles in Unity. This is also an implementation of the Hybrid A* pathfinding algorithm which is useful if you are interested in pathfinding for vehicles.

astar autonomous-car autonomous-navigation autonomous-vehicles dubins-path flowfield hybrid-a-star open-source path-planning pathfinding reeds-shepp-curves self-driving-car selfdriving summon tesla teslamotors unit3d unity unity-library

Last synced: 25 Apr 2025

https://github.com/roy-t/astar

A fast 2D path finding library based on the A* algorithm. Works with both grids and graphs. Supports any .NET variant that supports .NETStandard 2.0 or higher. This library has no external dependencies. The library is licensed under the MIT license.

astar csharp csharp-library dotnet dotnetstandard game-dev game-development pathfinding

Last synced: 16 May 2025

https://github.com/roy-t/AStar

A fast 2D path finding library based on the A* algorithm. Works with both grids and graphs. Supports any .NET variant that supports .NETStandard 2.0 or higher. This library has no external dependencies. The library is licensed under the MIT license.

astar csharp csharp-library dotnet dotnetstandard game-dev game-development pathfinding

Last synced: 18 Mar 2025

https://github.com/Dicklesworthstone/visual_astar_python

Generate Cool-Looking Mazes and Animations Illustrating the A* Pathfinding Algorithm

astar astar-algorithm mazes pathfinding

Last synced: 09 Sep 2025

https://github.com/dicklesworthstone/visual_astar_python

Generate Cool-Looking Mazes and Animations Illustrating the A* Pathfinding Algorithm

astar astar-algorithm mazes pathfinding

Last synced: 05 Apr 2025

https://github.com/metaphoriker/pathetic

A powerful, optimized and easy-to-use Java A* Pathfinding Library for 3D environments.

3d astar astar-java astar-search heuristic-search-algorithms heuristics java pathfinder pathfinding pathing

Last synced: 05 Apr 2025

https://github.com/sollimann/dstar-lite-pathplanner

Implementation of the D* lite algorithm in Python for "Improved Fast Replanning for Robot Navigation in Unknown Terrain"

astar astar-algorithm astar-pathfinding dstar dstar-lite dstarlite gazebo obstacle-avoidance pathplanning pygame python robot-navigation robotics robotics-programming ros ros2 rrt rrt-star rrtstar slam

Last synced: 08 May 2025

https://github.com/jeremyz/godot-hexgrid

a godot based framework to build hex map boardgames.

astar boardgame godot hexboard hexgrid hexmap lineofsight wargame

Last synced: 11 Mar 2025

https://github.com/sturdyspoon/unity-pathfinding

Find paths in Unity Tilemaps with A* Search

2d astar pathfinding unity

Last synced: 30 Jun 2025

https://github.com/dipdup-io/dipdup

Modular framework for creating selective indexers and featureful backends for dapps

arbitrum astar backend base berachain blockchain evm graphql indexers optimism smart-contracts

Last synced: 30 Dec 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/jzyong/navmeshdemo

Unity client navmesh export to server for pathfinding

astar navmesh pathfinding rpg unity3d

Last synced: 23 Jul 2025

https://github.com/jzyong/gameai4j

Game AI for java.NavMesh、A*、BehaviorTree、FSM

astar behavior-tree navmesh pathfinding state-machine

Last synced: 09 Apr 2025

https://github.com/YuYuCong/Astar

机器人路径规划A*算法

astar

Last synced: 18 Mar 2025

https://github.com/deloitteoptimalreality/lightosm.jl

A Julia package for downloading and analysing geospatial data from OpenStreetMap APIs.

astar dijkstra geospatial julia kdtree nominatim openstreetmap overpass rtree

Last synced: 09 Apr 2025

https://github.com/salmonde/pathfinding

A pmmp virion (library) for pathfinding using A*

astar pathfinding pmmp pocketmine pocketmine-mp

Last synced: 23 Oct 2025

https://github.com/apla-toolbox/pythonpddl

🧭🔍 A PDDL Planner in Python partially wrapping PDDL.jl using JuliaPy

artificial-intelligence astar automated-planning dijsktra julia juliapy pddl planner planners pyjulia python

Last synced: 07 Oct 2025

https://github.com/abdallahhemdan/pathfinding-visualizer

🎯 VanillaJS pathfinding visualizer using bunch of different shortest-path algorithms (A*, DFS, BFS, ...etc.)

astar astar-algorithm astar-pathfinding cmp2022 cufe-2022 hemdan pathfinding pathfinding-algorithm pathfinding-visualization pathfinding-visualizer visualization visulizer

Last synced: 01 May 2025

https://github.com/ademakdogan/implementation-of-a-algorithm-visualization-via-pyp5js-

This project has been created for A* algorithm implementation in Python 3 and Pyp5js is used to visualize that algorithm.

astar astar-algorithm astar-pathfinding p5js pathfinding pathfinding-algorithm pyp5js python visualization

Last synced: 07 May 2025

https://github.com/tbvanderwoude/grid_pathfinding

Pathfinding on grids using jumping point search and connected components.

2d astar grid jps pathfinding rust

Last synced: 27 Jul 2025

https://github.com/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

astar astar-algorithm astar-pathfinding astar-search-algorithm best-first-search bfs breadth-first-search depth-first-search dfs dsa-algorithm java leonard leonardpepa pathfinder pathfinding pepa shortest-path-algorithm shortest-paths visualization visualizer

Last synced: 29 Oct 2025

https://github.com/josephmbustamante/godot-3d-astar-tutorial

This tutorial will teach you how to implement A* pathfinding in your own 3d game in Godot.

3d astar astar-pathfinding game-development godot godot-3d godot-engine tutorial

Last synced: 13 Apr 2025

https://github.com/netpyoung/nf.ai.pathfinding

➡️ dotnet pathfinding : A*, JPS(Jump Point Search) ,JPS(with Orthogonal), JPS+

astar csharp dotnet jps jpsplus jumppointsearch

Last synced: 18 Oct 2025

https://github.com/amkhrjee/pathfinder

Visualising search algorithms

astar djikstra golang raygui raylib search

Last synced: 25 Apr 2025

https://github.com/sarkahn/sark_pathfinding_rs

A simple implementation of the pathfinding algorithm from red blob games https://www.redblobgames.com/pathfinding/a-star/implementation.html

2d astar grid pathfinding

Last synced: 01 Jul 2025

https://github.com/machow/astar-r

A* algorithm implemented in R

astar r

Last synced: 11 Apr 2025

https://github.com/dimithrandir/godot_2d_hex_map_nav_demo

Hexagonal TileMap navigation in Godot.

astar dijkstra gdscript godot godot3-5 tilemap

Last synced: 10 Apr 2025

https://github.com/alexp11223/eightpuzzlesolver

8-puzzle solver. A*, RBFS, IDS algorithms, different puzzle sizes.

8-puzzle ai astar n-puzzle

Last synced: 07 May 2025

https://github.com/astarnetwork/astarbase

EVM smart contract for address mapping ss58 <> H160

astar blockchain polkadot smart-contracts solidity

Last synced: 28 Apr 2025

https://github.com/ngocbh/snake

A Snake gameplay and auto play base on BFS , A-star and Greedy Algorithm

ai algorithm astar bfs java snake

Last synced: 11 Sep 2025

https://github.com/dappforce/subid

Wallet info for your favourite Dotsama cryptocurrencies like Polkadot (DOT), Kusama (KSM), Moonbeam (GLMR), Astar (ASTR), Acala (ACA), Subsocial (SUB), and other Substrate chains in the ecosystem.

acala asset-management astar crypto-portfolio kusama moonbeam nft polkadot portfolio portfolio-manager tokens

Last synced: 31 Oct 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/algosup/2024-2025-project-3-quickest-path-team-1

🚀 SmashThePath – Ultra-fast graph search API with optimized bidirectional / unidirectional pathfinding and heuristic acceleration for large-scale networks.

astar cpp csv json open-source quickest-path rest-api xml

Last synced: 17 Jul 2025

https://github.com/karmakamikaze/fcds

This program is designed to simulate the effect of adding idle zones to a food courier delivery service.

astar bfs courier-management dijkstra pathfinding simulation website

Last synced: 18 Mar 2025

https://github.com/k0dep/astar

🔍A* pathfinding algorithm implementation for unity3d

astar astar-algorithm astar-csharp originer pathfinding unity3d unity3d-npm-package upm-package

Last synced: 24 Oct 2025

https://github.com/maar-io/ink-mint-dapp

Minting UI for Wasm smart contract on Astar/Shiden networks

astar ink shiden wasm

Last synced: 09 Oct 2025

https://github.com/shaoruu/cube-wars

:octocat: A shooter game like Boxhead2

algorithm astar boxhead cubes javascript-game pathfinding shaoruu squares zombies

Last synced: 23 Oct 2025

https://github.com/cartesianxr7/scout-navigator

Waypoint pathfinding and navigational re-routing system with a virtual Rust & WASM / Yew interface demonstrating functionality using D*-Lite, A*, and Field D* as optional pathfinding algorithms.

astar dstar-lite pathfinder pathfinding-algorithms pathfinding-visualizer reroute-system rust wasm-bindgen yew-framework

Last synced: 16 Aug 2025

https://github.com/emre-kul/simplegames

Simple Games (2048,snake,1010) and A-star path finding algorithm with javascript+canvas

1010 2048 astar canvas javascript snake

Last synced: 27 Jul 2025

https://github.com/2003scape/rsc-path-finder

👣 generate paths between points on a runescape classic map

astar collision-detection javascript-game landscape maps pathfinder pathfinding rsc runescape tile

Last synced: 04 Mar 2025

https://github.com/neki-dev/pathfinding-worker

🧩 Fast node.js pathfinding on workers for grid-based games

astar dijkstra find grid navigation node path pathfinding way worker

Last synced: 19 Mar 2025

https://github.com/snmslavk/astar

Library with realization of AStar algorithm

astar astar-algorithm astar-csharp hacktoberfest

Last synced: 09 Apr 2025

https://github.com/auspham/byakugan-js

A simple NPM package implemented A* Pathfinding algorithm for sensory type ninjas.

astar astar-algorithm astar-pathfinding javascript naruto pathfinding typescript

Last synced: 05 Apr 2025

https://github.com/eriksvedang/astarinc

A proof of concept implementation of the A* algorithm, using C.

algorithm astar gamedev

Last synced: 25 Jun 2025

https://github.com/sheikhartin/simplified-memory-bounded-a-star

Implementation of the SMA* search algorithm what tries to manage costs along the way...

ai algorithm astar pathfinding search-algorithm shortest-path smastar

Last synced: 03 Apr 2025

https://github.com/hediske/fantastic-path-finder

A path Finder app with map generation made using React Js and Tailwind CSS . It uses Recursive Division or Binary Tree for the Maze generation and Dijkstra , BFS , DFS and A Star for the Path Finding .

astar bfs dfs dijkstra recursive-div shortest-path-algorithm

Last synced: 10 Apr 2025

https://github.com/jancarauma/cobra

Snake game written in C - animations, retro menu, smart snake enemies, sound effects.

animation astar astar-algorithm bass-library c game retro-game retro-game-snake snake snake-game

Last synced: 18 Aug 2025

https://github.com/jonsteinn/vacuumcleaneragent

Path finding vacuum cleaner

artificial-intelligence astar java

Last synced: 13 Sep 2025

https://github.com/hanzopgp/architectapp

Architecture app, AI-Driven decision making, implementing several algorithms (BFS, DFS , Backtrack, Constraints, Djikstra, MAC, heuristics etc...).

artificial-intelligence astar backtrack bfs constraint dfs dijkstra local-consistency solver university

Last synced: 05 Mar 2025

https://github.com/killpop3770/pathfinders

Visualization of algorithms like BFS, DFS, GBFS, Dijkstra and A_Star(A*)

astar bfs dfs dijkstra gbfs pathfinding visualization

Last synced: 08 Nov 2025

https://github.com/atlergibby/astar3dnavgrid

A Godot 4.2 system for easily creating grids and path finding using AStar3D.

astar astar-pathfinding gdextension godot godot-engine godot-plugin godot4

Last synced: 09 Aug 2025

https://github.com/timothewt/shortestroute

Finds the shortest route between two geographical points using the A* algorithm.

ai artificial-intelligence astar astar-algorithm osmnx python shortest-path-algorithm

Last synced: 12 Mar 2025

https://github.com/erizocosmico/go-pathfinder

Pathfinder on 2D maps with obstacles using A* algorithm.

2d astar golang pathfinding

Last synced: 02 Apr 2025

https://github.com/zabuzard/maglev

Maglev is a library that provides fast and generic solutions for shortest path problems (SPP)

api astar dijkstra landmarks library routing shortest-path-algorithm shortest-path-problem shortest-paths

Last synced: 01 Mar 2025

https://github.com/tenjou/meta-astar

A* pathfinding algorithm implementation

ai astar javascript meta2d pathfinding

Last synced: 09 Oct 2025

https://github.com/toshikinakamura0412/a_star_ros

ROS implementation of A* search algorithm

astar astar-algorithm cpp robotics ros ros-noetic search-algorithm

Last synced: 20 Oct 2025

https://github.com/aaronwalker96/aitrainproblem

Auto routing of artificially intelligent trains using different algorithms

artificial-intelligence astar astar-algorithm astar-pathfinding clojure operator-search planner-search

Last synced: 04 Oct 2025

https://github.com/krislette/navijeff

A desktop application utilizing A* algorithm for showing the most efficient jeepney routes within Northern Metro Manila, made with JavaFX.

astar javafx maps-api routing

Last synced: 07 Apr 2025

https://github.com/alexyzha/astar-visualizer

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

astar astar-algorithm astar-pathfinding astar-search astar-search-algorithm

Last synced: 15 May 2025

https://github.com/ibrahimessakine/micromouse_simulation

This repository provides MATLAB simulations for solving the MicroMouse competition using various algorithms including BFS, DFS, and A*. Explore implementations designed to navigate mazes efficiently, aiming to optimize pathfinding strategies and evaluate their performance in simulated competition environments.

algorithms astar bfs dfs matlab matlab-gui micromouse micromouse-maze-solver simulator

Last synced: 30 Mar 2025

https://github.com/fabienjuif/astar

an A* algorithm in javascript

a algorithm astar game path shortest shortest-path

Last synced: 06 Apr 2025

https://github.com/nwrenger/hadar

The current code of Hunger of Hadar

astar battlesnake hungry

Last synced: 22 Mar 2025

https://github.com/hoonsubin/astar-xcm-tools

Astar Network XCM tools

astar cross-chain polkadot xcm

Last synced: 04 Mar 2025

https://github.com/anthippi/rubik-s-cube-astar

2D κατασκευή και επίλυση του Rubik's Cube με A* (star).

astar astar-algorithm python rubiks-cube rubiks-cube-solver

Last synced: 31 Mar 2025

https://github.com/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.

artificial-intelligence astar astar-algorithm astar-pathfinding astar-search-algorithm block-world computer-science generic-planner heap heuristics n-puzzle planner program python student water-jug-problem

Last synced: 29 Mar 2025