#include <ir_controller_node.h>
Public Member Functions | |
void | init () |
Initialize the node. | |
IRControllerNode (IrDriverInterface *ir_driver) | |
Parameterized constructor. | |
void | publish (std::string command) |
Publish the tv action. | |
bool | send_command (ir_controller_msgs::SetTvAction::Request &req, ir_controller_msgs::SetTvAction::Response &resp) |
Callback to manage the controller. | |
void | spin () |
Spin the node. | |
~IRControllerNode () | |
Destructor. | |
Private Attributes | |
ros::Publisher | _action_pub |
ros::ServiceServer | _action_srv |
IrDriverInterface * | _ir_driver |
bool | _is_on |
ros::NodeHandle | _nh |
ros::NodeHandle | _nh_private |
ros::Rate | _publish_rate |
Definition at line 35 of file ir_controller_node.h.
IRControllerNode::IRControllerNode | ( | IrDriverInterface * | ir_driver | ) |
Parameterized constructor.
ir_driver,the | driver interface. |
Definition at line 28 of file ir_controller_node.cpp.
Destructor.
Definition at line 42 of file ir_controller_node.cpp.
void IRControllerNode::init | ( | ) |
void IRControllerNode::publish | ( | std::string | command | ) |
Publish the tv action.
Definition at line 86 of file ir_controller_node.cpp.
bool IRControllerNode::send_command | ( | ir_controller_msgs::SetTvAction::Request & | req, |
ir_controller_msgs::SetTvAction::Response & | resp | ||
) |
Callback to manage the controller.
req | SetTvActions type request. |
resp | SetTvActions type response. |
Definition at line 68 of file ir_controller_node.cpp.
void IRControllerNode::spin | ( | ) |
ros::Publisher IRControllerNode::_action_pub [private] |
Definition at line 88 of file ir_controller_node.h.
Definition at line 90 of file ir_controller_node.h.
IrDriverInterface* IRControllerNode::_ir_driver [private] |
Definition at line 94 of file ir_controller_node.h.
bool IRControllerNode::_is_on [private] |
Definition at line 96 of file ir_controller_node.h.
ros::NodeHandle IRControllerNode::_nh [private] |
Definition at line 85 of file ir_controller_node.h.
ros::NodeHandle IRControllerNode::_nh_private [private] |
Definition at line 86 of file ir_controller_node.h.
ros::Rate IRControllerNode::_publish_rate [private] |
Definition at line 92 of file ir_controller_node.h.