Movatterモバイル変換


[0]ホーム

URL:


Skip to content

Navigation Menu

Sign in
Appearance settings

Search code, repositories, users, issues, pull requests...

Provide feedback

We read every piece of feedback, and take your input very seriously.

Saved searches

Use saved searches to filter your results more quickly

Sign up
Appearance settings

This program will detect frontiers in maps

NotificationsYou must be signed in to change notification settings

Nyanziba/AutoFrontierSearch_ros2-humble

Folders and files

NameName
Last commit message
Last commit date

Latest commit

 

History

4 Commits
 
 
 
 

Repository files navigation

Description

The frontier_exploration package is designed for robotic systems using ROS2. It provides functionality for analyzing map data, detecting frontiers (unexplored areas), and setting goals towards these frontiers. This is particularly useful in autonomous navigation and exploration tasks in unknown environments.

Prerequisites

  • ROS2 Humble
  • Python 3
  • ROS2 packages: nav_msgs, geometry_msgs, action_msgs

Installation and Build

Assuming ROS2 Humble and the required dependencies are already installed:

Clone the package into your ROS2 workspace:

cd ~/ros2_wsgit clone https://github.com/Nyanziba/AutoFrontierSearch_ros2-humble.git

Build the workspace:

cd ~/ros2_wscolcon build --packages-select frontier_exploration

Source the environment and run the frontier_exploration node:

cd ~/ros2_ws/install/setup.bashros2 run frontier_exploration exploration_node

Sample

Terminal1

ros2 launch nav2_bringup navigation_launch.py

Terminal2

ros2 launch slam_toolbox online_async_launch.py

Terminal3

ros2 launch nav2_bringup rviz_launch.py

Terminal4

ros2 launch turtlebot3_gazebo turtlebot3_house.launch.py

Nodes

  • exploration_node
    • The exploration_node analyzes occupancy grid maps and detects frontiers. It then sets goals towards these frontiers for the robot to explore.

Subscribed Topics

  • /map ([nav_msgs/msg/OccupancyGrid])

    • The occupancy grid map from which the node detects frontiers.
  • /odom ([nav_msgs/msg/Odometry]

    • The odometry data of the robot.

Published Topics

  • /goal_pose ([geometry_msgs/msg/PoseStamped](// File: ros2_humble.hpp))
    • The goal pose set towards a detected frontier.

About

This program will detect frontiers in maps

Topics

Resources

Stars

Watchers

Forks

Releases

No releases published

Packages

No packages published

Languages


[8]ページ先頭

©2009-2025 Movatter.jp