This is an intermediate CodDecod class for any ethercat slave device that only has digital and analog (16bit) inputs and outputs. It decodes and encodes the status and commands, publishes the inputs of the device to a topic and reads commands from a topic to set the outputs of the device (this may be incompatible with the system functionality and will probably have to be removed). This object is not interacting in any way with the HardwareInterface. Its children (e.g. cod_decod_01) will. More...
#include "sr_ronex_drivers/cod_decod/cod_decod.hpp"
#include <sr_ronex_msgs/BoolArray.h>
#include <std_msgs/UInt16MultiArray.h>
#include "realtime_tools/realtime_box.h"
#include "realtime_tools/realtime_publisher.h"
#include <vector>
Go to the source code of this file.
This is an intermediate CodDecod class for any ethercat slave device that only has digital and analog (16bit) inputs and outputs. It decodes and encodes the status and commands, publishes the inputs of the device to a topic and reads commands from a topic to set the outputs of the device (this may be incompatible with the system functionality and will probably have to be removed). This object is not interacting in any way with the HardwareInterface. Its children (e.g. cod_decod_01) will.
Definition in file cod_decod_std_io.hpp.