Skip to content

Commit 9650566

Browse files
authored
Change ROI message type to hri_msgs/NormalizedRegionOfInterest2D (#382)
Co-authored-by: Luka Juricic <luka.juricic@pal-robotics.com>
1 parent 0fe9c53 commit 9650566

File tree

1 file changed

+55
-55
lines changed

1 file changed

+55
-55
lines changed

rep-0155.rst

Lines changed: 55 additions & 55 deletions
Original file line numberDiff line numberDiff line change
@@ -326,41 +326,41 @@ created (eg ``/humans/faces/bf3d/``).
326326
The following subtopics MAY then be available, depending on available
327327
detectors:
328328

329-
=================== ==================================== ======== ========================
330-
Name Message type Required Description
331-
=================== ==================================== ======== ========================
332-
``/roi`` ``sensor_msgs/RegionOfInterest`` x Region of the face in
333-
the source image
334-
``/cropped`` ``sensor_msgs/Image`` x Cropped face image, if
335-
necessary scaled,
336-
centered and 0-padded
337-
to match the
338-
``/humans/faces/width``
339-
and
340-
``/humans/faces/height``
341-
ROS parameters
342-
``/aligned`` ``sensor_msgs/Image`` Aligned (eg, the two
343-
eyes are horizontally
344-
aligned) version of the
345-
cropped face, with same
346-
resolution as
347-
``/cropped``
348-
``/frontalized`` ``sensor_msgs/Image`` Frontalized version of
349-
the cropped face, with
350-
same resolution as
351-
``/cropped``
352-
``/landmarks`` ``hri_msgs/FacialLandmarks`` 2D facial landmarks
353-
extracted from the face
354-
``/facs`` ``hri_msgs/FacialActionUnits`` The presence and
355-
intensity of facial
356-
action units found in
357-
the face
358-
``/expression`` ``hri_msgs/Expression`` The expression
359-
recognised from the
360-
face
361-
``/softbiometrics`` ``hri_msgs/SoftBiometrics`` Detected age and gender
362-
of the person
363-
=================== ==================================== ======== ========================
329+
=================== ========================================= ======== ========================
330+
Name Message type Required Description
331+
=================== ========================================= ======== ========================
332+
``/roi`` ``hri_msgs/NormalizedRegionOfInterest2D`` x Region of the face in
333+
the source image
334+
``/cropped`` ``sensor_msgs/Image`` x Cropped face image, if
335+
necessary scaled,
336+
centered and 0-padded
337+
to match the
338+
``/humans/faces/width``
339+
and
340+
``/humans/faces/height``
341+
ROS parameters
342+
``/aligned`` ``sensor_msgs/Image`` Aligned (eg, the two
343+
eyes are horizontally
344+
aligned) version of the
345+
cropped face, with same
346+
resolution as
347+
``/cropped``
348+
``/frontalized`` ``sensor_msgs/Image`` Frontalized version of
349+
the cropped face, with
350+
same resolution as
351+
``/cropped``
352+
``/landmarks`` ``hri_msgs/FacialLandmarks`` 2D facial landmarks
353+
extracted from the face
354+
``/facs`` ``hri_msgs/FacialActionUnits`` The presence and
355+
intensity of facial
356+
action units found in
357+
the face
358+
``/expression`` ``hri_msgs/Expression`` The expression
359+
recognised from the
360+
face
361+
``/softbiometrics`` ``hri_msgs/SoftBiometrics`` Detected age and gender
362+
of the person
363+
=================== ========================================= ======== ========================
364364

365365
Bodies
366366
------
@@ -373,23 +373,23 @@ created.
373373
The following subtopics MAY then be available, depending on available
374374
detectors:
375375

376-
================= ==================================== ======== ========================
377-
Name Message type Required Description
378-
================= ==================================== ======== ========================
379-
``/roi`` ``sensor_msgs/RegionOfInterest`` x Region of the whole body
380-
body in the source image
381-
``/cropped`` ``sensor_msgs/Image`` x Cropped body image
382-
``/skeleton2d`` ``hri_msgs/Skeleton2D`` The 2D points of the
383-
the detected skeleton
384-
``/joint_states`` ``sensor_msgs/JointState`` The joint state of the
385-
human body, following
386-
the `Kinematic Model
387-
of the Human`_
388-
``/posture`` ``hri_msgs/BodyPosture`` Recognised body posture
389-
(eg standing, sitting)
390-
``/gesture`` ``hri_msgs/Gesture`` Recognised symbolic
391-
gesture (eg waving)
392-
================= ==================================== ======== ========================
376+
================= ========================================= ======== ========================
377+
Name Message type Required Description
378+
================= ========================================= ======== ========================
379+
``/roi`` ``hri_msgs/NormalizedRegionOfInterest2D`` x Region of the whole body
380+
body in the source image
381+
``/cropped`` ``sensor_msgs/Image`` x Cropped body image
382+
``/skeleton2d`` ``hri_msgs/Skeleton2D`` The 2D points of the
383+
the detected skeleton
384+
``/joint_states`` ``sensor_msgs/JointState`` The joint state of the
385+
human body, following
386+
the `Kinematic Model
387+
of the Human`_
388+
``/posture`` ``hri_msgs/BodyPosture`` Recognised body posture
389+
(eg standing, sitting)
390+
``/gesture`` ``hri_msgs/Gesture`` Recognised symbolic
391+
gesture (eg waving)
392+
================= ========================================= ======== ========================
393393

394394
3D body poses SHOULD be exposed via TF frames.
395395
This is discussed in
@@ -497,9 +497,9 @@ effectively advertises and publishes onto the following topics:
497497
.. code::
498498
499499
> rostopic list
500-
/humans/faces/23bd5/roi # sensor_msgs/RegionOfInterest
500+
/humans/faces/23bd5/roi # hri_msgs/NormalizedRegionOfInterest2D
501501
/humans/faces/23bd5/cropped # sensor_msgs/Image
502-
/humans/faces/b092e/roi # sensor_msgs/RegionOfInterest
502+
/humans/faces/b092e/roi # hri_msgs/NormalizedRegionOfInterest2D
503503
/humans/faces/b092e/cropped # sensor_msgs/Image
504504
505505
.. note:: The IDs (in this example, ``23bd5`` and ``b092e``) are arbitrary, as
@@ -532,7 +532,7 @@ It detects one body:
532532
> rostopic list
533533
/humans/faces/23bd5/...
534534
/humans/faces/b092e/...
535-
/humans/bodies/67dd1/roi # sensor_msgs/RegionOfInterest
535+
/humans/bodies/67dd1/roi # hri_msgs/NormalizedRegionOfInterest2D
536536
/humans/bodies/67dd1/cropped # sensor_msgs/Image
537537
538538
In addition, you start a 2D/3D pose estimator ``your_skeleton_estimator_node``.

0 commit comments

Comments
 (0)