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

#include <service_caller.h>

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

Public Member Functions

int getArmorTarget ()
 
int getColor ()
 
uint8_t getExposureLevel ()
 
bool getIsSwitch ()
 
int getTarget ()
 
void setArmorTargetType (uint8_t armor_target)
 
void setColor (uint8_t color)
 
void setEnemyColor (const int &robot_id_, const std::string &robot_color_)
 
void setTargetType (uint8_t target)
 
void switchArmorTargetType ()
 
 SwitchDetectionCaller (ros::NodeHandle &nh)
 
 SwitchDetectionCaller (ros::NodeHandle &nh, std::string service_name)
 
void switchEnemyColor ()
 
void switchExposureLevel ()
 
void switchTargetType ()
 
- Public Member Functions inherited from rm_common::ServiceCallerBase< rm_msgs::StatusChange >
void callService ()
 
rm_msgs::StatusChange & getService ()
 
bool isCalling ()
 
 ServiceCallerBase (ros::NodeHandle &nh, const std::string &service_name="")
 
 ServiceCallerBase (ros::NodeHandle &nh, std::string &service_name)
 
 ServiceCallerBase (XmlRpc::XmlRpcValue &controllers, ros::NodeHandle &nh, const std::string &service_name="")
 
 ~ServiceCallerBase ()
 

Private Attributes

bool is_set_ {}
 

Additional Inherited Members

- Protected Member Functions inherited from rm_common::ServiceCallerBase< rm_msgs::StatusChange >
void callingThread ()
 
- Protected Attributes inherited from rm_common::ServiceCallerBase< rm_msgs::StatusChange >
ros::ServiceClient client_
 
int fail_count_
 
int fail_limit_
 
std::mutex mutex_
 
rm_msgs::StatusChange service_
 
std::string service_name_
 
std::thread * thread_
 

Detailed Description

Definition at line 215 of file service_caller.h.

Constructor & Destructor Documentation

◆ SwitchDetectionCaller() [1/2]

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

Definition at line 218 of file service_caller.h.

◆ SwitchDetectionCaller() [2/2]

rm_common::SwitchDetectionCaller::SwitchDetectionCaller ( ros::NodeHandle nh,
std::string  service_name 
)
inlineexplicit

Definition at line 227 of file service_caller.h.

Member Function Documentation

◆ getArmorTarget()

int rm_common::SwitchDetectionCaller::getArmorTarget ( )
inline

Definition at line 287 of file service_caller.h.

◆ getColor()

int rm_common::SwitchDetectionCaller::getColor ( )
inline

Definition at line 279 of file service_caller.h.

◆ getExposureLevel()

uint8_t rm_common::SwitchDetectionCaller::getExposureLevel ( )
inline

Definition at line 291 of file service_caller.h.

◆ getIsSwitch()

bool rm_common::SwitchDetectionCaller::getIsSwitch ( )
inline

Definition at line 295 of file service_caller.h.

◆ getTarget()

int rm_common::SwitchDetectionCaller::getTarget ( )
inline

Definition at line 283 of file service_caller.h.

◆ setArmorTargetType()

void rm_common::SwitchDetectionCaller::setArmorTargetType ( uint8_t  armor_target)
inline

Definition at line 269 of file service_caller.h.

◆ setColor()

void rm_common::SwitchDetectionCaller::setColor ( uint8_t  color)
inline

Definition at line 249 of file service_caller.h.

◆ setEnemyColor()

void rm_common::SwitchDetectionCaller::setEnemyColor ( const int &  robot_id_,
const std::string &  robot_color_ 
)
inline

Definition at line 236 of file service_caller.h.

◆ setTargetType()

void rm_common::SwitchDetectionCaller::setTargetType ( uint8_t  target)
inline

Definition at line 261 of file service_caller.h.

◆ switchArmorTargetType()

void rm_common::SwitchDetectionCaller::switchArmorTargetType ( )
inline

Definition at line 265 of file service_caller.h.

◆ switchEnemyColor()

void rm_common::SwitchDetectionCaller::switchEnemyColor ( )
inline

Definition at line 253 of file service_caller.h.

◆ switchExposureLevel()

void rm_common::SwitchDetectionCaller::switchExposureLevel ( )
inline

Definition at line 273 of file service_caller.h.

◆ switchTargetType()

void rm_common::SwitchDetectionCaller::switchTargetType ( )
inline

Definition at line 257 of file service_caller.h.

Member Data Documentation

◆ is_set_

bool rm_common::SwitchDetectionCaller::is_set_ {}
private

Definition at line 303 of file service_caller.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