Skip to content

Commit

Permalink
Generated debian files for jammy
Browse files Browse the repository at this point in the history
  • Loading branch information
tonybaltovski committed Nov 19, 2024
1 parent aaf6e4f commit 7e77930
Show file tree
Hide file tree
Showing 14 changed files with 141 additions and 50 deletions.
103 changes: 103 additions & 0 deletions debian/changelog
Original file line number Diff line number Diff line change
@@ -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 <[email protected]> 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 <[email protected]> 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 <https://github.com/ros-visualization/interactive_marker_twist_server/issues/18>)
* Initial migration CMakeLists.txt and package.xml
* Contributors: Joey Yang, jyang, jyang-cpr

-- Mike Purvis <[email protected]> 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 <[email protected]> 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 <[email protected]> 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 <https://github.com/ros-visualization/interactive_marker_twist_server/issues/11>)
* Install the default config files. (#10 <https://github.com/ros-visualization/interactive_marker_twist_server/issues/10>)
* Contributors: Tony Baltovski

-- Mike Purvis <[email protected]> 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 <https://github.com/ros-visualization/interactive_marker_twist_server/issues/7>)
* Fix YZ rotation. (#6 <https://github.com/ros-visualization/interactive_marker_twist_server/issues/6>)
* Contributors: Mike Purvis, Paul Bovbel, Tony Baltovski

-- Mike Purvis <[email protected]> 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 <https://github.com/ros-visualization/interactive_marker_twist_server/issues/3>.
* Max speed control, fixes #1 <https://github.com/ros-visualization/interactive_marker_twist_server/issues/1>
* Update copyright.
* Contributors: Mike Purvis

-- Mike Purvis <[email protected]> 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 <[email protected]> Wed, 27 Nov 2013 05:00:00 -0000


7 changes: 0 additions & 7 deletions debian/changelog.em

This file was deleted.

1 change: 1 addition & 0 deletions debian/compat
Original file line number Diff line number Diff line change
@@ -0,0 +1 @@
9
1 change: 0 additions & 1 deletion debian/compat.em

This file was deleted.

12 changes: 12 additions & 0 deletions debian/control
Original file line number Diff line number Diff line change
@@ -0,0 +1,12 @@
Source: ros-humble-interactive-marker-twist-server
Section: misc
Priority: optional
Maintainer: Mike Purvis <[email protected]>
Build-Depends: debhelper (>= 9.0.0), ros-humble-ament-cmake, ros-humble-ament-lint-auto <!nocheck>, ros-humble-ament-lint-common <!nocheck>, 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
14 changes: 0 additions & 14 deletions debian/control.em

This file was deleted.

9 changes: 9 additions & 0 deletions debian/copyright
Original file line number Diff line number Diff line change
@@ -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
11 changes: 0 additions & 11 deletions debian/copyright.em

This file was deleted.

3 changes: 3 additions & 0 deletions debian/gbp.conf
Original file line number Diff line number Diff line change
@@ -0,0 +1,3 @@
[git-buildpackage]
upstream-tag=release/humble/interactive_marker_twist_server/2.1.1-1
upstream-tree=tag
3 changes: 0 additions & 3 deletions debian/gbp.conf.em

This file was deleted.

22 changes: 11 additions & 11 deletions debian/rules.em → debian/rules
Original file line number Diff line number Diff line change
Expand Up @@ -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
Expand All @@ -24,44 +24,44 @@ 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:
# 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.
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
1 change: 1 addition & 0 deletions debian/source/format
Original file line number Diff line number Diff line change
@@ -0,0 +1 @@
3.0 (quilt)
1 change: 0 additions & 1 deletion debian/source/format.em

This file was deleted.

3 changes: 1 addition & 2 deletions debian/source/options.em → debian/source/options
Original file line number Diff line number Diff line change
@@ -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]

0 comments on commit 7e77930

Please sign in to comment.