Skip to content

Commit 715df8f

Browse files
Fix Jazzy release by removing boost dependency - bump to 1.3.1 (ros-navigation#4492)
* Update package.xml Signed-off-by: Steve Macenski <[email protected]> * fix Boost build issues and bump to 1.3.1 for jazzy release --------- Signed-off-by: Steve Macenski <[email protected]>
1 parent a6b3de1 commit 715df8f

File tree

44 files changed

+46
-47
lines changed

Some content is hidden

Large Commits have some content hidden by default. Use the searchbox below for content that may be hidden.

44 files changed

+46
-47
lines changed

nav2_amcl/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_amcl</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>
77
<p>
88
amcl is a probabilistic localization system for a robot moving in

nav2_behavior_tree/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_behavior_tree</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Nav2 behavior tree wrappers, nodes, and utilities</description>
77
<maintainer email="[email protected]">Michael Jeronimo</maintainer>
88
<maintainer email="[email protected]">Carlos Orduno</maintainer>

nav2_behavior_tree/src/generate_nav2_tree_nodes_xml.cpp

+2-3
Original file line numberDiff line numberDiff line change
@@ -15,21 +15,20 @@
1515
#include <vector>
1616
#include <string>
1717
#include <fstream>
18-
#include <boost/algorithm/string.hpp>
1918

2019
#include "behaviortree_cpp/behavior_tree.h"
2120
#include "behaviortree_cpp/bt_factory.h"
2221
#include "behaviortree_cpp/utils/shared_library.h"
2322
#include "behaviortree_cpp/xml_parsing.h"
2423

2524
#include "plugins_list.hpp"
25+
#include "nav2_util/string_utils.hpp"
2626

2727
int main()
2828
{
2929
BT::BehaviorTreeFactory factory;
3030

31-
std::vector<std::string> plugins_list;
32-
boost::split(plugins_list, nav2::details::BT_BUILTIN_PLUGINS, boost::is_any_of(";"));
31+
std::vector<std::string> plugins_list = nav2_util::split(nav2::details::BT_BUILTIN_PLUGINS, ';');
3332

3433
for (const auto & plugin : plugins_list) {
3534
std::cout << "Loading: " << plugin << "\n";

nav2_behaviors/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_behaviors</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Nav2 behavior server</description>
77
<maintainer email="[email protected]">Carlos Orduno</maintainer>
88
<maintainer email="[email protected]">Steve Macenski</maintainer>

nav2_bringup/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_bringup</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Bringup scripts and configurations for the Nav2 stack</description>
77
<maintainer email="[email protected]">Michael Jeronimo</maintainer>
88
<maintainer email="[email protected]">Steve Macenski</maintainer>

nav2_bt_navigator/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_bt_navigator</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Nav2 BT Navigator Server</description>
77
<maintainer email="[email protected]">Michael Jeronimo</maintainer>
88
<license>Apache-2.0</license>

nav2_bt_navigator/src/bt_navigator.cpp

+2-2
Original file line numberDiff line numberDiff line change
@@ -18,10 +18,10 @@
1818
#include <string>
1919
#include <utility>
2020
#include <vector>
21-
#include <boost/algorithm/string.hpp>
2221

2322
#include "nav2_util/geometry_utils.hpp"
2423
#include "nav2_util/node_utils.hpp"
24+
#include "nav2_util/string_utils.hpp"
2525
#include "nav2_util/robot_utils.hpp"
2626
#include "nav2_behavior_tree/bt_utils.hpp"
2727

@@ -74,7 +74,7 @@ BtNavigator::on_configure(const rclcpp_lifecycle::State & /*state*/)
7474

7575
// Libraries to pull plugins (BT Nodes) from
7676
std::vector<std::string> plugin_lib_names;
77-
boost::split(plugin_lib_names, nav2::details::BT_BUILTIN_PLUGINS, boost::is_any_of(";"));
77+
plugin_lib_names = nav2_util::split(nav2::details::BT_BUILTIN_PLUGINS, ';');
7878

7979
auto user_defined_plugins = get_parameter("plugin_lib_names").as_string_array();
8080
// append user_defined_plugins to plugin_lib_names

nav2_collision_monitor/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_collision_monitor</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Collision Monitor</description>
77
<maintainer email="[email protected]">Alexey Merzlyakov</maintainer>
88
<maintainer email="[email protected]">Steve Macenski</maintainer>

nav2_common/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_common</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Common support functionality used throughout the navigation 2 stack</description>
77
<maintainer email="[email protected]">Carl Delsey</maintainer>
88
<license>Apache-2.0</license>

nav2_constrained_smoother/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_constrained_smoother</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Ceres constrained smoother</description>
77
<maintainer email="[email protected]">Matej Vargovcik</maintainer>
88
<maintainer email="[email protected]">Steve Macenski</maintainer>

nav2_controller/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_controller</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Controller action interface</description>
77
<maintainer email="[email protected]">Carl Delsey</maintainer>
88
<license>Apache-2.0</license>

nav2_core/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_core</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>A set of headers for plugins core to the Nav2 stack</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<maintainer email="[email protected]">Carl Delsey</maintainer>

nav2_costmap_2d/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format ="3">
44
<name>nav2_costmap_2d</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>
77
This package provides an implementation of a 2D costmap that takes in sensor
88
data from the world, builds a 2D or 3D occupancy grid of the data (depending

nav2_docking/opennav_docking/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>opennav_docking</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>A Task Server for robot charger docking</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<license>Apache-2.0</license>

nav2_docking/opennav_docking_bt/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>opennav_docking_bt</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>A set of BT nodes and XMLs for docking</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<license>Apache-2.0</license>

nav2_docking/opennav_docking_core/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>opennav_docking_core</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>A set of headers for plugins core to the opennav docking framework</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<license>Apache-2.0</license>

nav2_dwb_controller/costmap_queue/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -1,7 +1,7 @@
11
<?xml version="1.0"?>
22
<package format="2">
33
<name>costmap_queue</name>
4-
<version>1.3.0</version>
4+
<version>1.3.1</version>
55
<description>The costmap_queue package</description>
66
<maintainer email="[email protected]">David V. Lu!!</maintainer>
77
<license>BSD-3-Clause</license>

nav2_dwb_controller/dwb_core/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>dwb_core</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>DWB core interfaces package</description>
77
<maintainer email="[email protected]">Carl Delsey</maintainer>
88
<license>BSD-3-Clause</license>

nav2_dwb_controller/dwb_critics/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -1,7 +1,7 @@
11
<?xml version="1.0"?>
22
<package format="2">
33
<name>dwb_critics</name>
4-
<version>1.3.0</version>
4+
<version>1.3.1</version>
55
<description>The dwb_critics package</description>
66
<maintainer email="[email protected]">David V. Lu!!</maintainer>
77
<license>BSD-3-Clause</license>

nav2_dwb_controller/dwb_msgs/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>dwb_msgs</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Message/Service definitions specifically for the dwb_core</description>
77
<maintainer email="[email protected]">David V. Lu!!</maintainer>
88
<license>BSD-3-Clause</license>

nav2_dwb_controller/dwb_plugins/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -1,7 +1,7 @@
11
<?xml version="1.0"?>
22
<package format="2">
33
<name>dwb_plugins</name>
4-
<version>1.3.0</version>
4+
<version>1.3.1</version>
55
<description>
66
Standard implementations of the GoalChecker
77
and TrajectoryGenerators for dwb_core

nav2_dwb_controller/nav2_dwb_controller/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_dwb_controller</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>
77
ROS2 controller (DWB) metapackage
88
</description>

nav2_dwb_controller/nav_2d_msgs/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav_2d_msgs</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.</description>
77
<maintainer email="[email protected]">David V. Lu!!</maintainer>
88
<license>BSD-3-Clause</license>

nav2_dwb_controller/nav_2d_utils/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav_2d_utils</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>A handful of useful utility functions for nav_2d packages.</description>
77
<maintainer email="[email protected]">David V. Lu!!</maintainer>
88
<license>BSD-3-Clause</license>

nav2_graceful_controller/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_graceful_controller</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Graceful motion controller</description>
77
<maintainer email="[email protected]">Alberto Tudela</maintainer>
88
<license>Apache-2.0</license>

nav2_lifecycle_manager/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_lifecycle_manager</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>A controller/manager for the lifecycle nodes of the Navigation 2 system</description>
77
<maintainer email="[email protected]">Michael Jeronimo</maintainer>
88
<license>Apache-2.0</license>

nav2_map_server/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_map_server</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>
77
Refactored map server for ROS2 Navigation
88
</description>

nav2_mppi_controller/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_mppi_controller</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>nav2_mppi_controller</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<maintainer email="[email protected]">Aleksei Budyakov</maintainer>

nav2_msgs/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_msgs</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Messages and service files for the Nav2 stack</description>
77
<maintainer email="[email protected]">Michael Jeronimo</maintainer>
88
<maintainer email="[email protected]">Steve Macenski</maintainer>

nav2_navfn_planner/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_navfn_planner</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Nav2 NavFn planner</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<maintainer email="[email protected]">Carlos Orduno</maintainer>

nav2_planner/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_planner</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Nav2 planner server package</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<license>Apache-2.0</license>

nav2_regulated_pure_pursuit_controller/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_regulated_pure_pursuit_controller</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Regulated Pure Pursuit Controller</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<maintainer email="[email protected]">Shrijit Singh</maintainer>

nav2_rotation_shim_controller/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_rotation_shim_controller</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Rotation Shim Controller</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<license>Apache-2.0</license>

nav2_rviz_plugins/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_rviz_plugins</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Navigation 2 plugins for rviz</description>
77
<maintainer email="[email protected]">Michael Jeronimo</maintainer>
88
<license>Apache-2.0</license>

nav2_simple_commander/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_simple_commander</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>An importable library for writing mobile robot applications in python3</description>
77
<maintainer email="[email protected]">steve</maintainer>
88
<license>Apache-2.0</license>

nav2_smac_planner/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_smac_planner</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Smac global planning plugin: A*, Hybrid-A*, State Lattice</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<license>Apache-2.0</license>

nav2_smoother/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_smoother</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Smoother action interface</description>
77
<maintainer email="[email protected]">Matej Vargovcik</maintainer>
88
<maintainer email="[email protected]">Steve Macenski</maintainer>

nav2_system_tests/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_system_tests</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>A sets of system-level tests for Nav2 usually involving full robot simulation</description>
77
<maintainer email="[email protected]">Carlos Orduno</maintainer>
88
<license>Apache-2.0</license>

nav2_theta_star_planner/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_theta_star_planner</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Theta* Global Planning Plugin</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<maintainer email="[email protected]">Anshumaan Singh</maintainer>

nav2_util/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_util</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Nav2 utilities</description>
77
<maintainer email="[email protected]">Michael Jeronimo</maintainer>
88
<maintainer email="[email protected]">Mohammad Haghighipanah</maintainer>

nav2_velocity_smoother/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<?xml-model href="http://download.ros.org/schema/package_format3.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
33
<package format="3">
44
<name>nav2_velocity_smoother</name>
5-
<version>1.3.0</version>
5+
<version>1.3.1</version>
66
<description>Nav2's Output velocity smoother</description>
77
<maintainer email="[email protected]">Steve Macenski</maintainer>
88
<license>Apache-2.0</license>

0 commit comments

Comments
 (0)