Functions | Variables
node.cpp File Reference
#include <memory>
#include <numeric>
#include <ros/ros.h>
#include <std_msgs/Float32.h>
#include <std_msgs/Float64.h>
#include <std_msgs/Int16.h>
#include <std_msgs/Int32.h>
#include <std_msgs/Int64.h>
#include <std_msgs/Int8.h>
#include <std_msgs/UInt16.h>
#include <std_msgs/UInt32.h>
#include <std_msgs/UInt64.h>
#include <std_msgs/UInt8.h>
Include dependency graph for node.cpp:

Go to the source code of this file.

Functions

template<class T , class U >
void callbackD (const T &msg)
 
void callbackFloat32 (const std_msgs::Float32ConstPtr &msg)
 
void callbackFloat64 (const std_msgs::Float64ConstPtr &msg)
 
template<class T , class U >
void callbackI (const T &msg)
 
void callbackInt16 (const std_msgs::Int16ConstPtr &msg)
 
void callbackInt32 (const std_msgs::Int32ConstPtr &msg)
 
void callbackInt64 (const std_msgs::Int64ConstPtr &msg)
 
void callbackInt8 (const std_msgs::Int8ConstPtr &msg)
 
template<class T , class U >
void callbackU (const T &msg)
 
void callbackUInt16 (const std_msgs::UInt16ConstPtr &msg)
 
void callbackUInt32 (const std_msgs::UInt32ConstPtr &msg)
 
void callbackUInt64 (const std_msgs::UInt64ConstPtr &msg)
 
void callbackUInt8 (const std_msgs::UInt8ConstPtr &msg)
 
int main (int argc, char *argv[])
 

Variables

std::unique_ptr< ros::NodeHandlenh
 
std::unique_ptr< ros::Publisherpub
 
std::vector< std::pair< ros::Time, double > > time_values_d
 
std::vector< std::pair< ros::Time, int64_t > > time_values_i
 
std::vector< std::pair< ros::Time, uint64_t > > time_values_u
 
ros::Duration window_length
 

Function Documentation

◆ callbackD()

template<class T , class U >
void callbackD ( const T &  msg)

Definition at line 116 of file node.cpp.

◆ callbackFloat32()

void callbackFloat32 ( const std_msgs::Float32ConstPtr &  msg)

Definition at line 143 of file node.cpp.

◆ callbackFloat64()

void callbackFloat64 ( const std_msgs::Float64ConstPtr &  msg)

Definition at line 148 of file node.cpp.

◆ callbackI()

template<class T , class U >
void callbackI ( const T &  msg)

Definition at line 24 of file node.cpp.

◆ callbackInt16()

void callbackInt16 ( const std_msgs::Int16ConstPtr &  msg)

Definition at line 54 of file node.cpp.

◆ callbackInt32()

void callbackInt32 ( const std_msgs::Int32ConstPtr &  msg)

Definition at line 59 of file node.cpp.

◆ callbackInt64()

void callbackInt64 ( const std_msgs::Int64ConstPtr &  msg)

Definition at line 64 of file node.cpp.

◆ callbackInt8()

void callbackInt8 ( const std_msgs::Int8ConstPtr &  msg)

Definition at line 49 of file node.cpp.

◆ callbackU()

template<class T , class U >
void callbackU ( const T &  msg)

Definition at line 70 of file node.cpp.

◆ callbackUInt16()

void callbackUInt16 ( const std_msgs::UInt16ConstPtr &  msg)

Definition at line 100 of file node.cpp.

◆ callbackUInt32()

void callbackUInt32 ( const std_msgs::UInt32ConstPtr &  msg)

Definition at line 105 of file node.cpp.

◆ callbackUInt64()

void callbackUInt64 ( const std_msgs::UInt64ConstPtr &  msg)

Definition at line 110 of file node.cpp.

◆ callbackUInt8()

void callbackUInt8 ( const std_msgs::UInt8ConstPtr &  msg)

Definition at line 95 of file node.cpp.

◆ main()

int main ( int  argc,
char *  argv[] 
)

Definition at line 153 of file node.cpp.

Variable Documentation

◆ nh

std::unique_ptr<ros::NodeHandle> nh

Definition at line 15 of file node.cpp.

◆ pub

std::unique_ptr<ros::Publisher> pub

Definition at line 16 of file node.cpp.

◆ time_values_d

std::vector<std::pair<ros::Time, double> > time_values_d

Definition at line 21 of file node.cpp.

◆ time_values_i

std::vector<std::pair<ros::Time, int64_t> > time_values_i

Definition at line 19 of file node.cpp.

◆ time_values_u

std::vector<std::pair<ros::Time, uint64_t> > time_values_u

Definition at line 20 of file node.cpp.

◆ window_length

ros::Duration window_length

Definition at line 18 of file node.cpp.



moving_average
Author(s): Victor Lamoine - Institut Maupertuis
autogenerated on Mon Feb 28 2022 22:50:22