概述
#!/usr/bin/env python import rospy import math from tf import transformations from geometry_msgs.msg import PoseWithCovarianceStamped class PoseSetter(rospy.SubscribeListener): def __init__(self, pose): self.pose = pose def peer_subscribe(self, topic_name, topic_publish, peer_publish): p = PoseWithCovarianceStamped() p.header.frame_id = "map" p.pose.pose.position.x = self.pose[0] p.pose.pose.position.y = self.pose[1] (p.pose.pose.orientation.x, p.pose.pose.orientation.y, p.pose.pose.orientation.z, p.pose.pose.orientation.w) = transformations.quaternion_from_euler(0, 0, self.pose[2]) p.pose.covariance[6*0+0] = 0.5 * 0.5 p.pose.covariance[6*1+1] = 0.5 * 0.5 p.pose.covariance[6*3+3] = math.pi/12.0 * math.pi/12.0 peer_publish(p) x=True pose = [-9.983256,-2.641909,-1.201580]#x,y,a rospy.init_node('pose_setter', anonymous=True) pub=rospy.Publisher("initialpose", PoseWithCovarianceStamped, queue_size=10) pub.publish(PoseSetter(pose))
转载于:https://www.cnblogs.com/sea-stream/p/10242103.html
最后
以上就是拉长御姐为你收集整理的python ros 重新设置机器人的位置的全部内容,希望文章能够帮你解决python ros 重新设置机器人的位置所遇到的程序开发问题。
如果觉得靠谱客网站的内容还不错,欢迎将靠谱客网站推荐给程序员好友。
本图文内容来源于网友提供,作为学习参考使用,或来自网络收集整理,版权属于原作者所有。
发表评论 取消回复