Only released in EOL distros:
xbot: xbot_bringup | xbot_description | xbot_driver | xbot_face | xbot_msgs | xbot_navi | xbot_node | xbot_safety_controller | xbot_talker | xbot_tools
Package Summary
Documented
The xbot_face package
- Maintainer status: maintained
- Maintainer: Rocwang <wangpeng AT droid.ac DOT cn>
- Author:
- License: BSD
- Source: git https://github.com/DroidAITech/xbot.git (branch: kinetic-devel)
Contents
Overview
Xbot_face is a face recognition ROS package for XBot-U robots. The package has various functions such as face registration, face management, face logout, and face recognition.
Nodes
face_recog
The face_recog node provides face recognition function and outputs recognition results.Subscribed Topics
/xbot/camera/image (sensor_msgs/Image)- Get the camera image data from this topic.
Published Topics
/xbot/face_result (xbot_face/FaceResult)- Get the face recognition result from this topic.
camera_image_publisher
The camera_image_publisher node provides a /xbot/camera/image topic for publishing the image data obtained by the camera sensor.Published Topics
/xbot/camera/image (sensor_msgs/Image)- Get the camera image data from this topic.