controllers_info.py
Go to the documentation of this file.
1 # A file with lists of supported controllers and other
2 # categorisations on those controllers
3 from std_msgs.msg import Float64
4 from geometry_msgs.msg import Twist
5 from trajectory_msgs.msg import JointTrajectory
6 
7 # A list of controllers that this script can handle
8 supported_controllers = ["effort_controllers/JointPositionController",
9  "position_controllers/JointTrajectoryController",
10  "diff_drive_controller/DiffDriveController",
11  "steer_drive_controller/SteerDriveController"]
12 
13 # A list of controllers that do not apply on specific joints
14 ignore_controller_joints = ["effort_controllers/JointPositionController",
15  "diff_drive_controller/DiffDriveController",
16  "steer_drive_controller/SteerDriveController"]
17 
18 # A list of controllers that do not need a step value, but an explicit one (like velocity)
19 non_step_controllers = ["diff_drive_controller/DiffDriveController",
20  "steer_drive_controller/SteerDriveController"]
21 
22 # A list of controllers that need a user specified message field (e.g. "linear.x")
23 message_field_controllers = ["position_controllers/JointTrajectoryController",
24  "diff_drive_controller/DiffDriveController",
25  "steer_drive_controller/SteerDriveController"]
26 
27 # A list of controllers that their command is based on a Twist message
28 twist_controllers = ["diff_drive_controller/DiffDriveController",
29  "steer_drive_controller/SteerDriveController"]
30 
31 # A list of controllers that their commands is based on a JointTrajectory message
32 joint_traj_controllers = ["position_controllers/JointTrajectoryController"]
33 
34 # A list of controllers that their commands is based on a Float64 message
35 float_controllers = ["effort_controllers/JointPositionController"]
36 
37 topic_extension = {
38  "effort_controllers/JointPositionController": "/command",
39  "position_controllers/JointTrajectoryController": "/command",
40  "diff_drive_controller/DiffDriveController": "/cmd_vel",
41  "steer_drive_controller/SteerDriveController": "/cmd_vel"
42  }
43 
44 controller_type_correspondence = {
45  "effort_controllers/JointPositionController": Float64,
46  "position_controllers/JointTrajectoryController": JointTrajectory,
47  "diff_drive_controller/DiffDriveController": Twist,
48  "steer_drive_controller/SteerDriveController": Twist
49  }
50 
51 


jointstick
Author(s): George Stavrinos
autogenerated on Mon Jun 10 2019 13:38:17