Public Member Functions | Public Attributes | Private Attributes | List of all members
rm_gimbal_controllers::ChassisVel Class Reference

#include <gimbal_base.h>

Public Member Functions

 ChassisVel (const ros::NodeHandle &nh)
 
void update (double linear_vel[3], double angular_vel[3], double period)
 

Public Attributes

std::shared_ptr< Vector3WithFilter< double > > angular_
 
std::shared_ptr< Vector3WithFilter< double > > linear_
 

Private Attributes

std::shared_ptr< realtime_tools::RealtimePublisher< geometry_msgs::Twist > > filtered_pub_ {}
 
bool is_debug_
 
int loop_count_
 
std::shared_ptr< realtime_tools::RealtimePublisher< geometry_msgs::Twist > > real_pub_ {}
 

Detailed Description

Definition at line 99 of file gimbal_base.h.

Constructor & Destructor Documentation

◆ ChassisVel()

rm_gimbal_controllers::ChassisVel::ChassisVel ( const ros::NodeHandle nh)
inline

Definition at line 102 of file gimbal_base.h.

Member Function Documentation

◆ update()

void rm_gimbal_controllers::ChassisVel::update ( double  linear_vel[3],
double  angular_vel[3],
double  period 
)
inline

Definition at line 117 of file gimbal_base.h.

Member Data Documentation

◆ angular_

std::shared_ptr<Vector3WithFilter<double> > rm_gimbal_controllers::ChassisVel::angular_

Definition at line 116 of file gimbal_base.h.

◆ filtered_pub_

std::shared_ptr<realtime_tools::RealtimePublisher<geometry_msgs::Twist> > rm_gimbal_controllers::ChassisVel::filtered_pub_ {}
private

Definition at line 159 of file gimbal_base.h.

◆ is_debug_

bool rm_gimbal_controllers::ChassisVel::is_debug_
private

Definition at line 157 of file gimbal_base.h.

◆ linear_

std::shared_ptr<Vector3WithFilter<double> > rm_gimbal_controllers::ChassisVel::linear_

Definition at line 115 of file gimbal_base.h.

◆ loop_count_

int rm_gimbal_controllers::ChassisVel::loop_count_
private

Definition at line 158 of file gimbal_base.h.

◆ real_pub_

std::shared_ptr<realtime_tools::RealtimePublisher<geometry_msgs::Twist> > rm_gimbal_controllers::ChassisVel::real_pub_ {}
private

Definition at line 159 of file gimbal_base.h.


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


rm_gimbal_controllers
Author(s): Qiayuan Liao
autogenerated on Sun May 4 2025 02:57:21