Public Member Functions | Private Attributes | List of all members
rm_common::JointPositionBinaryCommandSender Class Reference

#include <command_sender.h>

Inheritance diagram for rm_common::JointPositionBinaryCommandSender:
Inheritance graph
[legend]

Public Member Functions

void changePosition (double scale)
 
bool getState () const
 
 JointPositionBinaryCommandSender (ros::NodeHandle &nh)
 
void off ()
 
void on ()
 
void sendCommand (const ros::Time &time) override
 
void setZero () override
 
- Public Member Functions inherited from rm_common::CommandSenderBase< std_msgs::Float64 >
 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 change_position_ {}
 
double current_position_ {}
 
double off_pos_ {}
 
double on_pos_ {}
 
double per_change_position_ { 0.05 }
 
bool state {}
 

Additional Inherited Members

- Protected Attributes inherited from rm_common::CommandSenderBase< std_msgs::Float64 >
std_msgs::Float64 msg_
 
ros::Publisher pub_
 
uint32_t queue_size_
 
std::string topic_
 

Detailed Description

Definition at line 669 of file command_sender.h.

Constructor & Destructor Documentation

◆ JointPositionBinaryCommandSender()

rm_common::JointPositionBinaryCommandSender::JointPositionBinaryCommandSender ( ros::NodeHandle nh)
inlineexplicit

Definition at line 672 of file command_sender.h.

Member Function Documentation

◆ changePosition()

void rm_common::JointPositionBinaryCommandSender::changePosition ( double  scale)
inline

Definition at line 686 of file command_sender.h.

◆ getState()

bool rm_common::JointPositionBinaryCommandSender::getState ( ) const
inline

Definition at line 692 of file command_sender.h.

◆ off()

void rm_common::JointPositionBinaryCommandSender::off ( )
inline

Definition at line 681 of file command_sender.h.

◆ on()

void rm_common::JointPositionBinaryCommandSender::on ( )
inline

Definition at line 676 of file command_sender.h.

◆ sendCommand()

void rm_common::JointPositionBinaryCommandSender::sendCommand ( const ros::Time time)
inlineoverridevirtual

Reimplemented from rm_common::CommandSenderBase< std_msgs::Float64 >.

Definition at line 696 of file command_sender.h.

◆ setZero()

void rm_common::JointPositionBinaryCommandSender::setZero ( )
inlineoverridevirtual

Member Data Documentation

◆ change_position_

double rm_common::JointPositionBinaryCommandSender::change_position_ {}
private

Definition at line 704 of file command_sender.h.

◆ current_position_

double rm_common::JointPositionBinaryCommandSender::current_position_ {}
private

Definition at line 704 of file command_sender.h.

◆ off_pos_

double rm_common::JointPositionBinaryCommandSender::off_pos_ {}
private

Definition at line 704 of file command_sender.h.

◆ on_pos_

double rm_common::JointPositionBinaryCommandSender::on_pos_ {}
private

Definition at line 704 of file command_sender.h.

◆ per_change_position_

double rm_common::JointPositionBinaryCommandSender::per_change_position_ { 0.05 }
private

Definition at line 704 of file command_sender.h.

◆ state

bool rm_common::JointPositionBinaryCommandSender::state {}
private

Definition at line 703 of file command_sender.h.


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


rm_common
Author(s):
autogenerated on Thu Mar 6 2025 03:23:29