首页 > 编程语言 > 详细

python ros 订阅robot_pose获取机器人位置

时间:2019-01-09 01:09:33      阅读:635      评论:0      收藏:0      [点我收藏+]

 

#!/usr/bin/env python
import rospy
import tf
from tf.transformations import *
from std_msgs.msg import String
from geometry_msgs.msg import Pose
from geometry_msgs.msg import Quaternion


def get_pos(data):
    (roll, pitch, yaw) = euler_from_quaternion([data.orientation.x, data.orientation.y, data.orientation.z, data.orientation.w])
    rospy.loginfo("current position(x:%f,y:%f,z:%f),theta:%f", data.position.x, data.position.y, data.position.z, yaw)
    #rospy.loginfo("current position(x:%f,y:%f,z:%f)", data.position.x, data.position.y, data.position.z)


def poslistener():
    # In ROS, nodes are uniquely named. If two nodes with the same
    # name are launched, the previous one is kicked off. The
    # anonymous=True flag means that rospy will choose a unique
    # name for our listener node so that multiple listeners can
    # run simultaneously.
    rospy.init_node(poslistener, anonymous=True)

    rospy.Subscriber("robot_pose", Pose, get_pos)

    # spin() simply keeps python from exiting until this node is stopped
    rospy.spin()


if __name__ == __main__:
    poslistener()

 

python ros 订阅robot_pose获取机器人位置

原文:https://www.cnblogs.com/sea-stream/p/10242112.html

(0)
(0)
   
举报
评论 一句话评论(0
关于我们 - 联系我们 - 留言反馈 - 联系我们:wmxa8@hotmail.com
© 2014 bubuko.com 版权所有
打开技术之扣,分享程序人生!