Variables | |
args = rospy.myargv(argv=sys.argv) | |
int | node_name = args[1]iflen(args)>1 |
pub = rospy.Publisher(topic_name, std_msgs.msg.String, queue_size=1) | |
rate = rospy.Rate(10) | |
test_message = rospy.get_param("~test_message", "") | |
topic_name = rospy.get_param("~topic_name", "") | |
A dummy ROS node
string_pub_node.args = rospy.myargv(argv=sys.argv) |
Definition at line 16 of file string_pub_node.py.
Definition at line 17 of file string_pub_node.py.
string_pub_node.pub = rospy.Publisher(topic_name, std_msgs.msg.String, queue_size=1) |
Definition at line 33 of file string_pub_node.py.
string_pub_node.rate = rospy.Rate(10) |
Definition at line 35 of file string_pub_node.py.
string_pub_node.test_message = rospy.get_param("~test_message", "") |
Definition at line 27 of file string_pub_node.py.
string_pub_node.topic_name = rospy.get_param("~topic_name", "") |
Definition at line 22 of file string_pub_node.py.