Skip to content

Commit 41a1494

Browse files
authored
Update package maintainers. (#168)
Signed-off-by: Michel Hidalgo <[email protected]>
1 parent f48b00d commit 41a1494

File tree

10 files changed

+20
-14
lines changed

10 files changed

+20
-14
lines changed

actionlib_msgs/package.xml

+2-1
Original file line numberDiff line numberDiff line change
@@ -8,11 +8,12 @@
88
the <a href="http://wiki.ros.org/actionlib">actionlib</a>
99
package.
1010
</description>
11-
<maintainer email="[email protected]">Tully Foote</maintainer>
11+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
1212
<license>BSD</license>
1313

1414
<url>http://wiki.ros.org/actionlib_msgs</url>
1515
<author>Vijay Pradeep</author>
16+
<author email="[email protected]">Tully Foote</author>
1617

1718
<buildtool_depend version_gte="0.5.78">catkin</buildtool_depend>
1819

common_msgs/package.xml

+2-1
Original file line numberDiff line numberDiff line change
@@ -10,10 +10,11 @@
1010
robot navigation (<a href="http://wiki.ros.org/nav_msgs">nav_msgs</a>),
1111
and common sensors (<a href="http://wiki.ros.org/sensor_msgs">sensor_msgs</a>), such as laser range finders, cameras, point clouds.
1212
</description>
13-
<maintainer email="[email protected]">Tully Foote</maintainer>
13+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
1414
<license>BSD</license>
1515

1616
<url>http://wiki.ros.org/common_msgs</url>
17+
<author email="[email protected]">Tully Foote</author>
1718

1819
<buildtool_depend>catkin</buildtool_depend>
1920

diagnostic_msgs/package.xml

+1-1
Original file line numberDiff line numberDiff line change
@@ -13,7 +13,7 @@
1313
These messages are used for long term logging and will not be
1414
changed unless there is a very important reason.
1515
</description>
16-
<maintainer email="[email protected]">Tully Foote</maintainer>
16+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
1717
<license>BSD</license>
1818

1919
<url>http://wiki.ros.org/diagnostic_msgs</url>

geometry_msgs/package.xml

+3-3
Original file line numberDiff line numberDiff line change
@@ -7,12 +7,12 @@
77
to provide a common data type and facilitate interoperability
88
throughout the system.
99
</description>
10-
<maintainer email="[email protected]">Tully Foote</maintainer>
10+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
1111
<license>BSD</license>
1212

1313
<url>http://wiki.ros.org/geometry_msgs</url>
14-
<author>Tully Foote</author>
15-
14+
<author email="[email protected]">Tully Foote</author>
15+
1616
<buildtool_depend>catkin</buildtool_depend>
1717

1818
<build_depend>message_generation</build_depend>

nav_msgs/package.xml

+2-2
Original file line numberDiff line numberDiff line change
@@ -5,11 +5,11 @@
55
nav_msgs defines the common messages used to interact with the
66
<a href="http://wiki.ros.org/navigation">navigation</a> stack.
77
</description>
8-
<maintainer email="[email protected]">Tully Foote</maintainer>
8+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
99
<license>BSD</license>
1010

1111
<url>http://wiki.ros.org/nav_msgs</url>
12-
<author>Tully Foote</author>
12+
<author email="[email protected]">Tully Foote</author>
1313

1414
<buildtool_depend>catkin</buildtool_depend>
1515

sensor_msgs/package.xml

+2-1
Original file line numberDiff line numberDiff line change
@@ -9,10 +9,11 @@
99
This package defines messages for commonly used sensors, including
1010
cameras and scanning laser rangefinders.
1111
</description>
12-
<maintainer email="[email protected]">Tully Foote</maintainer>
12+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
1313
<license>BSD</license>
1414

1515
<url>http://ros.org/wiki/sensor_msgs</url>
16+
<author email="[email protected]">Tully Foote</author>
1617

1718
<buildtool_depend>catkin</buildtool_depend>
1819
<buildtool_depend condition="$ROS_PYTHON_VERSION == 2">python-setuptools</buildtool_depend>

shape_msgs/package.xml

+2-2
Original file line numberDiff line numberDiff line change
@@ -5,11 +5,11 @@
55
This package contains messages for defining shapes, such as simple solid
66
object primitives (cube, sphere, etc), planes, and meshes.
77
</description>
8-
<maintainer email="isucan@willowgarage.com">Ioan Sucan</maintainer>
8+
<maintainer email="michel@ekumenlabs.com">Michel Hidalgo</maintainer>
99
<license>BSD</license>
1010

1111
<url>http://wiki.ros.org/shape_msgs</url>
12-
<author>Ioan Sucan</author>
12+
<author email="[email protected]">Ioan Sucan</author>
1313

1414
<buildtool_depend>catkin</buildtool_depend>
1515

stereo_msgs/package.xml

+2-1
Original file line numberDiff line numberDiff line change
@@ -4,12 +4,13 @@
44
<description>
55
stereo_msgs contains messages specific to stereo processing, such as disparity images.
66
</description>
7-
<maintainer email="[email protected]">Tully Foote</maintainer>
7+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
88
<license>BSD</license>
99

1010
<url>http://wiki.ros.org/stereo_msgs</url>
1111
<author>Patrick Mihelich</author>
1212
<author>Kurt Konolige</author>
13+
<author email="[email protected]">Tully Foote</author>
1314

1415
<buildtool_depend>catkin</buildtool_depend>
1516

trajectory_msgs/package.xml

+2-1
Original file line numberDiff line numberDiff line change
@@ -6,11 +6,12 @@
66
also the building blocks of most of the
77
<a href="http://wiki.ros.org/control_msgs">control_msgs</a> actions.
88
</description>
9-
<maintainer email="[email protected]">Tully Foote</maintainer>
9+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
1010
<license>BSD</license>
1111

1212
<url>http://wiki.ros.org/trajectory_msgs</url>
1313
<author>Stuart Glaser</author>
14+
<author email="[email protected]">Tully Foote</author>
1415

1516
<buildtool_depend>catkin</buildtool_depend>
1617

visualization_msgs/package.xml

+2-1
Original file line numberDiff line numberDiff line change
@@ -8,12 +8,13 @@
88
The marker message is used to send visualization "markers" such as boxes, spheres, arrows, lines, etc. to a visualization environment such as <a href="http:///www.ros.org/wiki/rviz">rviz</a>.
99
See the rviz tutorial <a href="http://www.ros.org/wiki/rviz/Tutorials">rviz tutorials</a> for more information.
1010
</description>
11-
<maintainer email="[email protected]">Tully Foote</maintainer>
11+
<maintainer email="[email protected]">Michel Hidalgo</maintainer>
1212
<license>BSD</license>
1313

1414
<url>http://ros.org/wiki/visualization_msgs</url>
1515
<author email="[email protected]">Josh Faust</author>
1616
<author email="[email protected]">Davis Gossow</author>
17+
<author email="[email protected]">Tully Foote</author>
1718

1819
<buildtool_depend>catkin</buildtool_depend>
1920

0 commit comments

Comments
 (0)