#include <signal.h>
#include <ros/ros.h>
#include <ros/console.h>
#include <controller_manager/controller_manager.h>
#include <sciurus17_control/dxlport_control.h>
#include <std_msgs/Int32.h>
#include <std_msgs/Int16.h>
#include <std_msgs/UInt16.h>
#include <std_msgs/Int8.h>
#include <std_msgs/String.h>
#include <std_msgs/Float64.h>
#include <sstream>
#include <queue>
#include <unistd.h>
Go to the source code of this file.
Classes | |
struct | SET_GAIN_QUEUE |
Macros | |
#define | CONTROL_ACTIVE_HZ (200) |
#define | CONTROL_WAIT_HZ (50) |
#define | REACTIVE_RATE_FUNCTION |
Typedefs | |
typedef dynamic_reconfigure::Server< sciurus17_msgs::ServoParameterConfig > | RECONFIG_TYPE |
typedef struct SET_GAIN_QUEUE | ST_SET_GAIN_QUEUE |
Functions | |
void | gainCallback (const ros::MessageEvent< std_msgs::UInt16 const > &event) |
void | init_reconfigure (DXLPORT_CONTROL *driver) |
void | init_topics (DXLPORT_CONTROL *driver, ros::NodeHandle nh) |
int | main (int argc, char *argv[]) |
void | publish_topic_data (DXLPORT_CONTROL *driver, bool temp_flg) |
void | reconfigureCallback (sciurus17_msgs::ServoParameterConfig &config, uint32_t level, uint8_t id) |
void | SigintHandler (int sig) |
std::vector< std::string > | split (const std::string &input, char delimiter) |
void | write_joint_param (DXLPORT_CONTROL &driver, ST_JOINT_PARAM set_param) |
Variables | |
static std::vector< ros::Publisher > | current_pub |
static DXLPORT_CONTROL * | driver_addr |
static std::vector< ros::Publisher > | dxl_position_pub |
static std::vector< ros::Subscriber > | gain_sub |
static std_msgs::String | lasterror_out |
static std::vector< std::unique_ptr< RECONFIG_TYPE > > | reconfig_srv |
static std::queue< ST_SET_GAIN_QUEUE > | set_gain_request |
static std::queue< ST_JOINT_PARAM > | set_joint_param_request |
static std::vector< ros::Publisher > | temp_pub |
#define CONTROL_ACTIVE_HZ (200) |
Definition at line 20 of file hardware.cpp.
#define CONTROL_WAIT_HZ (50) |
Definition at line 19 of file hardware.cpp.
#define REACTIVE_RATE_FUNCTION |
Definition at line 17 of file hardware.cpp.
typedef dynamic_reconfigure::Server<sciurus17_msgs::ServoParameterConfig> RECONFIG_TYPE |
Definition at line 30 of file hardware.cpp.
typedef struct SET_GAIN_QUEUE ST_SET_GAIN_QUEUE |
void gainCallback | ( | const ros::MessageEvent< std_msgs::UInt16 const > & | event | ) |
Definition at line 65 of file hardware.cpp.
void init_reconfigure | ( | DXLPORT_CONTROL * | driver | ) |
Definition at line 154 of file hardware.cpp.
void init_topics | ( | DXLPORT_CONTROL * | driver, |
ros::NodeHandle | nh | ||
) |
Definition at line 133 of file hardware.cpp.
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 217 of file hardware.cpp.
void publish_topic_data | ( | DXLPORT_CONTROL * | driver, |
bool | temp_flg | ||
) |
Definition at line 165 of file hardware.cpp.
void reconfigureCallback | ( | sciurus17_msgs::ServoParameterConfig & | config, |
uint32_t | level, | ||
uint8_t | id | ||
) |
Definition at line 88 of file hardware.cpp.
void SigintHandler | ( | int | sig | ) |
Definition at line 212 of file hardware.cpp.
std::vector<std::string> split | ( | const std::string & | input, |
char | delimiter | ||
) |
Definition at line 53 of file hardware.cpp.
void write_joint_param | ( | DXLPORT_CONTROL & | driver, |
ST_JOINT_PARAM | set_param | ||
) |
Definition at line 195 of file hardware.cpp.
|
static |
Definition at line 26 of file hardware.cpp.
|
static |
Definition at line 32 of file hardware.cpp.
|
static |
Definition at line 27 of file hardware.cpp.
|
static |
Definition at line 29 of file hardware.cpp.
|
static |
Definition at line 25 of file hardware.cpp.
|
static |
Definition at line 31 of file hardware.cpp.
|
static |
Definition at line 49 of file hardware.cpp.
|
static |
Definition at line 51 of file hardware.cpp.
|
static |
Definition at line 28 of file hardware.cpp.