fake_cargo_max_volume.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 # -*- coding: utf-8 -*-
3 
4 import rospy
5 from geometry_msgs.msg import Point
6 
7 if __name__ == "__main__":
8  rospy.init_node("fake_cargo_max_volume")
9 
10  pub = rospy.Publisher("cargo_max_volume", Point, queue_size=1)
11  x = rospy.get_param("~x", 0.1)
12  y = rospy.get_param("~y", 0.2)
13  z = rospy.get_param("~z", float("nan"))
14  publish_rate = rospy.get_param("~publish_rate", 1)
15 
16  loop_rate = rospy.Rate(publish_rate)
17  cargo_max_volume_msg = Point()
18  cargo_max_volume_msg.x = float(x)
19  cargo_max_volume_msg.y = float(y)
20  cargo_max_volume_msg.z = float(z)
21  while not rospy.is_shutdown():
22  pub.publish(cargo_max_volume_msg)
23  loop_rate.sleep()


amr_interop_bridge
Author(s):
autogenerated on Tue Mar 1 2022 23:45:33