49 int pos = name.find_last_of(
'/');
50 name_ = name.substr(pos + 1);
86 while (
ros::ok() && !shutdown_requested_)
boost::shared_ptr< RandomWalkerController > controller_
Pointer to the random walker controller.
virtual void onInit()
Initialise the nodelet.
#define NODELET_INFO_STREAM(...)
const std::string & getUnresolvedNamespace() const
bool shutdown_requested_
Flag for stopping the update thread.
PLUGINLIB_EXPORT_CLASS(kobuki::RandomWalkerControllerNodelet, nodelet::Nodelet)
double update_rate_
Spin rate for the update thread.
~RandomWalkerControllerNodelet()
void update()
Method for update thread.
ros::NodeHandle & getPrivateNodeHandle() const
RandomWalkerControllerNodelet()
std::string name_
Node(let) name.
#define NODELET_ERROR_STREAM(...)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
ecl::Thread update_thread_
Update thread for publishing velocity and LED commands.
Nodelet-wrapper of the RandomWalkerController class.
#define NODELET_DEBUG_STREAM(...)