Go to the documentation of this file.00001
00002
00003 import roslib
00004 roslib.load_manifest('room_explore')
00005 import rospy
00006
00007 from geometry_msgs.msg import PoseWithCovarianceStamped
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020
00021
00022
00023
00024
00025
00026
00027
00028 if __name__ == '__main__':
00029 rospy.init_node( 'pose_setter' )
00030
00031 pub = rospy.Publisher( '/initialpose', PoseWithCovarianceStamped )
00032 rospy.sleep( 1.0 )
00033
00034 ps = PoseWithCovarianceStamped()
00035 ps.header.stamp = rospy.Time(0)
00036 ps.header.frame_id = '/base_link'
00037 ps.pose.pose.orientation.w = 1.0
00038 ps.pose.covariance = [0.01, 0.0, 0.0, 0.0, 0.0,
00039 0.0, 0.0, 0.01, 0.0, 0.0,
00040 0.0, 0.0, 0.0, 0.0, 0.0,
00041 0.0, 0.0, 0.0, 0.0, 0.0,
00042 0.0, 0.005, 0.0, 0.0, 0.0, 0.0, 0.0,
00043 0.0, 0.0, 0.0, 0.0, 0.0,
00044 0.0, 0.0, 0.0, 0.0]
00045 print ps
00046 pub.publish( ps )
00047
00048
00049