/robot_face#
Caution
This documentation page has been auto-generated.
It may be missing some details.
/robot_face Quick Facts
- Category
 - Message type
 - Direction
 ⬅️ you normally publish to this topic.
The left and right images to be displayed on the robot’s eyes. Published by default by the expressive_eyes node. If you want to publish your own face on this topic, you might want to first stop the
Quick snippets#
Publish data on the topic#
$ rostopic pub /robot_face sensor_msgs/Image # press Tab twice to complete
How to use in your code#
Publish to the topic using Python#
 1import rospy
 2from sensor_msgs.msg import Image
 3
 4if __name__ == "__main__":
 5    rospy.init_node("publisher")
 6
 7    pub = rospy.Publisher("/robot_face", Image, queue_size=10)
 8    rate = rospy.Rate(10) # 10Hz
 9    msg = Image()
10
11    while not rospy.is_shutdown():
12
13        # check http://docs.ros.org/en/api/sensor_msgs/html/msg/Image.html
14        # for the msg structure
15        # msg.data = ...
16        pub.publish(msg)
17
18        rate.sleep()
Publish to the topic using C++#
 1#include <ros/ros.h>
 2#include <sensor_msgs/Image.h>
 3
 4int main(int argc, char **argv)
 5{
 6    ros::init(argc, argv, "publisher");
 7    ros::NodeHandle n;
 8
 9    ros::Publisher pub = n.advertise<sensor_msgs::Image>("/robot_face", 10);
10
11    ros::Rate loop_rate(10); // 10Hz
12
13    while (ros::ok())
14    {
15        sensor_msgs::Image msg;
16        // check http://docs.ros.org/en/api/sensor_msgs/html/msg/Image.html
17        // for the msg structure
18        // msg.data = ...
19        pub.publish(msg);
20
21        ros::spinOnce();
22        loop_rate.sleep();
23    }
24    return 0;
25}