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

#include <command_sender.h>

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

Public Member Functions

 CameraSwitchCommandSender (ros::NodeHandle &nh)
 
void sendCommand (const ros::Time &time) override
 
void setZero () override
 
void switchCamera ()
 
- Public Member Functions inherited from rm_common::CommandSenderBase< std_msgs::String >
 CommandSenderBase (ros::NodeHandle &nh)
 
std_msgs::String * 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

std::string camera1_name_ {}
 
std::string camera2_name_ {}
 

Additional Inherited Members

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

Detailed Description

Definition at line 823 of file command_sender.h.

Constructor & Destructor Documentation

◆ CameraSwitchCommandSender()

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

Definition at line 826 of file command_sender.h.

Member Function Documentation

◆ sendCommand()

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

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

Definition at line 835 of file command_sender.h.

◆ setZero()

void rm_common::CameraSwitchCommandSender::setZero ( )
inlineoverridevirtual

◆ switchCamera()

void rm_common::CameraSwitchCommandSender::switchCamera ( )
inline

Definition at line 831 of file command_sender.h.

Member Data Documentation

◆ camera1_name_

std::string rm_common::CameraSwitchCommandSender::camera1_name_ {}
private

Definition at line 842 of file command_sender.h.

◆ camera2_name_

std::string rm_common::CameraSwitchCommandSender::camera2_name_ {}
private

Definition at line 842 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