Can't visualize Pose in Rviz
I'm trying to implement a path planning algorithm on a static image. I have obtained an occupancy grid and have also published a point via geometry_msgs/PoseStamped, but i cannot visualize this on Rviz .
This is the publisher that Ive written
pub = rospy.Publisher('move_base_simple/goal',PoseStamped,queue_size=1)
rospy.init_node('pose_publisher',anonymous = True)
rate = rospy.Rate(1)
while not rospy.is_shutdown():
p = PoseStamped()
p.header.seq = 1
p.header.stamp = rospy.Time.now()
p.header.frame_id = 'map'
p.pose.position.x = 100
p.pose.position.y = 100
p.pose.position.z = 0
p.pose.orientation.x = 0
p.pose.orientation.x = 0
p.pose.orientation.x = 0
p.pose.orientation.w = 1
pub.publish(p)
rate.sleep()
What am i doing wrong