#include <ros/ros.h>
#include <cstdio>
#include <cstdlib>
#include <sensor_msgs/Joy.h>
#include <sensor_msgs/JointState.h>
#include <control_msgs/JointTrajectoryControllerState.h>
#include <std_msgs/Float64.h>
#include <trajectory_msgs/JointTrajectory.h>
#include <geometry_msgs/Twist.h>
#include <cstdint>
#include <boost/optional.hpp>
#include <unordered_map>
Go to the source code of this file.
◆ Joint
enum Joint : std::uint8_t |
|
strong |
Enumerator |
---|
LeftArm1 | |
LeftArm2 | |
RightArm1 | |
RightArm2 | |
WaistHinge | |
BaseLeft | |
BaseRight | |
BaseTurret | |
Definition at line 18 of file quori_teleop_node.cpp.
◆ lookup_latest_position()
double lookup_latest_position |
( |
const std::string & |
name | ) |
|
◆ main()
int main |
( |
int |
argc, |
|
|
char * |
argv[] |
|
) |
| |
◆ on_joint_states()
void on_joint_states |
( |
const sensor_msgs::JointState::ConstPtr & |
msg | ) |
|
◆ on_joy()
void on_joy |
( |
const sensor_msgs::Joy::ConstPtr & |
msg | ) |
|
◆ command
◆ JOINT_NAMES
const static std::unordered_map<Joint, std::string> JOINT_NAMES |
|
static |
◆ joint_states
sensor_msgs::JointState::ConstPtr joint_states |
◆ traj
trajectory_msgs::JointTrajectory traj |
◆ vel