#7 Introduce teb_local_planner and its dependencies
Merged 4 years ago by thofmann. Opened 4 years ago by nlimpert.

@@ -0,0 +1,1 @@ 

+ no_debug: true

@@ -0,0 +1,1 @@ 

+ no_debug: true

file added
+1
@@ -0,0 +1,1 @@ 

+ noarch: true

file removed
-2
@@ -1,2 +0,0 @@ 

- patches:

-   - ros-tf.signals2.patch

@@ -1,12 +0,0 @@ 

- diff -ur geometry-release-release-melodic-tf-1.12.0-0/CMakeLists.txt geometry-release-release-melodic-tf-1.12.0-0.signals2/CMakeLists.txt

- --- geometry-release-release-melodic-tf-1.12.0-0/CMakeLists.txt	2018-05-03 05:17:40.000000000 +0200

- +++ geometry-release-release-melodic-tf-1.12.0-0.signals2/CMakeLists.txt	2019-07-23 15:32:48.187297370 +0200

- @@ -15,7 +15,7 @@

-      std_msgs

-      tf2_ros

-  )

- -find_package(Boost REQUIRED COMPONENTS thread signals system)

- +find_package(Boost REQUIRED COMPONENTS thread system)

-  

-  catkin_python_setup()

-  

@@ -1,12 +1,12 @@ 

  Name:           ros-base_local_planner

- Version:        melodic.1.16.4

+ Version:        melodic.1.16.5

  Release:        1%{?dist}

  Summary:        ROS package base_local_planner

  

  License:        BSD

  URL:            http://www.ros.org/

  

- Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/base_local_planner/1.16.4-1.tar.gz#/ros-melodic-base_local_planner-1.16.4-source0.tar.gz

+ Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/base_local_planner/1.16.5-1.tar.gz#/ros-melodic-base_local_planner-1.16.5-source0.tar.gz

  

  

  
@@ -64,9 +64,9 @@ 

  Requires:       ros-melodic-visualization_msgs

  Requires:       ros-melodic-voxel_grid

  

- Provides:  ros-melodic-base_local_planner = 1.16.4-1

- Obsoletes: ros-melodic-base_local_planner < 1.16.4-1

- Obsoletes: ros-kinetic-base_local_planner < 1.16.4-1

+ Provides:  ros-melodic-base_local_planner = 1.16.5-1

+ Obsoletes: ros-melodic-base_local_planner < 1.16.5-1

+ Obsoletes: ros-kinetic-base_local_planner < 1.16.5-1

  

  

  %description
@@ -113,9 +113,9 @@ 

  Requires:       ros-melodic-voxel_grid-devel

  Requires:       ros-melodic-message_runtime-devel

  

- Provides: ros-melodic-base_local_planner-devel = 1.16.4-1

- Obsoletes: ros-melodic-base_local_planner-devel < 1.16.4-1

- Obsoletes: ros-kinetic-base_local_planner-devel < 1.16.4-1

+ Provides: ros-melodic-base_local_planner-devel = 1.16.5-1

+ Obsoletes: ros-melodic-base_local_planner-devel < 1.16.5-1

+ Obsoletes: ros-kinetic-base_local_planner-devel < 1.16.5-1

  

  %description devel

  The %{name}-devel package contains libraries and header files for developing
@@ -222,6 +222,8 @@ 

  

  

  %changelog

+ * Wed Mar 18 2020 Nicolas Limpert - melodic.1.16.5-1

+ - Update to latest release

  * Thu Mar 05 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.4-1

  - Update to latest release

  * Tue Feb 04 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.3-1

file modified
+10 -8
@@ -1,12 +1,12 @@ 

  Name:           ros-costmap_2d

- Version:        melodic.1.16.4

+ Version:        melodic.1.16.5

  Release:        1%{?dist}

  Summary:        ROS package costmap_2d

  

  License:        BSD

  URL:            http://www.ros.org/

  

- Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/costmap_2d/1.16.4-1.tar.gz#/ros-melodic-costmap_2d-1.16.4-source0.tar.gz

+ Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/costmap_2d/1.16.5-1.tar.gz#/ros-melodic-costmap_2d-1.16.5-source0.tar.gz

  

  

  
@@ -66,9 +66,9 @@ 

  Requires:       ros-melodic-visualization_msgs

  Requires:       ros-melodic-voxel_grid

  

- Provides:  ros-melodic-costmap_2d = 1.16.4-1

- Obsoletes: ros-melodic-costmap_2d < 1.16.4-1

- Obsoletes: ros-kinetic-costmap_2d < 1.16.4-1

+ Provides:  ros-melodic-costmap_2d = 1.16.5-1

+ Obsoletes: ros-melodic-costmap_2d < 1.16.5-1

+ Obsoletes: ros-kinetic-costmap_2d < 1.16.5-1

  

  

  %description
@@ -117,9 +117,9 @@ 

  Requires:       ros-melodic-message_runtime-devel

  Requires:       ros-melodic-rosconsole-devel

  

- Provides: ros-melodic-costmap_2d-devel = 1.16.4-1

- Obsoletes: ros-melodic-costmap_2d-devel < 1.16.4-1

- Obsoletes: ros-kinetic-costmap_2d-devel < 1.16.4-1

+ Provides: ros-melodic-costmap_2d-devel = 1.16.5-1

+ Obsoletes: ros-melodic-costmap_2d-devel < 1.16.5-1

+ Obsoletes: ros-kinetic-costmap_2d-devel < 1.16.5-1

  

  %description devel

  The %{name}-devel package contains libraries and header files for developing
@@ -226,6 +226,8 @@ 

  

  

  %changelog

+ * Wed Mar 18 2020 Nicolas Limpert - melodic.1.16.5-1

+ - Update to latest release

  * Thu Mar 05 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.4-1

  - Update to latest release

  * Tue Feb 04 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.3-1

@@ -0,0 +1,175 @@ 

+ Name:           ros-costmap_converter

+ Version:        melodic.0.0.12

+ Release:        1%{?dist}

+ Summary:        ROS package costmap_converter

+ 

+ License:        BSD

+ URL:            http://wiki.ros.org/costmap_converter

+ 

+ Source0:        https://github.com/rst-tu-dortmund/costmap_converter-release/archive/release/melodic/costmap_converter/0.0.12-1.tar.gz#/ros-melodic-costmap_converter-0.0.12-source0.tar.gz

+ 

+ 

+ 

+ # common BRs

+ BuildRequires:  boost-devel

+ BuildRequires:  console-bridge-devel

+ BuildRequires:  gtest-devel

+ BuildRequires:  log4cxx-devel

+ BuildRequires:  python3-devel

+ 

+ BuildRequires:  ros-melodic-catkin-devel

+ BuildRequires:  ros-melodic-costmap_2d-devel

+ BuildRequires:  ros-melodic-cv_bridge-devel

+ BuildRequires:  ros-melodic-dynamic_reconfigure-devel

+ BuildRequires:  ros-melodic-geometry_msgs-devel

+ BuildRequires:  ros-melodic-message_generation-devel

+ BuildRequires:  ros-melodic-message_runtime-devel

+ BuildRequires:  ros-melodic-pluginlib-devel

+ BuildRequires:  ros-melodic-roscpp-devel

+ BuildRequires:  ros-melodic-rostest-devel

+ BuildRequires:  ros-melodic-std_msgs-devel

+ 

+ Requires:       ros-melodic-costmap_2d

+ Requires:       ros-melodic-cv_bridge

+ Requires:       ros-melodic-dynamic_reconfigure

+ Requires:       ros-melodic-geometry_msgs

+ Requires:       ros-melodic-message_runtime

+ Requires:       ros-melodic-pluginlib

+ Requires:       ros-melodic-roscpp

+ Requires:       ros-melodic-std_msgs

+ 

+ Provides:  ros-melodic-costmap_converter = 0.0.12-1

+ Obsoletes: ros-melodic-costmap_converter < 0.0.12-1

+ Obsoletes: ros-kinetic-costmap_converter < 0.0.12-1

+ 

+ 

+ %description

+ A ros package that includes plugins and nodes to convert occupied

+ costmap2d cells to primitive types.

+ 

+ %package        devel

+ Summary:        Development files for %{name}

+ Requires:       %{name}%{?_isa} = %{version}-%{release}

+ Requires:       ros-melodic-catkin-devel

+ Requires:       ros-melodic-message_runtime-devel

+ Requires:       ros-melodic-costmap_2d-devel

+ Requires:       ros-melodic-cv_bridge-devel

+ Requires:       ros-melodic-dynamic_reconfigure-devel

+ Requires:       ros-melodic-geometry_msgs-devel

+ Requires:       ros-melodic-message_generation-devel

+ Requires:       ros-melodic-pluginlib-devel

+ Requires:       ros-melodic-roscpp-devel

+ Requires:       ros-melodic-rostest-devel

+ Requires:       ros-melodic-std_msgs-devel

+ 

+ Provides: ros-melodic-costmap_converter-devel = 0.0.12-1

+ Obsoletes: ros-melodic-costmap_converter-devel < 0.0.12-1

+ Obsoletes: ros-kinetic-costmap_converter-devel < 0.0.12-1

+ 

+ %description devel

+ The %{name}-devel package contains libraries and header files for developing

+ applications that use %{name}.

+ 

+ 

+ 

+ %prep

+ 

+ %setup -c -T

+ tar --strip-components=1 -xf %{SOURCE0}

+ 

+ %build

+ # nothing to do here

+ 

+ 

+ %install

+ 

+ PYTHONUNBUFFERED=1 ; export PYTHONUNBUFFERED

+ 

+ CFLAGS="${CFLAGS:-%optflags}" ; export CFLAGS ; \

+ CXXFLAGS="${CXXFLAGS:-%optflags}" ; export CXXFLAGS ; \

+ FFLAGS="${FFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FFLAGS ; \

+ FCFLAGS="${FCFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FCFLAGS ; \

+ %{?__global_ldflags:LDFLAGS="${LDFLAGS:-%__global_ldflags}" ; export LDFLAGS ;} \

+ 

+ source %{_libdir}/ros/setup.bash

+ 

+ # substitute shebang before install block because we run the local catkin script

+ for f in $(grep -rl python .) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $f

+   touch -r $f.orig $f

+   rm $f.orig

+ done

+ 

+ DESTDIR=%{buildroot} ; export DESTDIR

+ 

+ 

+ catkin_make_isolated \

+   -DCMAKE_BUILD_TYPE=RelWithDebInfo \

+   -DCATKIN_ENABLE_TESTING=OFF \

+   -DPYTHON_VERSION=%{python3_version} \

+   -DPYTHON_VERSION_NODOTS=%{python3_version_nodots} \

+   --source . \

+   --install \

+   --install-space %{_libdir}/ros/ \

+   --pkg costmap_converter

+ 

+ 

+ 

+ 

+ rm -rf %{buildroot}/%{_libdir}/ros/{.catkin,.rosinstall,_setup*,local_setup*,setup*,env.sh}

+ 

+ touch files.list

+ find %{buildroot}/%{_libdir}/ros/{bin,etc,lib64/python*,lib/python*/site-packages,share} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files.list

+ find %{buildroot}/%{_libdir}/ros/lib*/ -mindepth 1 -maxdepth 1 \

+   ! -name pkgconfig ! -name "python*" \

+   | sed "s:%{buildroot}/::" >> files.list

+ 

+ touch files_devel.list

+ find %{buildroot}/%{_libdir}/ros/{include,lib*/pkgconfig} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files_devel.list

+ 

+ find . -maxdepth 1 -type f -iname "*readme*" | sed "s:^:%%doc :" >> files.list

+ find . -maxdepth 1 -type f -iname "*license*" | sed "s:^:%%license :" >> files.list

+ 

+ 

+ 

+ # replace cmake python macro in shebang

+ for file in $(grep -rIl '^#!.*@PYTHON_EXECUTABLE@*$' %{buildroot}) ; do

+   sed -i.orig 's:^#!\s*@PYTHON_EXECUTABLE@\s*:%{__python3}:' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace unversioned python shebang

+ for file in $(grep -rIl '^#!.*python\s*$' %{buildroot}) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace "/usr/bin/env $interpreter" with "/usr/bin/$interpreter"

+ for interpreter in bash sh python2 python3 ; do

+   for file in $(grep -rIl "^#\!.*${interpreter}" %{buildroot}) ; do

+     sed -i.orig "s:^#\!\s*/usr/bin/env\s\+${interpreter}.*:#!/usr/bin/${interpreter}:" $file

+     touch -r $file.orig $file

+     rm $file.orig

+   done

+ done

+ 

+ 

+ echo "This is a package automatically generated with rosfed." >> README_FEDORA

+ echo "See https://pagure.io/ros for more information." >> README_FEDORA

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name} README_FEDORA

+ echo %{_docdir}/%{name} >> files.list

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name}-devel README_FEDORA

+ echo %{_docdir}/%{name}-devel >> files_devel.list

+ 

+ 

+ %files -f files.list

+ %files devel -f files_devel.list

+ 

+ 

+ %changelog

+ * Fri Mar 13 2020 Nicolas Limpert - melodic.0.0.12-1

+ - Initial package

@@ -1,12 +1,12 @@ 

  Name:           ros-dynamic_reconfigure

- Version:        melodic.1.6.0

- Release:        3%{?dist}

+ Version:        melodic.1.6.1

+ Release:        1%{?dist}

  Summary:        ROS package dynamic_reconfigure

  

  License:        BSD

  URL:            http://ros.org/wiki/dynamic_reconfigure

  

- Source0:        https://github.com/ros-gbp/dynamic_reconfigure-release/archive/release/melodic/dynamic_reconfigure/1.6.0-0.tar.gz#/ros-melodic-dynamic_reconfigure-1.6.0-source0.tar.gz

+ Source0:        https://github.com/ros-gbp/dynamic_reconfigure-release/archive/release/melodic/dynamic_reconfigure/1.6.1-1.tar.gz#/ros-melodic-dynamic_reconfigure-1.6.1-source0.tar.gz

  

  

  
@@ -33,15 +33,14 @@ 

  Requires:       ros-melodic-rosservice

  Requires:       ros-melodic-std_msgs

  

- Provides:  ros-melodic-dynamic_reconfigure = 1.6.0-3

- Obsoletes: ros-melodic-dynamic_reconfigure < 1.6.0-3

- Obsoletes: ros-kinetic-dynamic_reconfigure < 1.6.0-3

+ Provides:  ros-melodic-dynamic_reconfigure = 1.6.1-1

+ Obsoletes: ros-melodic-dynamic_reconfigure < 1.6.1-1

+ Obsoletes: ros-kinetic-dynamic_reconfigure < 1.6.1-1

  

  

  %description

- This unary stack contains the dynamic_reconfigure package which

- provides a means to change node parameters at any time without having

- to restart the node.

+ The dynamic_reconfigure package provides a means to update parameters

+ at runtime without having to restart the node.

  

  %package        devel

  Summary:        Development files for %{name}
@@ -59,9 +58,9 @@ 

  Requires:       ros-melodic-rospy-devel

  Requires:       ros-melodic-rosservice-devel

  

- Provides: ros-melodic-dynamic_reconfigure-devel = 1.6.0-3

- Obsoletes: ros-melodic-dynamic_reconfigure-devel < 1.6.0-3

- Obsoletes: ros-kinetic-dynamic_reconfigure-devel < 1.6.0-3

+ Provides: ros-melodic-dynamic_reconfigure-devel = 1.6.1-1

+ Obsoletes: ros-melodic-dynamic_reconfigure-devel < 1.6.1-1

+ Obsoletes: ros-kinetic-dynamic_reconfigure-devel < 1.6.1-1

  

  %description devel

  The %{name}-devel package contains libraries and header files for developing
@@ -168,6 +167,8 @@ 

  

  

  %changelog

+ * Wed Mar 18 2020 Nicolas Limpert - melodic.1.6.1-1

+ - Update to latest release

  * Mon Jul 22 2019 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.6.0-3

  - Remove obsolete python2 dependencies

  * Sun Jul 21 2019 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.6.0-2

file modified
+10 -8
@@ -1,12 +1,12 @@ 

  Name:           ros-map_server

- Version:        melodic.1.16.4

+ Version:        melodic.1.16.5

  Release:        1%{?dist}

  Summary:        ROS package map_server

  

  License:        BSD

  URL:            http://www.ros.org/

  

- Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/map_server/1.16.4-1.tar.gz#/ros-melodic-map_server-1.16.4-source0.tar.gz

+ Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/map_server/1.16.5-1.tar.gz#/ros-melodic-map_server-1.16.5-source0.tar.gz

  

  

  
@@ -33,9 +33,9 @@ 

  Requires:       ros-melodic-roscpp

  Requires:       ros-melodic-tf2

  

- Provides:  ros-melodic-map_server = 1.16.4-1

- Obsoletes: ros-melodic-map_server < 1.16.4-1

- Obsoletes: ros-kinetic-map_server < 1.16.4-1

+ Provides:  ros-melodic-map_server = 1.16.5-1

+ Obsoletes: ros-melodic-map_server < 1.16.5-1

+ Obsoletes: ros-kinetic-map_server < 1.16.5-1

  

  

  %description
@@ -56,9 +56,9 @@ 

  Requires:       ros-melodic-rosunit-devel

  Requires:       ros-melodic-tf2-devel

  

- Provides: ros-melodic-map_server-devel = 1.16.4-1

- Obsoletes: ros-melodic-map_server-devel < 1.16.4-1

- Obsoletes: ros-kinetic-map_server-devel < 1.16.4-1

+ Provides: ros-melodic-map_server-devel = 1.16.5-1

+ Obsoletes: ros-melodic-map_server-devel < 1.16.5-1

+ Obsoletes: ros-kinetic-map_server-devel < 1.16.5-1

  

  %description devel

  The %{name}-devel package contains libraries and header files for developing
@@ -165,6 +165,8 @@ 

  

  

  %changelog

+ * Wed Mar 18 2020 Nicolas Limpert - melodic.1.16.5-1

+ - Update to latest release

  * Thu Mar 05 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.4-1

  - Update to latest release

  * Tue Feb 04 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.3-1

@@ -0,0 +1,162 @@ 

+ Name:           ros-mbf_abstract_core

+ Version:        melodic.0.2.5

+ Release:        1%{?dist}

+ Summary:        ROS package mbf_abstract_core

+ 

+ License:        BSD

+ URL:            http://www.ros.org/

+ 

+ Source0:        https://github.com/uos-gbp/move_base_flex-release/archive/release/melodic/mbf_abstract_core/0.2.5-1.tar.gz#/ros-melodic-mbf_abstract_core-0.2.5-source0.tar.gz

+ 

+ 

+ 

+ # common BRs

+ BuildRequires:  boost-devel

+ BuildRequires:  console-bridge-devel

+ BuildRequires:  gtest-devel

+ BuildRequires:  log4cxx-devel

+ BuildRequires:  python3-devel

+ 

+ BuildRequires:  ros-melodic-catkin-devel

+ BuildRequires:  ros-melodic-geometry_msgs-devel

+ BuildRequires:  ros-melodic-std_msgs-devel

+ 

+ Requires:       ros-melodic-geometry_msgs

+ Requires:       ros-melodic-std_msgs

+ 

+ Provides:  ros-melodic-mbf_abstract_core = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_abstract_core < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_abstract_core < 0.2.5-1

+ 

+ 

+ %description

+ This package provides common interfaces for navigation specific robot

+ actions. It contains the AbstractPlanner, AbstractController and

+ AbstractRecovery plugin interfaces. This interfaces have to be

+ implemented by the plugins to make the plugin available for Move Base

+ Flex. The abstract classes provides a meaningful interface enabling

+ the planners, controllers and recovery behaviors to return

+ information, e.g. why something went wrong. Derivided interfaces can,

+ for example, provide methods to initialize the planner, controller or

+ recovery with map representations like costmap_2d, grid_map or other

+ representations.

+ 

+ %package        devel

+ Summary:        Development files for %{name}

+ Requires:       %{name}%{?_isa} = %{version}-%{release}

+ Requires:       ros-melodic-catkin-devel

+ Requires:       ros-melodic-geometry_msgs-devel

+ Requires:       ros-melodic-std_msgs-devel

+ 

+ Provides: ros-melodic-mbf_abstract_core-devel = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_abstract_core-devel < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_abstract_core-devel < 0.2.5-1

+ 

+ %description devel

+ The %{name}-devel package contains libraries and header files for developing

+ applications that use %{name}.

+ 

+ 

+ %global debug_package %{nil}

+ 

+ %prep

+ 

+ %setup -c -T

+ tar --strip-components=1 -xf %{SOURCE0}

+ 

+ %build

+ # nothing to do here

+ 

+ 

+ %install

+ 

+ PYTHONUNBUFFERED=1 ; export PYTHONUNBUFFERED

+ 

+ CFLAGS="${CFLAGS:-%optflags}" ; export CFLAGS ; \

+ CXXFLAGS="${CXXFLAGS:-%optflags}" ; export CXXFLAGS ; \

+ FFLAGS="${FFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FFLAGS ; \

+ FCFLAGS="${FCFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FCFLAGS ; \

+ %{?__global_ldflags:LDFLAGS="${LDFLAGS:-%__global_ldflags}" ; export LDFLAGS ;} \

+ 

+ source %{_libdir}/ros/setup.bash

+ 

+ # substitute shebang before install block because we run the local catkin script

+ for f in $(grep -rl python .) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $f

+   touch -r $f.orig $f

+   rm $f.orig

+ done

+ 

+ DESTDIR=%{buildroot} ; export DESTDIR

+ 

+ 

+ catkin_make_isolated \

+   -DCMAKE_BUILD_TYPE=RelWithDebInfo \

+   -DCATKIN_ENABLE_TESTING=OFF \

+   -DPYTHON_VERSION=%{python3_version} \

+   -DPYTHON_VERSION_NODOTS=%{python3_version_nodots} \

+   --source . \

+   --install \

+   --install-space %{_libdir}/ros/ \

+   --pkg mbf_abstract_core

+ 

+ 

+ 

+ 

+ rm -rf %{buildroot}/%{_libdir}/ros/{.catkin,.rosinstall,_setup*,local_setup*,setup*,env.sh}

+ 

+ touch files.list

+ find %{buildroot}/%{_libdir}/ros/{bin,etc,lib64/python*,lib/python*/site-packages,share} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files.list

+ find %{buildroot}/%{_libdir}/ros/lib*/ -mindepth 1 -maxdepth 1 \

+   ! -name pkgconfig ! -name "python*" \

+   | sed "s:%{buildroot}/::" >> files.list

+ 

+ touch files_devel.list

+ find %{buildroot}/%{_libdir}/ros/{include,lib*/pkgconfig} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files_devel.list

+ 

+ find . -maxdepth 1 -type f -iname "*readme*" | sed "s:^:%%doc :" >> files.list

+ find . -maxdepth 1 -type f -iname "*license*" | sed "s:^:%%license :" >> files.list

+ 

+ 

+ 

+ # replace cmake python macro in shebang

+ for file in $(grep -rIl '^#!.*@PYTHON_EXECUTABLE@*$' %{buildroot}) ; do

+   sed -i.orig 's:^#!\s*@PYTHON_EXECUTABLE@\s*:%{__python3}:' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace unversioned python shebang

+ for file in $(grep -rIl '^#!.*python\s*$' %{buildroot}) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace "/usr/bin/env $interpreter" with "/usr/bin/$interpreter"

+ for interpreter in bash sh python2 python3 ; do

+   for file in $(grep -rIl "^#\!.*${interpreter}" %{buildroot}) ; do

+     sed -i.orig "s:^#\!\s*/usr/bin/env\s\+${interpreter}.*:#!/usr/bin/${interpreter}:" $file

+     touch -r $file.orig $file

+     rm $file.orig

+   done

+ done

+ 

+ 

+ echo "This is a package automatically generated with rosfed." >> README_FEDORA

+ echo "See https://pagure.io/ros for more information." >> README_FEDORA

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name} README_FEDORA

+ echo %{_docdir}/%{name} >> files.list

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name}-devel README_FEDORA

+ echo %{_docdir}/%{name}-devel >> files_devel.list

+ 

+ 

+ %files -f files.list

+ %files devel -f files_devel.list

+ 

+ 

+ %changelog

+ * Fri Mar 13 2020 Nicolas Limpert - melodic.0.2.5-1

+ - Initial package

@@ -0,0 +1,174 @@ 

+ Name:           ros-mbf_costmap_core

+ Version:        melodic.0.2.5

+ Release:        1%{?dist}

+ Summary:        ROS package mbf_costmap_core

+ 

+ License:        BSD

+ URL:            http://www.ros.org/

+ 

+ Source0:        https://github.com/uos-gbp/move_base_flex-release/archive/release/melodic/mbf_costmap_core/0.2.5-1.tar.gz#/ros-melodic-mbf_costmap_core-0.2.5-source0.tar.gz

+ 

+ 

+ 

+ # common BRs

+ BuildRequires:  boost-devel

+ BuildRequires:  console-bridge-devel

+ BuildRequires:  gtest-devel

+ BuildRequires:  log4cxx-devel

+ BuildRequires:  python3-devel

+ 

+ BuildRequires:  ros-melodic-catkin-devel

+ BuildRequires:  ros-melodic-costmap_2d-devel

+ BuildRequires:  ros-melodic-geometry_msgs-devel

+ BuildRequires:  ros-melodic-mbf_abstract_core-devel

+ BuildRequires:  ros-melodic-mbf_utility-devel

+ BuildRequires:  ros-melodic-nav_core-devel

+ BuildRequires:  ros-melodic-std_msgs-devel

+ BuildRequires:  ros-melodic-tf-devel

+ 

+ Requires:       ros-melodic-costmap_2d

+ Requires:       ros-melodic-geometry_msgs

+ Requires:       ros-melodic-mbf_abstract_core

+ Requires:       ros-melodic-mbf_utility

+ Requires:       ros-melodic-nav_core

+ Requires:       ros-melodic-std_msgs

+ Requires:       ros-melodic-tf

+ 

+ Provides:  ros-melodic-mbf_costmap_core = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_costmap_core < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_costmap_core < 0.2.5-1

+ 

+ 

+ %description

+ This package provides common interfaces for navigation specific robot

+ actions. It contains the CostmapPlanner, CostmapController and

+ CostmapRecovery interfaces. The interfaces have to be implemented by

+ the plugins to make them available for Move Base Flex using the

+ mbf_costmap_nav navigation implementation. That implementation

+ inherits the mbf_abstract_nav implementation and binds the system to a

+ local and a global costmap.

+ 

+ %package        devel

+ Summary:        Development files for %{name}

+ Requires:       %{name}%{?_isa} = %{version}-%{release}

+ Requires:       ros-melodic-catkin-devel

+ Requires:       ros-melodic-costmap_2d-devel

+ Requires:       ros-melodic-geometry_msgs-devel

+ Requires:       ros-melodic-mbf_abstract_core-devel

+ Requires:       ros-melodic-mbf_utility-devel

+ Requires:       ros-melodic-nav_core-devel

+ Requires:       ros-melodic-std_msgs-devel

+ Requires:       ros-melodic-tf-devel

+ 

+ Provides: ros-melodic-mbf_costmap_core-devel = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_costmap_core-devel < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_costmap_core-devel < 0.2.5-1

+ 

+ %description devel

+ The %{name}-devel package contains libraries and header files for developing

+ applications that use %{name}.

+ 

+ 

+ %global debug_package %{nil}

+ 

+ %prep

+ 

+ %setup -c -T

+ tar --strip-components=1 -xf %{SOURCE0}

+ 

+ %build

+ # nothing to do here

+ 

+ 

+ %install

+ 

+ PYTHONUNBUFFERED=1 ; export PYTHONUNBUFFERED

+ 

+ CFLAGS="${CFLAGS:-%optflags}" ; export CFLAGS ; \

+ CXXFLAGS="${CXXFLAGS:-%optflags}" ; export CXXFLAGS ; \

+ FFLAGS="${FFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FFLAGS ; \

+ FCFLAGS="${FCFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FCFLAGS ; \

+ %{?__global_ldflags:LDFLAGS="${LDFLAGS:-%__global_ldflags}" ; export LDFLAGS ;} \

+ 

+ source %{_libdir}/ros/setup.bash

+ 

+ # substitute shebang before install block because we run the local catkin script

+ for f in $(grep -rl python .) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $f

+   touch -r $f.orig $f

+   rm $f.orig

+ done

+ 

+ DESTDIR=%{buildroot} ; export DESTDIR

+ 

+ 

+ catkin_make_isolated \

+   -DCMAKE_BUILD_TYPE=RelWithDebInfo \

+   -DCATKIN_ENABLE_TESTING=OFF \

+   -DPYTHON_VERSION=%{python3_version} \

+   -DPYTHON_VERSION_NODOTS=%{python3_version_nodots} \

+   --source . \

+   --install \

+   --install-space %{_libdir}/ros/ \

+   --pkg mbf_costmap_core

+ 

+ 

+ 

+ 

+ rm -rf %{buildroot}/%{_libdir}/ros/{.catkin,.rosinstall,_setup*,local_setup*,setup*,env.sh}

+ 

+ touch files.list

+ find %{buildroot}/%{_libdir}/ros/{bin,etc,lib64/python*,lib/python*/site-packages,share} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files.list

+ find %{buildroot}/%{_libdir}/ros/lib*/ -mindepth 1 -maxdepth 1 \

+   ! -name pkgconfig ! -name "python*" \

+   | sed "s:%{buildroot}/::" >> files.list

+ 

+ touch files_devel.list

+ find %{buildroot}/%{_libdir}/ros/{include,lib*/pkgconfig} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files_devel.list

+ 

+ find . -maxdepth 1 -type f -iname "*readme*" | sed "s:^:%%doc :" >> files.list

+ find . -maxdepth 1 -type f -iname "*license*" | sed "s:^:%%license :" >> files.list

+ 

+ 

+ 

+ # replace cmake python macro in shebang

+ for file in $(grep -rIl '^#!.*@PYTHON_EXECUTABLE@*$' %{buildroot}) ; do

+   sed -i.orig 's:^#!\s*@PYTHON_EXECUTABLE@\s*:%{__python3}:' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace unversioned python shebang

+ for file in $(grep -rIl '^#!.*python\s*$' %{buildroot}) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace "/usr/bin/env $interpreter" with "/usr/bin/$interpreter"

+ for interpreter in bash sh python2 python3 ; do

+   for file in $(grep -rIl "^#\!.*${interpreter}" %{buildroot}) ; do

+     sed -i.orig "s:^#\!\s*/usr/bin/env\s\+${interpreter}.*:#!/usr/bin/${interpreter}:" $file

+     touch -r $file.orig $file

+     rm $file.orig

+   done

+ done

+ 

+ 

+ echo "This is a package automatically generated with rosfed." >> README_FEDORA

+ echo "See https://pagure.io/ros for more information." >> README_FEDORA

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name} README_FEDORA

+ echo %{_docdir}/%{name} >> files.list

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name}-devel README_FEDORA

+ echo %{_docdir}/%{name}-devel >> files_devel.list

+ 

+ 

+ %files -f files.list

+ %files devel -f files_devel.list

+ 

+ 

+ %changelog

+ * Fri Mar 13 2020 Nicolas Limpert - melodic.0.2.5-1

+ - Initial package

@@ -0,0 +1,168 @@ 

+ Name:           ros-mbf_msgs

+ Version:        melodic.0.2.5

+ Release:        1%{?dist}

+ Summary:        ROS package mbf_msgs

+ 

+ License:        3-Clause BSD

+ URL:            http://www.ros.org/

+ 

+ Source0:        https://github.com/uos-gbp/move_base_flex-release/archive/release/melodic/mbf_msgs/0.2.5-1.tar.gz#/ros-melodic-mbf_msgs-0.2.5-source0.tar.gz

+ 

+ 

+ BuildArch: noarch

+ 

+ # common BRs

+ BuildRequires:  boost-devel

+ BuildRequires:  console-bridge-devel

+ BuildRequires:  gtest-devel

+ BuildRequires:  log4cxx-devel

+ BuildRequires:  python3-devel

+ 

+ BuildRequires:  ros-melodic-actionlib_msgs-devel

+ BuildRequires:  ros-melodic-catkin-devel

+ BuildRequires:  ros-melodic-genmsg-devel

+ BuildRequires:  ros-melodic-geometry_msgs-devel

+ BuildRequires:  ros-melodic-message_generation-devel

+ BuildRequires:  ros-melodic-message_runtime-devel

+ BuildRequires:  ros-melodic-nav_msgs-devel

+ BuildRequires:  ros-melodic-std_msgs-devel

+ 

+ Requires:       ros-melodic-actionlib_msgs

+ Requires:       ros-melodic-geometry_msgs

+ Requires:       ros-melodic-message_runtime

+ Requires:       ros-melodic-nav_msgs

+ Requires:       ros-melodic-std_msgs

+ 

+ Provides:  ros-melodic-mbf_msgs = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_msgs < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_msgs < 0.2.5-1

+ 

+ 

+ %description

+ The move_base_flex messages package providing the action definition

+ files for the action GetPath, ExePath, Recovery and MoveBase. The

+ action servers providing these action are implemented in

+ 

+ %package        devel

+ Summary:        Development files for %{name}

+ Requires:       %{name} = %{version}-%{release}

+ Requires:       ros-melodic-catkin-devel

+ Requires:       ros-melodic-actionlib_msgs-devel

+ Requires:       ros-melodic-genmsg-devel

+ Requires:       ros-melodic-geometry_msgs-devel

+ Requires:       ros-melodic-message_generation-devel

+ Requires:       ros-melodic-message_runtime-devel

+ Requires:       ros-melodic-nav_msgs-devel

+ Requires:       ros-melodic-std_msgs-devel

+ 

+ Provides: ros-melodic-mbf_msgs-devel = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_msgs-devel < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_msgs-devel < 0.2.5-1

+ 

+ %description devel

+ The %{name}-devel package contains libraries and header files for developing

+ applications that use %{name}.

+ 

+ 

+ 

+ %prep

+ 

+ %setup -c -T

+ tar --strip-components=1 -xf %{SOURCE0}

+ 

+ %build

+ # nothing to do here

+ 

+ 

+ %install

+ 

+ PYTHONUNBUFFERED=1 ; export PYTHONUNBUFFERED

+ 

+ CFLAGS="${CFLAGS:-%optflags}" ; export CFLAGS ; \

+ CXXFLAGS="${CXXFLAGS:-%optflags}" ; export CXXFLAGS ; \

+ FFLAGS="${FFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FFLAGS ; \

+ FCFLAGS="${FCFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FCFLAGS ; \

+ %{?__global_ldflags:LDFLAGS="${LDFLAGS:-%__global_ldflags}" ; export LDFLAGS ;} \

+ 

+ source %{_libdir}/ros/setup.bash

+ 

+ # substitute shebang before install block because we run the local catkin script

+ for f in $(grep -rl python .) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $f

+   touch -r $f.orig $f

+   rm $f.orig

+ done

+ 

+ DESTDIR=%{buildroot} ; export DESTDIR

+ 

+ 

+ catkin_make_isolated \

+   -DCMAKE_BUILD_TYPE=RelWithDebInfo \

+   -DCATKIN_ENABLE_TESTING=OFF \

+   -DPYTHON_VERSION=%{python3_version} \

+   -DPYTHON_VERSION_NODOTS=%{python3_version_nodots} \

+   --source . \

+   --install \

+   --install-space %{_libdir}/ros/ \

+   --pkg mbf_msgs

+ 

+ 

+ 

+ 

+ rm -rf %{buildroot}/%{_libdir}/ros/{.catkin,.rosinstall,_setup*,local_setup*,setup*,env.sh}

+ 

+ touch files.list

+ find %{buildroot}/%{_libdir}/ros/{bin,etc,lib64/python*,lib/python*/site-packages,share} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files.list

+ find %{buildroot}/%{_libdir}/ros/lib*/ -mindepth 1 -maxdepth 1 \

+   ! -name pkgconfig ! -name "python*" \

+   | sed "s:%{buildroot}/::" >> files.list

+ 

+ touch files_devel.list

+ find %{buildroot}/%{_libdir}/ros/{include,lib*/pkgconfig} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files_devel.list

+ 

+ find . -maxdepth 1 -type f -iname "*readme*" | sed "s:^:%%doc :" >> files.list

+ find . -maxdepth 1 -type f -iname "*license*" | sed "s:^:%%license :" >> files.list

+ 

+ 

+ 

+ # replace cmake python macro in shebang

+ for file in $(grep -rIl '^#!.*@PYTHON_EXECUTABLE@*$' %{buildroot}) ; do

+   sed -i.orig 's:^#!\s*@PYTHON_EXECUTABLE@\s*:%{__python3}:' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace unversioned python shebang

+ for file in $(grep -rIl '^#!.*python\s*$' %{buildroot}) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace "/usr/bin/env $interpreter" with "/usr/bin/$interpreter"

+ for interpreter in bash sh python2 python3 ; do

+   for file in $(grep -rIl "^#\!.*${interpreter}" %{buildroot}) ; do

+     sed -i.orig "s:^#\!\s*/usr/bin/env\s\+${interpreter}.*:#!/usr/bin/${interpreter}:" $file

+     touch -r $file.orig $file

+     rm $file.orig

+   done

+ done

+ 

+ 

+ echo "This is a package automatically generated with rosfed." >> README_FEDORA

+ echo "See https://pagure.io/ros for more information." >> README_FEDORA

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name} README_FEDORA

+ echo %{_docdir}/%{name} >> files.list

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name}-devel README_FEDORA

+ echo %{_docdir}/%{name}-devel >> files_devel.list

+ 

+ 

+ %files -f files.list

+ %files devel -f files_devel.list

+ 

+ 

+ %changelog

+ * Fri Mar 13 2020 Nicolas Limpert - melodic.0.2.5-1

+ - Initial package

@@ -0,0 +1,164 @@ 

+ Name:           ros-mbf_utility

+ Version:        melodic.0.2.5

+ Release:        1%{?dist}

+ Summary:        ROS package mbf_utility

+ 

+ License:        BSD

+ URL:            http://wiki.ros.org/move_base_flex/mbf_utility

+ 

+ Source0:        https://github.com/uos-gbp/move_base_flex-release/archive/release/melodic/mbf_utility/0.2.5-1.tar.gz#/ros-melodic-mbf_utility-0.2.5-source0.tar.gz

+ 

+ 

+ 

+ # common BRs

+ BuildRequires:  boost-devel

+ BuildRequires:  console-bridge-devel

+ BuildRequires:  gtest-devel

+ BuildRequires:  log4cxx-devel

+ BuildRequires:  python3-devel

+ 

+ BuildRequires:  ros-melodic-catkin-devel

+ BuildRequires:  ros-melodic-geometry_msgs-devel

+ BuildRequires:  ros-melodic-roscpp-devel

+ BuildRequires:  ros-melodic-tf-devel

+ BuildRequires:  ros-melodic-tf2-devel

+ BuildRequires:  ros-melodic-tf2_geometry_msgs-devel

+ BuildRequires:  ros-melodic-tf2_ros-devel

+ 

+ Requires:       ros-melodic-geometry_msgs

+ Requires:       ros-melodic-roscpp

+ Requires:       ros-melodic-tf

+ Requires:       ros-melodic-tf2

+ Requires:       ros-melodic-tf2_geometry_msgs

+ Requires:       ros-melodic-tf2_ros

+ 

+ Provides:  ros-melodic-mbf_utility = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_utility < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_utility < 0.2.5-1

+ 

+ 

+ %description

+ The mbf_utility package

+ 

+ %package        devel

+ Summary:        Development files for %{name}

+ Requires:       %{name}%{?_isa} = %{version}-%{release}

+ Requires:       ros-melodic-catkin-devel

+ Requires:       ros-melodic-geometry_msgs-devel

+ Requires:       ros-melodic-roscpp-devel

+ Requires:       ros-melodic-tf-devel

+ Requires:       ros-melodic-tf2-devel

+ Requires:       ros-melodic-tf2_geometry_msgs-devel

+ Requires:       ros-melodic-tf2_ros-devel

+ 

+ Provides: ros-melodic-mbf_utility-devel = 0.2.5-1

+ Obsoletes: ros-melodic-mbf_utility-devel < 0.2.5-1

+ Obsoletes: ros-kinetic-mbf_utility-devel < 0.2.5-1

+ 

+ %description devel

+ The %{name}-devel package contains libraries and header files for developing

+ applications that use %{name}.

+ 

+ 

+ 

+ %prep

+ 

+ %setup -c -T

+ tar --strip-components=1 -xf %{SOURCE0}

+ 

+ %build

+ # nothing to do here

+ 

+ 

+ %install

+ 

+ PYTHONUNBUFFERED=1 ; export PYTHONUNBUFFERED

+ 

+ CFLAGS="${CFLAGS:-%optflags}" ; export CFLAGS ; \

+ CXXFLAGS="${CXXFLAGS:-%optflags}" ; export CXXFLAGS ; \

+ FFLAGS="${FFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FFLAGS ; \

+ FCFLAGS="${FCFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FCFLAGS ; \

+ %{?__global_ldflags:LDFLAGS="${LDFLAGS:-%__global_ldflags}" ; export LDFLAGS ;} \

+ 

+ source %{_libdir}/ros/setup.bash

+ 

+ # substitute shebang before install block because we run the local catkin script

+ for f in $(grep -rl python .) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $f

+   touch -r $f.orig $f

+   rm $f.orig

+ done

+ 

+ DESTDIR=%{buildroot} ; export DESTDIR

+ 

+ 

+ catkin_make_isolated \

+   -DCMAKE_BUILD_TYPE=RelWithDebInfo \

+   -DCATKIN_ENABLE_TESTING=OFF \

+   -DPYTHON_VERSION=%{python3_version} \

+   -DPYTHON_VERSION_NODOTS=%{python3_version_nodots} \

+   --source . \

+   --install \

+   --install-space %{_libdir}/ros/ \

+   --pkg mbf_utility

+ 

+ 

+ 

+ 

+ rm -rf %{buildroot}/%{_libdir}/ros/{.catkin,.rosinstall,_setup*,local_setup*,setup*,env.sh}

+ 

+ touch files.list

+ find %{buildroot}/%{_libdir}/ros/{bin,etc,lib64/python*,lib/python*/site-packages,share} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files.list

+ find %{buildroot}/%{_libdir}/ros/lib*/ -mindepth 1 -maxdepth 1 \

+   ! -name pkgconfig ! -name "python*" \

+   | sed "s:%{buildroot}/::" >> files.list

+ 

+ touch files_devel.list

+ find %{buildroot}/%{_libdir}/ros/{include,lib*/pkgconfig} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files_devel.list

+ 

+ find . -maxdepth 1 -type f -iname "*readme*" | sed "s:^:%%doc :" >> files.list

+ find . -maxdepth 1 -type f -iname "*license*" | sed "s:^:%%license :" >> files.list

+ 

+ 

+ 

+ # replace cmake python macro in shebang

+ for file in $(grep -rIl '^#!.*@PYTHON_EXECUTABLE@*$' %{buildroot}) ; do

+   sed -i.orig 's:^#!\s*@PYTHON_EXECUTABLE@\s*:%{__python3}:' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace unversioned python shebang

+ for file in $(grep -rIl '^#!.*python\s*$' %{buildroot}) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace "/usr/bin/env $interpreter" with "/usr/bin/$interpreter"

+ for interpreter in bash sh python2 python3 ; do

+   for file in $(grep -rIl "^#\!.*${interpreter}" %{buildroot}) ; do

+     sed -i.orig "s:^#\!\s*/usr/bin/env\s\+${interpreter}.*:#!/usr/bin/${interpreter}:" $file

+     touch -r $file.orig $file

+     rm $file.orig

+   done

+ done

+ 

+ 

+ echo "This is a package automatically generated with rosfed." >> README_FEDORA

+ echo "See https://pagure.io/ros for more information." >> README_FEDORA

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name} README_FEDORA

+ echo %{_docdir}/%{name} >> files.list

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name}-devel README_FEDORA

+ echo %{_docdir}/%{name}-devel >> files_devel.list

+ 

+ 

+ %files -f files.list

+ %files devel -f files_devel.list

+ 

+ 

+ %changelog

+ * Fri Mar 13 2020 Nicolas Limpert - melodic.0.2.5-1

+ - Initial package

file modified
+10 -8
@@ -1,12 +1,12 @@ 

  Name:           ros-nav_core

- Version:        melodic.1.16.4

+ Version:        melodic.1.16.5

  Release:        1%{?dist}

  Summary:        ROS package nav_core

  

  License:        BSD

  URL:            http://www.ros.org/

  

- Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/nav_core/1.16.4-1.tar.gz#/ros-melodic-nav_core-1.16.4-source0.tar.gz

+ Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/nav_core/1.16.5-1.tar.gz#/ros-melodic-nav_core-1.16.5-source0.tar.gz

  

  

  BuildArch: noarch
@@ -30,9 +30,9 @@ 

  Requires:       ros-melodic-std_msgs

  Requires:       ros-melodic-tf2_ros

  

- Provides:  ros-melodic-nav_core = 1.16.4-1

- Obsoletes: ros-melodic-nav_core < 1.16.4-1

- Obsoletes: ros-kinetic-nav_core < 1.16.4-1

+ Provides:  ros-melodic-nav_core = 1.16.5-1

+ Obsoletes: ros-melodic-nav_core < 1.16.5-1

+ Obsoletes: ros-kinetic-nav_core < 1.16.5-1

  

  

  %description
@@ -52,9 +52,9 @@ 

  Requires:       ros-melodic-std_msgs-devel

  Requires:       ros-melodic-tf2_ros-devel

  

- Provides: ros-melodic-nav_core-devel = 1.16.4-1

- Obsoletes: ros-melodic-nav_core-devel < 1.16.4-1

- Obsoletes: ros-kinetic-nav_core-devel < 1.16.4-1

+ Provides: ros-melodic-nav_core-devel = 1.16.5-1

+ Obsoletes: ros-melodic-nav_core-devel < 1.16.5-1

+ Obsoletes: ros-kinetic-nav_core-devel < 1.16.5-1

  

  %description devel

  The %{name}-devel package contains libraries and header files for developing
@@ -161,6 +161,8 @@ 

  

  

  %changelog

+ * Wed Mar 18 2020 Nicolas Limpert - melodic.1.16.5-1

+ - Update to latest release

  * Thu Mar 05 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.4-1

  - Update to latest release

  * Tue Feb 04 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.3-1

@@ -0,0 +1,212 @@ 

+ Name:           ros-teb_local_planner

+ Version:        melodic.0.8.4

+ Release:        1%{?dist}

+ Summary:        ROS package teb_local_planner

+ 

+ License:        BSD

+ URL:            http://wiki.ros.org/teb_local_planner

+ 

+ Source0:        https://github.com/rst-tu-dortmund/teb_local_planner-release/archive/release/melodic/teb_local_planner/0.8.4-1.tar.gz#/ros-melodic-teb_local_planner-0.8.4-source0.tar.gz

+ 

+ 

+ 

+ # common BRs

+ BuildRequires:  boost-devel

+ BuildRequires:  console-bridge-devel

+ BuildRequires:  gtest-devel

+ BuildRequires:  log4cxx-devel

+ BuildRequires:  python3-devel

+ 

+ BuildRequires:  ros-melodic-base_local_planner-devel

+ BuildRequires:  ros-melodic-catkin-devel

+ BuildRequires:  ros-melodic-cmake_modules-devel

+ BuildRequires:  ros-melodic-costmap_2d-devel

+ BuildRequires:  ros-melodic-costmap_converter-devel

+ BuildRequires:  ros-melodic-dynamic_reconfigure-devel

+ BuildRequires:  ros-melodic-geometry_msgs-devel

+ BuildRequires:  ros-melodic-interactive_markers-devel

+ BuildRequires:  ros-melodic-libg2o-devel

+ BuildRequires:  ros-melodic-mbf_costmap_core-devel

+ BuildRequires:  ros-melodic-mbf_msgs-devel

+ BuildRequires:  ros-melodic-message_generation-devel

+ BuildRequires:  ros-melodic-message_runtime-devel

+ BuildRequires:  ros-melodic-nav_core-devel

+ BuildRequires:  ros-melodic-nav_msgs-devel

+ BuildRequires:  ros-melodic-pluginlib-devel

+ BuildRequires:  ros-melodic-roscpp-devel

+ BuildRequires:  ros-melodic-std_msgs-devel

+ BuildRequires:  ros-melodic-tf2-devel

+ BuildRequires:  ros-melodic-tf2_eigen-devel

+ BuildRequires:  ros-melodic-tf2_geometry_msgs-devel

+ BuildRequires:  ros-melodic-tf2_ros-devel

+ BuildRequires:  ros-melodic-visualization_msgs-devel

+ 

+ Requires:       ros-melodic-base_local_planner

+ Requires:       ros-melodic-costmap_2d

+ Requires:       ros-melodic-costmap_converter

+ Requires:       ros-melodic-dynamic_reconfigure

+ Requires:       ros-melodic-geometry_msgs

+ Requires:       ros-melodic-interactive_markers

+ Requires:       ros-melodic-libg2o

+ Requires:       ros-melodic-mbf_costmap_core

+ Requires:       ros-melodic-mbf_msgs

+ Requires:       ros-melodic-message_runtime

+ Requires:       ros-melodic-nav_core

+ Requires:       ros-melodic-nav_msgs

+ Requires:       ros-melodic-pluginlib

+ Requires:       ros-melodic-roscpp

+ Requires:       ros-melodic-std_msgs

+ Requires:       ros-melodic-tf2

+ Requires:       ros-melodic-tf2_ros

+ Requires:       ros-melodic-visualization_msgs

+ 

+ Provides:  ros-melodic-teb_local_planner = 0.8.4-1

+ Obsoletes: ros-melodic-teb_local_planner < 0.8.4-1

+ Obsoletes: ros-kinetic-teb_local_planner < 0.8.4-1

+ 

+ 

+ %description

+ The teb_local_planner package implements a plugin to the

+ base_local_planner of the 2D navigation stack. The underlying method

+ called Timed Elastic Band locally optimizes the robot's trajectory

+ with respect to trajectory execution time, separation from obstacles

+ and compliance with kinodynamic constraints at runtime.

+ 

+ %package        devel

+ Summary:        Development files for %{name}

+ Requires:       %{name}%{?_isa} = %{version}-%{release}

+ Requires:       ros-melodic-catkin-devel

+ Requires:       ros-melodic-message_runtime-devel

+ Requires:       ros-melodic-base_local_planner-devel

+ Requires:       ros-melodic-cmake_modules-devel

+ Requires:       ros-melodic-costmap_2d-devel

+ Requires:       ros-melodic-costmap_converter-devel

+ Requires:       ros-melodic-dynamic_reconfigure-devel

+ Requires:       ros-melodic-geometry_msgs-devel

+ Requires:       ros-melodic-interactive_markers-devel

+ Requires:       ros-melodic-libg2o-devel

+ Requires:       ros-melodic-mbf_costmap_core-devel

+ Requires:       ros-melodic-mbf_msgs-devel

+ Requires:       ros-melodic-message_generation-devel

+ Requires:       ros-melodic-nav_core-devel

+ Requires:       ros-melodic-nav_msgs-devel

+ Requires:       ros-melodic-pluginlib-devel

+ Requires:       ros-melodic-roscpp-devel

+ Requires:       ros-melodic-std_msgs-devel

+ Requires:       ros-melodic-tf2-devel

+ Requires:       ros-melodic-tf2_eigen-devel

+ Requires:       ros-melodic-tf2_geometry_msgs-devel

+ Requires:       ros-melodic-tf2_ros-devel

+ Requires:       ros-melodic-visualization_msgs-devel

+ 

+ Provides: ros-melodic-teb_local_planner-devel = 0.8.4-1

+ Obsoletes: ros-melodic-teb_local_planner-devel < 0.8.4-1

+ Obsoletes: ros-kinetic-teb_local_planner-devel < 0.8.4-1

+ 

+ %description devel

+ The %{name}-devel package contains libraries and header files for developing

+ applications that use %{name}.

+ 

+ 

+ 

+ %prep

+ 

+ %setup -c -T

+ tar --strip-components=1 -xf %{SOURCE0}

+ 

+ %build

+ # nothing to do here

+ 

+ 

+ %install

+ 

+ PYTHONUNBUFFERED=1 ; export PYTHONUNBUFFERED

+ 

+ CFLAGS="${CFLAGS:-%optflags}" ; export CFLAGS ; \

+ CXXFLAGS="${CXXFLAGS:-%optflags}" ; export CXXFLAGS ; \

+ FFLAGS="${FFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FFLAGS ; \

+ FCFLAGS="${FCFLAGS:-%optflags%{?_fmoddir: -I%_fmoddir}}" ; export FCFLAGS ; \

+ %{?__global_ldflags:LDFLAGS="${LDFLAGS:-%__global_ldflags}" ; export LDFLAGS ;} \

+ 

+ source %{_libdir}/ros/setup.bash

+ 

+ # substitute shebang before install block because we run the local catkin script

+ for f in $(grep -rl python .) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $f

+   touch -r $f.orig $f

+   rm $f.orig

+ done

+ 

+ DESTDIR=%{buildroot} ; export DESTDIR

+ 

+ 

+ catkin_make_isolated \

+   -DCMAKE_BUILD_TYPE=RelWithDebInfo \

+   -DCATKIN_ENABLE_TESTING=OFF \

+   -DPYTHON_VERSION=%{python3_version} \

+   -DPYTHON_VERSION_NODOTS=%{python3_version_nodots} \

+   --source . \

+   --install \

+   --install-space %{_libdir}/ros/ \

+   --pkg teb_local_planner

+ 

+ 

+ 

+ 

+ rm -rf %{buildroot}/%{_libdir}/ros/{.catkin,.rosinstall,_setup*,local_setup*,setup*,env.sh}

+ 

+ touch files.list

+ find %{buildroot}/%{_libdir}/ros/{bin,etc,lib64/python*,lib/python*/site-packages,share} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files.list

+ find %{buildroot}/%{_libdir}/ros/lib*/ -mindepth 1 -maxdepth 1 \

+   ! -name pkgconfig ! -name "python*" \

+   | sed "s:%{buildroot}/::" >> files.list

+ 

+ touch files_devel.list

+ find %{buildroot}/%{_libdir}/ros/{include,lib*/pkgconfig} \

+   -mindepth 1 -maxdepth 1 | sed "s:%{buildroot}/::" > files_devel.list

+ 

+ find . -maxdepth 1 -type f -iname "*readme*" | sed "s:^:%%doc :" >> files.list

+ find . -maxdepth 1 -type f -iname "*license*" | sed "s:^:%%license :" >> files.list

+ 

+ 

+ 

+ # replace cmake python macro in shebang

+ for file in $(grep -rIl '^#!.*@PYTHON_EXECUTABLE@*$' %{buildroot}) ; do

+   sed -i.orig 's:^#!\s*@PYTHON_EXECUTABLE@\s*:%{__python3}:' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace unversioned python shebang

+ for file in $(grep -rIl '^#!.*python\s*$' %{buildroot}) ; do

+   sed -i.orig '/^#!.*python\s*$/ { s/python/python3/ }' $file

+   touch -r $file.orig $file

+   rm $file.orig

+ done

+ 

+ # replace "/usr/bin/env $interpreter" with "/usr/bin/$interpreter"

+ for interpreter in bash sh python2 python3 ; do

+   for file in $(grep -rIl "^#\!.*${interpreter}" %{buildroot}) ; do

+     sed -i.orig "s:^#\!\s*/usr/bin/env\s\+${interpreter}.*:#!/usr/bin/${interpreter}:" $file

+     touch -r $file.orig $file

+     rm $file.orig

+   done

+ done

+ 

+ 

+ echo "This is a package automatically generated with rosfed." >> README_FEDORA

+ echo "See https://pagure.io/ros for more information." >> README_FEDORA

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name} README_FEDORA

+ echo %{_docdir}/%{name} >> files.list

+ install -m 0644 -p -D -t %{buildroot}/%{_docdir}/%{name}-devel README_FEDORA

+ echo %{_docdir}/%{name}-devel >> files_devel.list

+ 

+ 

+ %files -f files.list

+ %files devel -f files_devel.list

+ 

+ 

+ %changelog

+ * Fri Mar 13 2020 Nicolas Limpert - melodic.0.8.4-1

+ - Initial package

file modified
+11 -11
@@ -1,14 +1,13 @@ 

  Name:           ros-tf

- Version:        melodic.1.12.0

- Release:        4%{?dist}

+ Version:        melodic.1.12.1

+ Release:        1%{?dist}

  Summary:        ROS package tf

  

  License:        BSD

  URL:            http://www.ros.org/

  

- Source0:        https://github.com/ros-gbp/geometry-release/archive/release/melodic/tf/1.12.0-0.tar.gz#/ros-melodic-tf-1.12.0-source0.tar.gz

+ Source0:        https://github.com/ros-gbp/geometry-release/archive/release/melodic/tf/1.12.1-1.tar.gz#/ros-melodic-tf-1.12.1-source0.tar.gz

  

- Patch0: ros-tf.signals2.patch

  

  

  # common BRs
@@ -43,9 +42,9 @@ 

  Requires:       ros-melodic-std_msgs

  Requires:       ros-melodic-tf2_ros

  

- Provides:  ros-melodic-tf = 1.12.0-4

- Obsoletes: ros-melodic-tf < 1.12.0-4

- Obsoletes: ros-kinetic-tf < 1.12.0-4

+ Provides:  ros-melodic-tf = 1.12.1-1

+ Obsoletes: ros-melodic-tf < 1.12.1-1

+ Obsoletes: ros-kinetic-tf < 1.12.1-1

  

  

  %description
@@ -74,9 +73,9 @@ 

  Requires:       ros-melodic-message_runtime-devel

  Requires:       ros-melodic-roswtf-devel

  

- Provides: ros-melodic-tf-devel = 1.12.0-4

- Obsoletes: ros-melodic-tf-devel < 1.12.0-4

- Obsoletes: ros-kinetic-tf-devel < 1.12.0-4

+ Provides: ros-melodic-tf-devel = 1.12.1-1

+ Obsoletes: ros-melodic-tf-devel < 1.12.1-1

+ Obsoletes: ros-kinetic-tf-devel < 1.12.1-1

  

  %description devel

  The %{name}-devel package contains libraries and header files for developing
@@ -88,7 +87,6 @@ 

  

  %setup -c -T

  tar --strip-components=1 -xf %{SOURCE0}

- %patch0 -p1

  

  %build

  # nothing to do here
@@ -184,6 +182,8 @@ 

  

  

  %changelog

+ * Wed Mar 18 2020 Nicolas Limpert - melodic.1.12.1-1

+ - Update to latest release

  * Tue Jul 23 2019 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.12.0-4

  - Remove obsolete dependency on boost signals

  * Mon Jul 22 2019 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.12.0-3

file modified
+10 -8
@@ -1,12 +1,12 @@ 

  Name:           ros-voxel_grid

- Version:        melodic.1.16.4

+ Version:        melodic.1.16.5

  Release:        1%{?dist}

  Summary:        ROS package voxel_grid

  

  License:        BSD

  URL:            http://www.ros.org/

  

- Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/voxel_grid/1.16.4-1.tar.gz#/ros-melodic-voxel_grid-1.16.4-source0.tar.gz

+ Source0:        https://github.com/ros-gbp/navigation-release/archive/release/melodic/voxel_grid/1.16.5-1.tar.gz#/ros-melodic-voxel_grid-1.16.5-source0.tar.gz

  

  

  
@@ -24,9 +24,9 @@ 

  

  Requires:       ros-melodic-roscpp

  

- Provides:  ros-melodic-voxel_grid = 1.16.4-1

- Obsoletes: ros-melodic-voxel_grid < 1.16.4-1

- Obsoletes: ros-kinetic-voxel_grid < 1.16.4-1

+ Provides:  ros-melodic-voxel_grid = 1.16.5-1

+ Obsoletes: ros-melodic-voxel_grid < 1.16.5-1

+ Obsoletes: ros-kinetic-voxel_grid < 1.16.5-1

  

  

  %description
@@ -47,9 +47,9 @@ 

  Requires:       ros-melodic-roscpp-devel

  Requires:       ros-melodic-rosunit-devel

  

- Provides: ros-melodic-voxel_grid-devel = 1.16.4-1

- Obsoletes: ros-melodic-voxel_grid-devel < 1.16.4-1

- Obsoletes: ros-kinetic-voxel_grid-devel < 1.16.4-1

+ Provides: ros-melodic-voxel_grid-devel = 1.16.5-1

+ Obsoletes: ros-melodic-voxel_grid-devel < 1.16.5-1

+ Obsoletes: ros-kinetic-voxel_grid-devel < 1.16.5-1

  

  %description devel

  The %{name}-devel package contains libraries and header files for developing
@@ -156,6 +156,8 @@ 

  

  

  %changelog

+ * Wed Mar 18 2020 Nicolas Limpert - melodic.1.16.5-1

+ - Update to latest release

  * Thu Mar 05 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.4-1

  - Update to latest release

  * Tue Feb 04 2020 Till Hofmann <thofmann@fedoraproject.org> - melodic.1.16.3-1