sample_node.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 
3 import sys
4 
5 import rospy
6 from std_msgs.msg import String
7 
8 
9 def sample_node():
10  rospy.init_node('sample_node', anonymous=True)
11  pub = rospy.Publisher('/test_plugin', String, queue_size=10)
12  param1 = rospy.get_param('~param1')
13  param2 = rospy.get_param('~param2')
14  success = rospy.get_param('~success', False)
15  fail = rospy.get_param('~fail', False)
16  rospy.loginfo('~A started.'.format(rospy.get_name()))
17  rospy.loginfo('param1: {}'.format(param1))
18  rospy.loginfo('param2: {}'.format(param2))
19  rate = rospy.Rate(10) # 10hz
20  while not rospy.is_shutdown():
21  pub.publish("{{'param1': '{}', 'param2': '{}'}}".format(param1, param2))
22  if success:
23  sys.exit(0)
24  if fail:
25  sys.exit(1)
26  rate.sleep()
27 
28 if __name__ == '__main__':
29  try:
30  sample_node()
31  except rospy.ROSInterruptException:
32  pass


app_manager
Author(s): Jeremy Leibs, Ken Conley, Yuki Furuta
autogenerated on Thu Oct 13 2022 02:59:17