Go to the documentation of this file.
33 #ifndef S5FH_DIAGNOSTICS_H
34 #define S5FH_DIAGNOSTICS_H
51 #include "std_msgs/Float64MultiArray.h"
52 #include "std_msgs/MultiArrayDimension.h"
53 #include "std_msgs/MultiArrayLayout.h"
54 #include <sensor_msgs/JointState.h>
55 #include <std_msgs/Bool.h>
56 #include <std_msgs/Empty.h>
57 #include <std_msgs/Int8.h>
58 #include <std_msgs/String.h>
61 #include "schunk_svh_msgs/SVHDiagnosticsAction.h"
62 #include "schunk_svh_msgs/SVHDiagnosticsToProtocol.h"
82 std::shared_ptr<driver_svh::SVHFingerManager>& finger_manager,
83 std::function<
void(
bool)> enable_ros_contol_loop,
84 std::function<
void(uint16_t, uint16_t)> init_controller_parameters,
221 #endif // S5FH_CONTROLLER_H
void initTest()
initialize the protocol variables
ros::Publisher m_pub_protocol_variables
publisher to the protocol variables
std::function< void(uint16_t, uint16_t)> m_init_controller_parameters
schunk_svh_msgs::SVHDiagnosticsToProtocol m_msg_protocol_variable
Message for the Protocol variable.
std::string m_assembly_of
Name of the testing person.
~SVHDiagnostics()
Default DTOR.
std::function< void(bool)> m_enable_ros_contol_loop
std::string m_serial_device_name
Serial device to use for communication with hardware.
int m_connect_retry_count
bool m_execution_R
Type of the Hand, No/ L / R.
std_msgs::Float64MultiArray channel_currents
Current Value message template.
void debugOuput()
debugOutput prints the diagnostic data of all finger
@ diag_information_dimension
SVHDiagnostics(const ros::NodeHandle &nh, std::shared_ptr< driver_svh::SVHFingerManager > &finger_manager, std::function< void(bool)> enable_ros_contol_loop, std::function< void(uint16_t, uint16_t)> init_controller_parameters, std::string name)
SVHDiagnostics constructs a new node object that handles most of the functionality.
void initializeProtocolMessage()
initialize the protocol variables
schunk_svh_msgs::SVHDiagnosticsFeedback m_action_feedback
sensor_msgs::JointState channel_pos_
joint state message template
actionlib::SimpleActionServer< schunk_svh_msgs::SVHDiagnosticsAction > m_diagnostics_action_server
Action Server.
std::string m_serial_no
Serial No of the tested Hand.
void resetDiagnosticStatus()
resetDiagnosticStatus resets the finger vector with the diagnostic data
std::string m_action_name
ros::NodeHandle m_priv_nh
private node handle
void qualityProtocolWritting()
set the protocol variables
std::vector< bool > reset_success
Reset successed vector.
schunk_svh_msgs::SVHDiagnosticsResult m_action_result
Action result.
bool m_basic_test_running
To catch multiple bastic test starts.
void testCallback(const std_msgs::String &)
Callback function to test the subfunctions of SVHDiagnostics.
bool m_communication
Type of onnection.
void basicTestCallback(const schunk_svh_msgs::SVHDiagnosticsGoalConstPtr &goal)
schunk_svh_msgs::SVHDiagnosticsResult evaluateBasicTest()
evaluateBasicTest evaluates the diagnostics status of the basic test to send the hint informations to...
std::shared_ptr< driver_svh::SVHFingerManager > m_finger_manager
Handle to the SVH finger manager for library access.
schunk_svh_driver
Author(s): Georg Heppner
, Felix Exner , Pascal Becker , Johannes Mangler
autogenerated on Sat Apr 15 2023 02:24:55