<table cellspacing="0" cellpadding="0" border="0" ><tr><td valign="top" style="font: inherit;"><span style="font-weight: bold;">Hi Ken,<br><br>this is actually what I was looking for, unfortunately your example does not compile:<br><br>ros::Subscriber chatter_sub1 = n.subscribe("chatter", 100, boost::bind(chatterCallback1, _1, 10));<br><br>I used this for my example and the following error is returned:<br><br>error: no matching function for call to ‘ros::NodeHandle::subscribe(const char [8], int, boost::_bi::bind_t<void, void (*)(const std_msgs::StringConstPtr&, int), boost::_bi::list2<boost::arg<1>, boost::_bi::value<int> > >)’<br><br>note: candidates are: ros::Subscriber ros::NodeHandle::subscribe(ros::SubscribeOptions&)<br><br><br>Do you have any hints for me (my boost knowledge is rather low)<br></span></td></tr></table><br>