fake_max_speed.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 # -*- coding: utf-8 -*-
3 
4 import rospy
5 from std_msgs.msg import Float64
6 
7 if __name__ == "__main__":
8  rospy.init_node("fake_max_speed")
9 
10  pub = rospy.Publisher("max_speed", Float64, queue_size=1)
11  max_speed = rospy.get_param("~max_speed", 2.0)
12  publish_rate = rospy.get_param("~publish_rate", 1)
13 
14  loop_rate = rospy.Rate(publish_rate)
15  max_speed_msg = max_speed
16  while not rospy.is_shutdown():
17  pub.publish(max_speed_msg)
18  loop_rate.sleep()


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