pose_array.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 import rospy
00004 import roslib
00005 
00006 
00007 from geometry_msgs.msg import PoseArray
00008 from jsk_footstep_msgs.msg import FootstepArray
00009 
00010 
00011 def cb(msg):
00012   global p
00013   array = PoseArray()
00014   array.header = msg.header
00015   for footstep in msg.footsteps:
00016     array.poses.append(footstep.pose)
00017   p.publish(array)
00018 
00019 rospy.init_node("foo")
00020 
00021 p = rospy.Publisher("pose_array", PoseArray)
00022 s = rospy.Subscriber("/footstep", FootstepArray, cb)
00023 
00024 rospy.spin()


jsk_footstep_planner
Author(s): Ryohei Ueda
autogenerated on Wed Sep 16 2015 04:37:57