58 int pos =
name_.find_last_of(
'/');
61 double spin_rate_param = 20;
62 if(nh.
getParam(
"spin_rate", spin_rate_param))
68 ROS_WARN_STREAM(
"Couldn't retrieve parameter 'spin_rate' from parameter server! Using default '" 69 << spin_rate_param <<
"'. [" <<
name_ <<
"]");
72 bool start_enabled =
true;
73 nh.
getParam(
"start_enabled", start_enabled);
#define NODELET_INFO_STREAM(...)
const std::string & getUnresolvedNamespace() const
A controller for driving a differential drive base to a pose goal or along a path specified by multip...
~DiffDrivePoseControllerNodelet()
ros::NodeHandle & getPrivateNodeHandle() const
#define NODELET_ERROR_STREAM(...)
#define ROS_WARN_STREAM(args)
#define ROS_DEBUG_STREAM(args)
#define NODELET_DEBUG_STREAM(...)
#define ROS_INFO_STREAM(args)
bool getParam(const std::string &key, std::string &s) const
ecl::Thread update_thread_
boost::shared_ptr< DiffDrivePoseControllerROS > controller_
DiffDrivePoseControllerNodelet()
PLUGINLIB_EXPORT_CLASS(yocs::DiffDrivePoseControllerNodelet, nodelet::Nodelet)