Go to the documentation of this file.
35 #include <std_srvs/Empty.h>
38 #include <controller_manager/controller_manager.h>
50 template <
unsigned int NUM_JOINTS = 2>
60 std::fill_n(
pos_, NUM_JOINTS, 0.0);
61 std::fill_n(
vel_, NUM_JOINTS, 0.0);
62 std::fill_n(
eff_, NUM_JOINTS, 0.0);
63 std::fill_n(
cmd_, NUM_JOINTS, 0.0);
66 for (
unsigned int i = 0; i < NUM_JOINTS; ++i)
68 std::ostringstream os;
69 os <<
"wheel_" << i <<
"_joint";
90 for (
unsigned int i = 0; i < NUM_JOINTS; ++i)
101 std::fill_n(
pos_, NUM_JOINTS, std::numeric_limits<double>::quiet_NaN());
102 std::fill_n(
vel_, NUM_JOINTS, std::numeric_limits<double>::quiet_NaN());
109 std::ostringstream os;
110 for (
unsigned int i = 0; i < NUM_JOINTS - 1; ++i)
112 os <<
cmd_[i] <<
", ";
114 os <<
cmd_[NUM_JOINTS - 1];
JointStateHandle getHandle(const std::string &name)
hardware_interface::JointStateInterface jnt_state_interface_
void registerInterface(T *iface)
ros::Time getTime() const
hardware_interface::VelocityJointInterface jnt_vel_interface_
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)
#define ROS_INFO_STREAM(args)
void registerHandle(const JointStateHandle &handle)
bool stop_callback(std_srvs::Empty::Request &, std_srvs::Empty::Response &)
bool start_callback(std_srvs::Empty::Request &, std_srvs::Empty::Response &)
ros::Duration getPeriod() const
ros::ServiceServer start_srv_
ros::ServiceServer stop_srv_