8 #include <std_msgs/Float64.h>
9 #include <std_srvs/Empty.h>
12 #include <controller_manager/controller_manager.h>
32 std::vector<std::string> velocity_joints_name = {
"front_left_wheel",
"front_right_wheel",
33 "rear_left_wheel",
"rear_right_wheel"};
35 for (
unsigned int i = 0; i < velocity_joints_name.size(); ++i)
45 std::vector<std::string> position_joints_name = {
"front_left_steering_joint",
"front_right_steering_joint",
46 "rear_left_steering_joint",
"rear_right_steering_joint"};
48 for (
unsigned int i = 0; i < position_joints_name.size(); ++i)
70 for (
unsigned int i = 0; i < 4; ++i)
78 for (
unsigned int i = 0; i < 4; ++i)
85 for (
unsigned int i = 0; i < 4; ++i)
90 for (
unsigned int i = 0; i < 4; ++i)
101 std::ostringstream os;
102 for (
unsigned int i = 0; i < 3; ++i)
111 for (
unsigned int i = 0; i < 3; ++i)