naoqidriver
Public Member Functions | Private Attributes
naoqi::service::RobotConfigService Class Reference

#include <robot_config.hpp>

Public Member Functions

 RobotConfigService (const std::string &name, const std::string &topic)
 
 ~RobotConfigService ()
 
std::string name () const
 
std::string topic () const
 
void reset (ros::NodeHandle &nh)
 
bool callback (std_srvs::Empty::Request &req, std_srvs::Empty::Response &resp)
 

Private Attributes

const std::string name_
 
const std::string topic_
 
ros::ServiceServer service_
 

Constructor & Destructor Documentation

naoqi::service::RobotConfigService::RobotConfigService ( const std::string &  name,
const std::string &  topic 
)
naoqi::service::RobotConfigService::~RobotConfigService ( )
inline

Member Function Documentation

bool naoqi::service::RobotConfigService::callback ( std_srvs::Empty::Request &  req,
std_srvs::Empty::Response &  resp 
)
std::string naoqi::service::RobotConfigService::name ( ) const
inline
void naoqi::service::RobotConfigService::reset ( ros::NodeHandle &  nh)
std::string naoqi::service::RobotConfigService::topic ( ) const
inline

Field Documentation

const std::string naoqi::service::RobotConfigService::name_
private
ros::ServiceServer naoqi::service::RobotConfigService::service_
private
const std::string naoqi::service::RobotConfigService::topic_
private

The documentation for this class was generated from the following files: