#include "ros/ros.h"
#include "std_msgs/UInt8MultiArray.h"
#include "std_srvs/Empty.h"
#include "visualization_msgs/MarkerArray.h"
#include "visualization_msgs/Marker.h"
#include "geometry_msgs/PoseWithCovarianceStamped.h"
#include "tf/transform_broadcaster.h"
#include "tf/transform_listener.h"
#include "biped_robin_msgs/StepTarget3DService.h"
#include "biped_robin_msgs/SetModeService.h"
#include "biped_robin_msgs/SetParamService.h"
#include "biped_robin_msgs/MovePostureCartesianService.h"
#include "biped_robin_msgs/MovePostureJointService.h"
#include "biped_robin_msgs/MoveGripperService.h"
Go to the source code of this file.
Classes | |
struct | DataPoint |
struct | DataPointArray |
Defines | |
#define | DEFAULT_VARIABLE_NUMBER 150 |
#define | DEFAULT_WORDLENGTH 40 /* multible of 4 and compatible with simulink receiving file */ |
Functions | |
bool | acknowledgeCallback (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
bool | footstepIncCallback (biped_robin_msgs::StepTarget3DService::Request &req, biped_robin_msgs::StepTarget3DService::Response &res) |
int | main (int argc, char **argv) |
bool | moveGripperCallback (biped_robin_msgs::MoveGripperService::Request &req, biped_robin_msgs::MoveGripperService::Response &res) |
bool | movePostureCartesianCallback (biped_robin_msgs::MovePostureCartesianService::Request &req, biped_robin_msgs::MovePostureCartesianService::Response &res) |
bool | movePostureJointCallback (biped_robin_msgs::MovePostureJointService::Request &req, biped_robin_msgs::MovePostureJointService::Response &res) |
bool | referenceCallback (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
bool | resetCallback (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
bool | sendParameterToRobot (const char *name, double value) |
bool | setModeCallback (biped_robin_msgs::SetModeService::Request &req, biped_robin_msgs::SetModeService::Response &res) |
bool | setParamCallback (biped_robin_msgs::SetParamService::Request &req, biped_robin_msgs::SetParamService::Response &res) |
bool | stopCallback (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
Variables | |
int | old_left_right = 1 |
ros::Publisher | rtai_data |
unsigned int | stepCounter = 0 |
#define DEFAULT_VARIABLE_NUMBER 150 |
Definition at line 20 of file biped_serializer.cpp.
#define DEFAULT_WORDLENGTH 40 /* multible of 4 and compatible with simulink receiving file */ |
Definition at line 21 of file biped_serializer.cpp.
bool acknowledgeCallback | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 188 of file biped_serializer.cpp.
bool footstepIncCallback | ( | biped_robin_msgs::StepTarget3DService::Request & | req, |
biped_robin_msgs::StepTarget3DService::Response & | res | ||
) |
Definition at line 65 of file biped_serializer.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 221 of file biped_serializer.cpp.
bool moveGripperCallback | ( | biped_robin_msgs::MoveGripperService::Request & | req, |
biped_robin_msgs::MoveGripperService::Response & | res | ||
) |
Definition at line 182 of file biped_serializer.cpp.
bool movePostureCartesianCallback | ( | biped_robin_msgs::MovePostureCartesianService::Request & | req, |
biped_robin_msgs::MovePostureCartesianService::Response & | res | ||
) |
Definition at line 108 of file biped_serializer.cpp.
bool movePostureJointCallback | ( | biped_robin_msgs::MovePostureJointService::Request & | req, |
biped_robin_msgs::MovePostureJointService::Response & | res | ||
) |
Definition at line 146 of file biped_serializer.cpp.
bool referenceCallback | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 193 of file biped_serializer.cpp.
bool resetCallback | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 203 of file biped_serializer.cpp.
bool sendParameterToRobot | ( | const char * | name, |
double | value | ||
) |
Definition at line 42 of file biped_serializer.cpp.
bool setModeCallback | ( | biped_robin_msgs::SetModeService::Request & | req, |
biped_robin_msgs::SetModeService::Response & | res | ||
) |
Definition at line 208 of file biped_serializer.cpp.
bool setParamCallback | ( | biped_robin_msgs::SetParamService::Request & | req, |
biped_robin_msgs::SetParamService::Response & | res | ||
) |
Definition at line 214 of file biped_serializer.cpp.
bool stopCallback | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) |
Definition at line 198 of file biped_serializer.cpp.
int old_left_right = 1 |
Definition at line 38 of file biped_serializer.cpp.
Definition at line 37 of file biped_serializer.cpp.
unsigned int stepCounter = 0 |
Definition at line 39 of file biped_serializer.cpp.