navigation2 VS ros2_laser_scan_matcher

Compare navigation2 vs ros2_laser_scan_matcher and see what are their differences.

InfluxDB - Power Real-Time Data Analytics at Scale
Get real-time insights from all types of time series data with InfluxDB. Ingest, query, and analyze billions of data points in real-time with unbounded cardinality.
www.influxdata.com
featured
SaaSHub - Software Alternatives and Reviews
SaaSHub helps you find the best software and product alternatives
www.saashub.com
featured
navigation2 ros2_laser_scan_matcher
8 2
2,103 39
3.9% -
9.4 0.0
6 days ago 10 months ago
C++ C++
GNU General Public License v3.0 or later -
The number of mentions indicates the total number of mentions that we've tracked plus the number of user suggested alternatives.
Stars - the number of stars that a project has on GitHub. Growth - month over month growth in stars.
Activity is a relative number indicating how actively a project is being developed. Recent commits have higher weight than older ones.
For example, an activity of 9.0 indicates that a project is amongst the top 10% of the most actively developed projects that we are tracking.

navigation2

Posts with mentions or reviews of navigation2. We have used some of these posts to build our list of alternatives and similar projects. The last one was on 2022-04-11.
  • Create a global plan between any 2 poses with nav2
    1 project | /r/ROS | 10 Jul 2023
    This line might be your issue according to this github issues post (comment at the very bottom: https://github.com/ros-planning/navigation2/issues/2283)
  • What is your automated ROS2 software testing & simulation workflow?
    1 project | /r/ROS | 2 Mar 2023
    I recently stumbled upon system tests for Nav2, I didn't dive into details but README says that among other things they test robots in sandbox environment, might be useful.
  • Turtlebot3 Refuses to Move in a Straight Line
    3 projects | /r/ROS | 11 Apr 2022
    The tutorial I was using (which comes straight from nav2) says to run ros2 launch nav2_bringup navigation_launch.py . However, when I went to tune Turtlebot3 via the .param file, it did no change whatsoever. This is because, by default, the file uses up this param file that is significantly different than burger.yaml; After changing it the costmap looks completely different. After reading the source code for the .launch file of the Turtlebot3 nav package for galactic and nav2, I've found out that running ros2 launch nav2_bringup navigation_launch.py params_file:=[PATH_TO_BURGER_YAML] works and completely fixes this issue.
  • SLAM Toolbox namespace for ROS
    1 project | /r/ROS | 7 Apr 2022
    I am using the nav2_bringup example (https://github.com/ros-planning/navigation2/blob/main/nav2_bringup/launch/multi_tb3_simulation_launch.py) to launch multiple robots, it works fine. This file launches a file for single robots in different namespaces. This file for single robots is also able to switch from localization to mapping, simply by launching the file with argument slam:=True. I added slam as a launch argument for tb3_simulation_launch.py when launched from multi_tb3_simulation_launch.py and when i start the multirobot file with slam:=True it seems to work partially. ROS topics with the name /robot1/slam_toolbox/feedback,/robot1/slam_toolbox/update and /robot2/slam_toolbox/feedback ,/robot2/slam_toolbox/update get created, but /slam_toolbox/graph_visualization and /slam_toolbox/scan_visualization are only there once and not for every robot. In RVIZ there is no sign of SLAM working.
  • Help with Dynamic Window Approach controller
    1 project | /r/ROS | 4 Mar 2022
    Hey, I am not sure if you can or even want but you could have a look into the C++ DWB planner plugin which is used in the nav2 stack.
  • Approach to using nav2 with multiple robots on network?
    1 project | /r/ROS | 3 Mar 2022
  • ros2: How do I stop colcon test from complaining about linting?
    1 project | /r/ROS | 7 Dec 2021
    I have tried all different kinds of headers in the python script (for instance, I have tried a header format like this), and it still complains about copyright linting. I have tried to remove every reference to linting in my package.xml and CMakeLists.txt but colcon/ament just keeps complaining about linting errors.
  • How do I remove the unix timestamp that comes with RCLCPP_INFO?
    1 project | /r/ROS | 24 Aug 2021

ros2_laser_scan_matcher

Posts with mentions or reviews of ros2_laser_scan_matcher. We have used some of these posts to build our list of alternatives and similar projects.
  • link doesn't display in rviz
    1 project | /r/ROS | 7 Mar 2022
    I was expecting the laser odom node https://github.com/AlexKaravaev/ros2_laser_scan_matcher to publish the tf required to view the robot move in rviz and not more being needed. (tf published is odom->base_link) But obviously no shortcut possible here. 😅
  • move robot on map
    1 project | /r/ROS | 6 Mar 2022
    For odometry I use this node, which can publish odom and a tf: https://github.com/AlexKaravaev/ros2_laser_scan_matcher

What are some alternatives?

When comparing navigation2 and ros2_laser_scan_matcher you can also consider the following projects:

CppRobotics - Header-only C++ library for robotics, control, and path planning algorithms. Work in progress, contributions are welcome!

laser_line_extraction - A ROS package that extracts line segments from LaserScan messages.

dolly - 🤖🐑 It's a sheep, it's a dolly, it's a following robot. Dolly was born to be cloned.

zed-ros2-wrapper - ROS 2 wrapper for the ZED SDK

navigation2_tutorials - Tutorial code referenced in https://navigation.ros.org/

PX4-Autopilot - PX4 Autopilot Software

turtlebot3 - ROS packages for Turtlebot3

gazebo-classic - Gazebo classic. For the latest version, see https://github.com/gazebosim/gz-sim

Fast-DDS - The most complete DDS - Proven: Plenty of success cases. Looking for commercial support? Contact [email protected]

iceoryx - Eclipse iceoryx™ - true zero-copy inter-process-communication

isaac_ros_apriltag - Hardware-accelerated Apriltag detection and pose estimation.

epuck_ros2 - ROS2 node for the e-puck robot and its simulation model