framefab_task_sequence_external_planner.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 #
3 # created by Yijiang Huang on Jan 25th, 2018
4 
5 import rospy
6 
7 # Publish
8 #from industrial_msgs.msg import RobotStatus
9 
10 # Subscribe
11 #from trajectory_msgs.msg import JointTrajectory
12 
13 # Services
14 #from industrial_msgs.srv import GetRobotInfo, GetRobotInfoResponse
15 
16 # Reference
17 #from industrial_msgs.msg import TriState, RobotMode, ServiceReturnCode, DeviceInfo
18 
19 """
20 %class name
21 
22 """
23 
24 class TempNode():
25  def __init__(self):
26  rospy.init_node('simple_tsep_node')
27  print("Hi, I'm baymax!")
28 
29 
30 if __name__ == '__main__':
31  try:
32  rospy.loginfo('Starting choreo_ts_external_planner')
33  temp = TempNode()
34  rospy.spin()
35  except rospy.ROSInterruptException:
36  pass


choreo_task_sequence_external_planner
Author(s): Yijiang Huang
autogenerated on Thu Jul 18 2019 03:59:26