44 #include <std_msgs/Float64.h> 45 #include <control_msgs/JointControllerState.h> 65 void callback(
const control_msgs::JointControllerStateConstPtr &msg)
69 command.data = msg->set_point;
83 int main(
int argc,
char **argv)
86 ros::init(argc, argv,
"link_joints_example");
void callback(const control_msgs::JointControllerStateConstPtr &msg)
std::string controller_type
Controller that controls joint position.
void publish(const boost::shared_ptr< M > &message) const
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
int main(int argc, char **argv)
ROSLIB_DECL std::string command(const std::string &cmd)
std::string child_name
the name of the child joint to link to the parent
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
std::string parent_name
the name of the parent joint