#include <command_sender.h>
Public Member Functions | |
bool | getJump () |
double | getLgeLength () |
LegCommandSender (ros::NodeHandle &nh) | |
void | setJump (bool jump) |
void | setLgeLength (double length) |
void | setZero () override |
![]() | |
CommandSenderBase (ros::NodeHandle &nh) | |
rm_msgs::LegCmd * | getMsg () |
virtual void | sendCommand (const ros::Time &time) |
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) |
Additional Inherited Members | |
![]() | |
rm_msgs::LegCmd | msg_ |
ros::Publisher | pub_ |
uint32_t | queue_size_ |
std::string | topic_ |
Definition at line 599 of file command_sender.h.
|
inlineexplicit |
Definition at line 602 of file command_sender.h.
|
inline |
Definition at line 614 of file command_sender.h.
|
inline |
Definition at line 618 of file command_sender.h.
|
inline |
Definition at line 606 of file command_sender.h.
|
inline |
Definition at line 610 of file command_sender.h.
|
inlineoverridevirtual |
Implements rm_common::CommandSenderBase< rm_msgs::LegCmd >.
Definition at line 622 of file command_sender.h.