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

#include <command_sender.h>

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

Public Member Functions

bool getEject () const
 
 GimbalCommandSender (ros::NodeHandle &nh)
 
void setBulletSpeed (double bullet_speed)
 
void setEject (bool flag)
 
void setGimbalTraj (double traj_yaw, double traj_pitch)
 
void setGimbalTrajFrameId (const std::string &traj_frame_id)
 
void setPoint (geometry_msgs::PointStamped point)
 
void setRate (double scale_yaw, double scale_pitch)
 
void setUseRc (bool flag)
 
void setZero () override
 
 ~GimbalCommandSender ()=default
 
- Public Member Functions inherited from rm_common::TimeStampCommandSenderBase< rm_msgs::GimbalCmd >
void sendCommand (const ros::Time &time) override
 
 TimeStampCommandSenderBase (ros::NodeHandle &nh)
 
- Public Member Functions inherited from rm_common::CommandSenderBase< rm_msgs::GimbalCmd >
 CommandSenderBase (ros::NodeHandle &nh)
 
rm_msgs::GimbalCmd * 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

bool eject_flag_ {}
 
double eject_sensitivity_ = 1.
 
double max_pitch_vel_ {}
 
double max_yaw_vel_ {}
 
double time_constant_pc_ {}
 
double time_constant_rc_ {}
 
double track_timeout_ {}
 
bool use_rc_ {}
 

Additional Inherited Members

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

Detailed Description

Definition at line 318 of file command_sender.h.

Constructor & Destructor Documentation

◆ GimbalCommandSender()

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

Definition at line 321 of file command_sender.h.

◆ ~GimbalCommandSender()

rm_common::GimbalCommandSender::~GimbalCommandSender ( )
default

Member Function Documentation

◆ getEject()

bool rm_common::GimbalCommandSender::getEject ( ) const
inline

Definition at line 383 of file command_sender.h.

◆ setBulletSpeed()

void rm_common::GimbalCommandSender::setBulletSpeed ( double  bullet_speed)
inline

Definition at line 371 of file command_sender.h.

◆ setEject()

void rm_common::GimbalCommandSender::setEject ( bool  flag)
inline

Definition at line 375 of file command_sender.h.

◆ setGimbalTraj()

void rm_common::GimbalCommandSender::setGimbalTraj ( double  traj_yaw,
double  traj_pitch 
)
inline

Definition at line 357 of file command_sender.h.

◆ setGimbalTrajFrameId()

void rm_common::GimbalCommandSender::setGimbalTrajFrameId ( const std::string &  traj_frame_id)
inline

Definition at line 362 of file command_sender.h.

◆ setPoint()

void rm_common::GimbalCommandSender::setPoint ( geometry_msgs::PointStamped  point)
inline

Definition at line 387 of file command_sender.h.

◆ setRate()

void rm_common::GimbalCommandSender::setRate ( double  scale_yaw,
double  scale_pitch 
)
inline

Definition at line 337 of file command_sender.h.

◆ setUseRc()

void rm_common::GimbalCommandSender::setUseRc ( bool  flag)
inline

Definition at line 379 of file command_sender.h.

◆ setZero()

void rm_common::GimbalCommandSender::setZero ( )
inlineoverridevirtual

Member Data Documentation

◆ eject_flag_

bool rm_common::GimbalCommandSender::eject_flag_ {}
private

Definition at line 395 of file command_sender.h.

◆ eject_sensitivity_

double rm_common::GimbalCommandSender::eject_sensitivity_ = 1.
private

Definition at line 393 of file command_sender.h.

◆ max_pitch_vel_

double rm_common::GimbalCommandSender::max_pitch_vel_ {}
private

Definition at line 393 of file command_sender.h.

◆ max_yaw_vel_

double rm_common::GimbalCommandSender::max_yaw_vel_ {}
private

Definition at line 393 of file command_sender.h.

◆ time_constant_pc_

double rm_common::GimbalCommandSender::time_constant_pc_ {}
private

Definition at line 394 of file command_sender.h.

◆ time_constant_rc_

double rm_common::GimbalCommandSender::time_constant_rc_ {}
private

Definition at line 394 of file command_sender.h.

◆ track_timeout_

double rm_common::GimbalCommandSender::track_timeout_ {}
private

Definition at line 393 of file command_sender.h.

◆ use_rc_

bool rm_common::GimbalCommandSender::use_rc_ {}
private

Definition at line 395 of file command_sender.h.


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


rm_common
Author(s):
autogenerated on Tue May 6 2025 02:23:36