Go to the documentation of this file.00001
00002
00003 import roslib
00004 roslib.load_manifest("kelsey_sandbox")
00005 import rospy
00006 from visualization_msgs.msg import Marker
00007 from geometry_msgs.msg import Point, Quaternion, Vector3
00008 from std_msgs.msg import ColorRGBA
00009
00010 def main():
00011 rospy.init_node("test_markers")
00012 vis_pub = rospy.Publisher("test_markers", Marker)
00013 x = 0.
00014 while not rospy.is_shutdown():
00015 m = Marker()
00016 m.header.frame_id = "torso_lift_link"
00017 m.header.stamp = rospy.Time()
00018 m.ns = "test"
00019 m.type = Marker.ARROW
00020 m.action = Marker.ADD
00021 m.pose.position = Point(x, 0., 0.)
00022 m.pose.orientation = Quaternion(0., 0., 0., 1.)
00023 m.scale = Vector3(1.0, 1.0, 1.0)
00024 m.color = ColorRGBA(1., 0., 0., 1.)
00025 vis_pub.publish(m)
00026 x += 0.01
00027 rospy.sleep(0.1)
00028
00029
00030
00031
00032 if __name__ == "__main__":
00033 main()