1 #ifndef RADIAL_MENU_BACKEND_BACKEND_NODELET_HPP 2 #define RADIAL_MENU_BACKEND_BACKEND_NODELET_HPP 8 #include <radial_menu_msgs/State.h> 13 #include <sensor_msgs/Joy.h> 28 if (!
model_->setDescriptionFromParam(nh.resolveName(
"menu_description"))) {
29 throw ros::Exception(
"Cannot set a model description from the param '" +
30 nh.resolveName(
"menu_description") +
"'");
37 state_pub_ = nh.advertise< radial_menu_msgs::State >(
"menu_state", 1,
true);
#define NODELET_INFO_STREAM(...)
ros::NodeHandle & getNodeHandle() const
ros::NodeHandle & getPrivateNodeHandle() const
void publish(const boost::shared_ptr< M > &message) const
const std::string & getNamespace() const