3 from std_msgs.msg
import Float64
4 from geometry_msgs.msg
import Twist
5 from trajectory_msgs.msg
import JointTrajectory
8 supported_controllers = [
"effort_controllers/JointPositionController",
9 "position_controllers/JointTrajectoryController",
10 "diff_drive_controller/DiffDriveController",
11 "steer_drive_controller/SteerDriveController"]
14 ignore_controller_joints = [
"effort_controllers/JointPositionController",
15 "diff_drive_controller/DiffDriveController",
16 "steer_drive_controller/SteerDriveController"]
19 non_step_controllers = [
"diff_drive_controller/DiffDriveController",
20 "steer_drive_controller/SteerDriveController"]
23 message_field_controllers = [
"position_controllers/JointTrajectoryController",
24 "diff_drive_controller/DiffDriveController",
25 "steer_drive_controller/SteerDriveController"]
28 twist_controllers = [
"diff_drive_controller/DiffDriveController",
29 "steer_drive_controller/SteerDriveController"]
32 joint_traj_controllers = [
"position_controllers/JointTrajectoryController"]
35 float_controllers = [
"effort_controllers/JointPositionController"]
38 "effort_controllers/JointPositionController":
"/command",
39 "position_controllers/JointTrajectoryController":
"/command",
40 "diff_drive_controller/DiffDriveController":
"/cmd_vel",
41 "steer_drive_controller/SteerDriveController":
"/cmd_vel" 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