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)
144 Joint() : position(0), velocity(0), effort(0), velocity_command(0) { }
154 SteeringJoint() : position(0), velocity(0), effort(0), position_command(0) { }
void registerInterface(T *iface)
struct FourWheelSteering::Joint joints_[4]
ros::ServiceServer stop_srv_
ServiceServer advertiseService(ros::NodeHandle n, std::string name, boost::function< bool(const typename ActionSpec::_action_goal_type::_goal_type &, typename ActionSpec::_action_result_type::_result_type &result)> service_cb)
bool start_callback(std_srvs::Empty::Request &, std_srvs::Empty::Response &)
bool stop_callback(std_srvs::Empty::Request &, std_srvs::Empty::Response &)
struct FourWheelSteering::SteeringJoint steering_joints_[4]
#define ROS_DEBUG_STREAM(args)
hardware_interface::VelocityJointInterface jnt_vel_interface_
ros::ServiceServer start_srv_
void registerHandle(const JointStateHandle &handle)
ros::Duration getPeriod() const
hardware_interface::PositionJointInterface jnt_pos_interface_
hardware_interface::JointStateInterface jnt_state_interface_
ros::Time getTime() const