#include <command_sender.h>
Public Member Functions | |
CardCommandSender (ros::NodeHandle &nh) | |
bool | getState () const |
void | long_on () |
void | off () |
void | sendCommand (const ros::Time &time) override |
void | setZero () override |
void | short_on () |
![]() | |
CommandSenderBase (ros::NodeHandle &nh) | |
std_msgs::Float64 * | getMsg () |
void | setMode (int mode) |
virtual void | updateCapacityData (const rm_msgs::PowerManagementSampleAndStatusData data) |
virtual void | updateGameRobotStatus (const rm_msgs::GameRobotStatus data) |
virtual void | updateGameStatus (const rm_msgs::GameStatus data) |
virtual void | updatePowerHeatData (const rm_msgs::PowerHeatData data) |
Private Attributes | |
double | long_pos_ {} |
double | off_pos_ {} |
double | short_pos_ {} |
bool | state {} |
Additional Inherited Members | |
![]() | |
std_msgs::Float64 | msg_ |
ros::Publisher | pub_ |
uint32_t | queue_size_ |
std::string | topic_ |
Definition at line 707 of file command_sender.h.
|
inlineexplicit |
Definition at line 710 of file command_sender.h.
|
inline |
Definition at line 730 of file command_sender.h.
|
inline |
Definition at line 715 of file command_sender.h.
|
inline |
Definition at line 725 of file command_sender.h.
|
inlineoverridevirtual |
Reimplemented from rm_common::CommandSenderBase< std_msgs::Float64 >.
Definition at line 734 of file command_sender.h.
|
inlineoverridevirtual |
Implements rm_common::CommandSenderBase< std_msgs::Float64 >.
Definition at line 738 of file command_sender.h.
|
inline |
Definition at line 720 of file command_sender.h.
|
private |
Definition at line 742 of file command_sender.h.
|
private |
Definition at line 742 of file command_sender.h.
|
private |
Definition at line 742 of file command_sender.h.
|
private |
Definition at line 741 of file command_sender.h.