navigation2 icon indicating copy to clipboard operation
navigation2 copied to clipboard

ROS 2 Navigation Framework and System

Results 204 navigation2 issues
Sort by recently updated
recently updated
newest added

Hi, what about having the costmap binary filter (or a new one) capable of setting ros parameters along with publishing on a topic? Some possible use cases: - enabling or...

in progress

## Basic Info | Info | Please fill out this column | | ------ | ----------- | | Ticket(s) this addresses | https://github.com/ros-planning/navigation2/issues/2997 | --- ## Description of contribution in...

``` dwb_msgs::msg::Trajectory2D StandardTrajectoryGenerator::generateTrajectory( const geometry_msgs::msg::Pose2D & start_pose, const nav_2d_msgs::msg::Twist2D & start_vel, const nav_2d_msgs::msg::Twist2D & cmd_vel) { dwb_msgs::msg::Trajectory2D traj; traj.velocity = cmd_vel; // simulate the trajectory geometry_msgs::msg::Pose2D pose = start_pose; nav_2d_msgs::msg::Twist2D...

good first issue

Adjust this logic to not be based on pure proximity anymore, use the vector bisector logic developed for the Route Server to pass nodes looking at edge and distance vectors...

## Feature request Follow up from the discussion in https://github.com/ros-planning/navigation2/pull/3165#discussion_r1060055035 #### Feature description - Currently, we do not show how long did the robot took to complete the entire waypoint...

enhancement

Reopening https://github.com/open-navigation/opennav_docking/pull/50

--- ## Basic Info | Info | Please fill out this column | | ------ | ----------- | | Ticket(s) this addresses | #4496 | | Primary OS tested on...

## Bug report **Required Info:** - Operating System: - ubuntu22.04 - ROS2 Version: - humble & Iron - Version or commit hash: - the latest - DDS implementation: - the...

## Bug report **Required Info:** - Operating System: - Ubuntu 24.04 - ROS2 Version: - Jazzy (binaries) - Version or commit hash: - N/A - DDS implementation: - N/A ####...

--- ## Basic Info | Info | Please fill out this column | | ------ | ----------- | | Ticket(s) this addresses | https://github.com/open-navigation/opennav_coverage/issues/64 https://github.com/ros-navigation/navigation2/pull/4516 | | Does this PR...