Codebase list ros-joint-state-publisher / 03012f6
First debianization Leopold Palomo-Avellaneda 5 years ago
10 changed file(s) with 112 addition(s) and 0 deletion(s). Raw diff Collapse all Expand all
0 ros-joint-state-publisher (1.12.13-1) UNRELEASED; urgency=medium
1
2 * New upstream version 1.12.13.
3 * Rebase patches from ros-robot-model.
4 * New package split from ros-robot-model. Closes: #922832
5
6 -- Leopold Palomo-Avellaneda <leo@alaxarxa.net> Thu, 21 Feb 2019 09:22:37 +0100
0 Source: ros-joint-state-publisher
1 Priority: optional
2 Maintainer: Debian Science Maintainers <debian-science-maintainers@lists.alioth.debian.org>
3 Uploaders: Johannes Schauer <josch@debian.org>,
4 Jochen Sprickerhof <jspricke@debian.org>,
5 Leopold Palomo-Avellaneda <leo@alaxarxa.net>
6 Build-Depends: debhelper (>= 11), catkin, python-all, dh-python, librostest-dev
7 Standards-Version: 4.3.0
8 Section: utils
9 Rules-Requires-Root: no
10 Homepage: https://wiki.ros.org/joint_state_publisher
11 Vcs-Browser: https://salsa.debian.org/science-team/ros-joint-state-publisher
12 Vcs-Git: https://salsa.debian.org/science-team/ros-joint-state-publisher.git
13
14 Package: joint-state-publisher
15 Architecture: all
16 Depends: ${shlibs:Depends}, ${misc:Depends}, ${python:Depends}, python-qt-binding, ros-sensor-msgs
17 Recommends: ros-robot-state-publisher
18 Description: ROS joint_state_publisher
19 This package contains a tool for setting and publishing joint state values for
20 a given URDF. It publishes sensor_msgs/JointState messages for a robot. The
21 package reads the robot_description parameter, finds all of the non-fixed
22 joints and publishes a JointState message with all those joints defined.
23 .
24 It can be used in conjunction with the robot_state_publisher node to
25 also publish transforms for all joint states.
0 Format: https://www.debian.org/doc/packaging-manuals/copyright-format/1.0/
1 Upstream-Name: joint_state_publisher
2 Upstream-Contact: Chris Lalancette <clalancette@osrfoundation.org>, Shane Loretz <sloretz@osrfoundation.org>
3 Source: https://github.com/ros/joint_state_publisher
4
5 Files: *
6 Copyright: 2008,2010,2011,2013 Willow Garage, Inc.
7 2010, University of Tokyo
8 License: BSD-3-clause
9
10 Files: debian/*
11 Copyright: 2019, Johannes Schauer <josch@debian.org>,
12 Jochen Sprickerhof <jspricke@debian.org>,
13 Leopold Palomo-Avellaneda <leo@alaxarxa.net>
14 License: BSD-3-clause
15
16 License: BSD-3-Clause
17 Redistribution and use in source and binary forms, with or without
18 modification, are permitted provided that the following conditions
19 are met:
20 .
21 * Redistributions of source code must retain the above copyright
22 notice, this list of conditions and the following disclaimer.
23 * Redistributions in binary form must reproduce the above
24 copyright notice, this list of conditions and the following
25 disclaimer in the documentation and/or other materials provided
26 with the distribution.
27 * Neither the name of Willow Garage, Inc. nor the names of its
28 contributors may be used to endorse or promote products derived
29 from this software without specific prior written permission.
30 .
31 THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
32 "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
33 LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
34 FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
35 COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
36 INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
37 BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
38 LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
39 CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
40 LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
41 ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
42 POSSIBILITY OF SUCH DAMAGE.
0 usr/lib/joint_state_publisher/joint_state_publisher usr/bin
1 /usr/share/joint_state_publisher/package.xml
2
0 From: Jochen Sprickerhof <git@jochen.sprickerhof.de>
1 Date: Wed, 5 Aug 2015 13:33:39 +0200
2 Subject: Add CMakeLists.txt
3
4 ---
5 CMakeLists.txt | 4 ++++
6 1 file changed, 4 insertions(+)
7 create mode 100644 CMakeLists.txt
8
9 diff --git a/CMakeLists.txt b/CMakeLists.txt
10 new file mode 100644
11 index 0000000..5503177
12 --- /dev/null
13 +++ b/CMakeLists.txt
14 @@ -0,0 +1,4 @@
15 +cmake_minimum_required(VERSION 2.8.3)
16 +project(robot_model)
17 +
18 +add_subdirectory(joint_state_publisher)
0 0001-Add-CMakeLists.txt.patch
0 #!/usr/bin/make -f
1
2 %:
3 dh $@ --buildsystem=cmake --with python2
4
5 override_dh_auto_install:
6 dh_auto_install --destdir=debian/tmp
0 3.0 (quilt)
0 version=4
1 opts="filenamemangle=s%(?:.*?)?v?(\d[\d.]*)\.tar\.gz%joint-state-publisher-$1.tar.gz%" \
2 https://github.com/ros/joint_state_publisher/tags \
3 (?:.*?/)?v?(\d[\d.]*)\.tar\.gz debian uupdate