Classes | Functions | Variables
phidgets_high_speed_encoder.cpp File Reference
#include <ros/ros.h>
#include <stdio.h>
#include <cstdlib>
#include <sstream>
#include <std_msgs/String.h>
#include <vector>
#include <mutex>
#include <numeric>
#include "phidgets_api/encoder.h"
#include <sensor_msgs/JointState.h>
#include "phidgets_high_speed_encoder/EncoderDecimatedSpeed.h"
Include dependency graph for phidgets_high_speed_encoder.cpp:

Go to the source code of this file.

Classes

class  EncoderNode
 
struct  TStatePerChannel
 

Functions

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

Variables

std::vector< TStatePerChannelencoder_states
 
std::mutex encoder_states_mux
 
double PUBLISH_RATE = 20
 
int SPEED_FILTER_IDLE_ITER_LOOPS_BEFORE_RESET = 1
 
int SPEED_FILTER_SAMPLES_LEN = 10
 

Function Documentation

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

Definition at line 146 of file phidgets_high_speed_encoder.cpp.

Variable Documentation

std::vector<TStatePerChannel> encoder_states

Definition at line 62 of file phidgets_high_speed_encoder.cpp.

std::mutex encoder_states_mux

Definition at line 63 of file phidgets_high_speed_encoder.cpp.

double PUBLISH_RATE = 20

Definition at line 48 of file phidgets_high_speed_encoder.cpp.

int SPEED_FILTER_IDLE_ITER_LOOPS_BEFORE_RESET = 1

Definition at line 52 of file phidgets_high_speed_encoder.cpp.

int SPEED_FILTER_SAMPLES_LEN = 10

Definition at line 50 of file phidgets_high_speed_encoder.cpp.



phidgets_high_speed_encoder
Author(s): Geoff Viola
autogenerated on Tue May 7 2019 03:19:26