diff --git a/debian/changelog b/debian/changelog new file mode 100644 index 0000000..75ac1eb --- /dev/null +++ b/debian/changelog @@ -0,0 +1,103 @@ +ros-humble-interactive-marker-twist-server (2.1.1-1jammy) jammy; urgency=high + + * Fixed linting. + * Updated CI for Humble and Jazzy. + * Add the use_stamped_msgs param to allow support for publishing TwistStamped messages instead of Twist + * Contributors: Chris Iverach-Brereton, Tony Baltovski + + -- Mike Purvis Tue, 19 Nov 2024 05:00:00 -0000 + +ros-humble-interactive-marker-twist-server (2.1.0-1jammy) jammy; urgency=high + + * Updated CI for Humble. + * fix error for tf2_geometry_msgs + * Add CI workflow + * Reorder imports to pass flake8 linter checks + * Contributors: Byeong-Kyu Ahn, Joey Yang, Tony Baltovski + + -- Mike Purvis Mon, 06 Mar 2023 05:00:00 -0000 + +ros-humble-interactive-marker-twist-server (2.0.0-1jammy) jammy; urgency=high + + * Add license, contributing, and copyright headers for linter + * Style changes for linter + * List dependencies in alphabetical order + * add missing tick + * add basic usage instructions + * create ROS2 XML launch file + * add config argument + * initial README + * Re-include standard library headers + * Cleanup + * Use SingleThreadedExecutor; change topic name from global to relative; remove logging + * Remove duplicate imports + * Change default config file to linear + * Cleanup CMakeLists.txt and package.xml + * Rename launch file to follow ROS2 naming convention + * Disable requirement for declared parameters via node options; uncomment lines to make node work + * Change values from int to double + * Launch file + * Initial launch file + * Recover descriptions + * Initialize server in constructor initialization list, readd marker_size_scale, fix getParameters() + * Make processFeedback() publicly accessible + * Init createInteractiveMarkers() and processFeedback() methods + * Initial getParameters() method + * Port methods + * Initial functional skeleton ros2 node + * Remove unused cmd_vel_topic variable (#18 ) + * Initial migration CMakeLists.txt and package.xml + * Contributors: Joey Yang, jyang, jyang-cpr + + -- Mike Purvis Wed, 13 Apr 2022 04:00:00 -0000 + +ros-humble-interactive-marker-twist-server (1.2.2-1jammy) jammy; urgency=high + + * Remove the leading '/' from the default link; this causes errors in Noetic + * Bump CMake version to avoid CMP0048 warning. + * Contributors: Chris Iverach-Brereton, Tony Baltovski + + -- Mike Purvis Wed, 03 Feb 2021 05:00:00 -0000 + +ros-humble-interactive-marker-twist-server (1.2.1-1jammy) jammy; urgency=high + + * Added tf as a dep. + * Contributors: Tony Baltovski + + -- Mike Purvis Tue, 26 Jan 2021 05:00:00 -0000 + +ros-humble-interactive-marker-twist-server (1.2.0-1jammy) jammy; urgency=high + + * Fixed CMake warning and updated to package format 2. (#11 ) + * Install the default config files. (#10 ) + * Contributors: Tony Baltovski + + -- Mike Purvis Thu, 22 Jun 2017 04:00:00 -0000 + +ros-humble-interactive-marker-twist-server (1.1.0-1jammy) jammy; urgency=high + + * Added additional degrees of freedom (YZ) to linear interactive markers. (#7 ) + * Fix YZ rotation. (#6 ) + * Contributors: Mike Purvis, Paul Bovbel, Tony Baltovski + + -- Mike Purvis Tue, 20 Dec 2016 05:00:00 -0000 + +ros-humble-interactive-marker-twist-server (1.0.0-1jammy) jammy; urgency=high + + * Add roslaunch file check, roslint + * Make cmd_vel topic relative; fixes #3 . + * Max speed control, fixes #1 + * Update copyright. + * Contributors: Mike Purvis + + -- Mike Purvis Mon, 31 Mar 2014 04:00:00 -0000 + +ros-humble-interactive-marker-twist-server (0.0.1-1jammy) jammy; urgency=high + + * Parameterize robot's name and the size of the resulting markers. + * Remove non-markers files from turtlebot_viz, Turtlebot-specific references. + * Starting point is https://github.com/turtlebot/turtlebot_viz + + -- Mike Purvis Wed, 27 Nov 2013 05:00:00 -0000 + + diff --git a/debian/changelog.em b/debian/changelog.em deleted file mode 100644 index 3585909..0000000 --- a/debian/changelog.em +++ /dev/null @@ -1,7 +0,0 @@ -@[for change_version, change_date, changelog, main_name, main_email in changelogs]@(Package) (@(change_version)@(DebianInc)@(Distribution)) @(Distribution); urgency=high - -@(changelog) - - -- @(main_name) <@(main_email)> @(change_date) - -@[end for] diff --git a/debian/compat b/debian/compat new file mode 100644 index 0000000..ec63514 --- /dev/null +++ b/debian/compat @@ -0,0 +1 @@ +9 diff --git a/debian/compat.em b/debian/compat.em deleted file mode 100644 index 7a87216..0000000 --- a/debian/compat.em +++ /dev/null @@ -1 +0,0 @@ -@(debhelper_version) diff --git a/debian/control b/debian/control new file mode 100644 index 0000000..2fcddf9 --- /dev/null +++ b/debian/control @@ -0,0 +1,12 @@ +Source: ros-humble-interactive-marker-twist-server +Section: misc +Priority: optional +Maintainer: Mike Purvis +Build-Depends: debhelper (>= 9.0.0), ros-humble-ament-cmake, ros-humble-ament-lint-auto , ros-humble-ament-lint-common , ros-humble-geometry-msgs, ros-humble-interactive-markers, ros-humble-rclcpp, ros-humble-tf2, ros-humble-visualization-msgs, ros-humble-ros-workspace +Homepage: +Standards-Version: 3.9.2 + +Package: ros-humble-interactive-marker-twist-server +Architecture: any +Depends: ${shlibs:Depends}, ${misc:Depends}, ros-humble-geometry-msgs, ros-humble-interactive-markers, ros-humble-rclcpp, ros-humble-tf2, ros-humble-visualization-msgs, ros-humble-ros-workspace +Description: Interactive control for generic Twist-based robots using interactive markers diff --git a/debian/control.em b/debian/control.em deleted file mode 100644 index 6d7b65c..0000000 --- a/debian/control.em +++ /dev/null @@ -1,14 +0,0 @@ -Source: @(Package) -Section: misc -Priority: optional -Maintainer: @(Maintainer) -Build-Depends: debhelper (>= @(debhelper_version).0.0), @(', '.join(BuildDepends)) -Homepage: @(Homepage) -Standards-Version: 3.9.2 - -Package: @(Package) -Architecture: any -Depends: ${shlibs:Depends}, ${misc:Depends}, @(', '.join(Depends)) -@[if Conflicts]Conflicts: @(', '.join(Conflicts))@\n@[end if]@ -@[if Replaces]Replaces: @(', '.join(Replaces))@\n@[end if]@ -Description: @(Description) diff --git a/debian/copyright b/debian/copyright new file mode 100644 index 0000000..21fbcbd --- /dev/null +++ b/debian/copyright @@ -0,0 +1,9 @@ +Format: Bloom subset of https://www.debian.org/doc/packaging-manuals/copyright-format/1.0/ +Upstream-Name: interactive_marker_twist_server +Upstream-Contact: https://github.com/ros-visualization/interactive_marker_twist_server/issues +Source: https://github.com/ros-visualization/interactive_marker_twist_server + +Files: See file headers in repository for details +Copyright: See package copyright in source code for details +License: BSD + See repository for full license text diff --git a/debian/copyright.em b/debian/copyright.em deleted file mode 100644 index bc82fd5..0000000 --- a/debian/copyright.em +++ /dev/null @@ -1,11 +0,0 @@ -Format: Bloom subset of https://www.debian.org/doc/packaging-manuals/copyright-format/1.0/ -Upstream-Name: @(Name) -@[if BugTracker]Upstream-Contact: @(BugTracker)@\n@[end if]@ -@[if Source]Source: @(Source)@\n@[end if]@ -@[for License, Text in Licenses]@ - -Files: See file headers in repository for details -Copyright: See package copyright in source code for details -License: @(License) - @(Text) -@[end for]@ diff --git a/debian/gbp.conf b/debian/gbp.conf new file mode 100644 index 0000000..02f0569 --- /dev/null +++ b/debian/gbp.conf @@ -0,0 +1,3 @@ +[git-buildpackage] +upstream-tag=release/humble/interactive_marker_twist_server/2.1.1-1 +upstream-tree=tag diff --git a/debian/gbp.conf.em b/debian/gbp.conf.em deleted file mode 100644 index ad24a16..0000000 --- a/debian/gbp.conf.em +++ /dev/null @@ -1,3 +0,0 @@ -[git-buildpackage] -upstream-tag=@(release_tag) -upstream-tree=tag diff --git a/debian/rules.em b/debian/rules similarity index 71% rename from debian/rules.em rename to debian/rules index a856369..c28842a 100755 --- a/debian/rules.em +++ b/debian/rules @@ -13,7 +13,7 @@ export DH_VERBOSE=1 # https://code.ros.org/trac/ros/ticket/2977 # https://code.ros.org/trac/ros/ticket/3842 export LDFLAGS= -export PKG_CONFIG_PATH=@(InstallationPrefix)/lib/pkgconfig +export PKG_CONFIG_PATH=/opt/ros/humble/lib/pkgconfig # Explicitly enable -DNDEBUG, see: # https://github.com/ros-infrastructure/bloom/issues/327 export DEB_CXXFLAGS_MAINT_APPEND=-DNDEBUG @@ -24,24 +24,24 @@ endif DEB_HOST_GNU_TYPE ?= $(shell dpkg-architecture -qDEB_HOST_GNU_TYPE) %: - dh $@@ -v --buildsystem=cmake --builddirectory=.obj-$(DEB_HOST_GNU_TYPE) + dh $@ -v --buildsystem=cmake --builddirectory=.obj-$(DEB_HOST_GNU_TYPE) override_dh_auto_configure: # In case we're installing to a non-standard location, look for a setup.sh # in the install tree and source it. It will set things like # CMAKE_PREFIX_PATH, PKG_CONFIG_PATH, and PYTHONPATH. - if [ -f "@(InstallationPrefix)/setup.sh" ]; then . "@(InstallationPrefix)/setup.sh"; fi && \ + if [ -f "/opt/ros/humble/setup.sh" ]; then . "/opt/ros/humble/setup.sh"; fi && \ dh_auto_configure -- \ - -DCMAKE_INSTALL_PREFIX="@(InstallationPrefix)" \ - -DAMENT_PREFIX_PATH="@(InstallationPrefix)" \ - -DCMAKE_PREFIX_PATH="@(InstallationPrefix)" \ + -DCMAKE_INSTALL_PREFIX="/opt/ros/humble" \ + -DAMENT_PREFIX_PATH="/opt/ros/humble" \ + -DCMAKE_PREFIX_PATH="/opt/ros/humble" \ $(BUILD_TESTING_ARG) override_dh_auto_build: # In case we're installing to a non-standard location, look for a setup.sh # in the install tree and source it. It will set things like # CMAKE_PREFIX_PATH, PKG_CONFIG_PATH, and PYTHONPATH. - if [ -f "@(InstallationPrefix)/setup.sh" ]; then . "@(InstallationPrefix)/setup.sh"; fi && \ + if [ -f "/opt/ros/humble/setup.sh" ]; then . "/opt/ros/humble/setup.sh"; fi && \ dh_auto_build override_dh_auto_test: @@ -49,19 +49,19 @@ override_dh_auto_test: # in the install tree and source it. It will set things like # CMAKE_PREFIX_PATH, PKG_CONFIG_PATH, and PYTHONPATH. echo -- Running tests. Even if one of them fails the build is not canceled. - if [ -f "@(InstallationPrefix)/setup.sh" ]; then . "@(InstallationPrefix)/setup.sh"; fi && \ + if [ -f "/opt/ros/humble/setup.sh" ]; then . "/opt/ros/humble/setup.sh"; fi && \ dh_auto_test || true override_dh_shlibdeps: # In case we're installing to a non-standard location, look for a setup.sh # in the install tree and source it. It will set things like # CMAKE_PREFIX_PATH, PKG_CONFIG_PATH, and PYTHONPATH. - if [ -f "@(InstallationPrefix)/setup.sh" ]; then . "@(InstallationPrefix)/setup.sh"; fi && \ - dh_shlibdeps -l$(CURDIR)/debian/@(Package)/@(InstallationPrefix)/lib/:$(CURDIR)/debian/@(Package)/@(InstallationPrefix)/opt/@(Name)/lib/ + if [ -f "/opt/ros/humble/setup.sh" ]; then . "/opt/ros/humble/setup.sh"; fi && \ + dh_shlibdeps -l$(CURDIR)/debian/ros-humble-interactive-marker-twist-server//opt/ros/humble/lib/:$(CURDIR)/debian/ros-humble-interactive-marker-twist-server//opt/ros/humble/opt/interactive_marker_twist_server/lib/ override_dh_auto_install: # In case we're installing to a non-standard location, look for a setup.sh # in the install tree and source it. It will set things like # CMAKE_PREFIX_PATH, PKG_CONFIG_PATH, and PYTHONPATH. - if [ -f "@(InstallationPrefix)/setup.sh" ]; then . "@(InstallationPrefix)/setup.sh"; fi && \ + if [ -f "/opt/ros/humble/setup.sh" ]; then . "/opt/ros/humble/setup.sh"; fi && \ dh_auto_install diff --git a/debian/source/format b/debian/source/format new file mode 100644 index 0000000..163aaf8 --- /dev/null +++ b/debian/source/format @@ -0,0 +1 @@ +3.0 (quilt) diff --git a/debian/source/format.em b/debian/source/format.em deleted file mode 100644 index 9666bf4..0000000 --- a/debian/source/format.em +++ /dev/null @@ -1 +0,0 @@ -3.0 (@(format)) diff --git a/debian/source/options.em b/debian/source/options similarity index 81% rename from debian/source/options.em rename to debian/source/options index 8c4c78b..8bc9182 100644 --- a/debian/source/options.em +++ b/debian/source/options @@ -1,6 +1,5 @@ -@[if format and format == 'quilt']@ # Automatically add upstream changes to the quilt overlay. # http://manpages.ubuntu.com/manpages/trusty/man1/dpkg-source.1.html # This supports reusing the orig.tar.gz for debian increments. auto-commit -@[end if] +