#include <ros/ros.h>
#include <carl_dynamixel/LookAtFrame.h>
#include <carl_dynamixel/LookAtPoint.h>
#include <sensor_msgs/JointState.h>
#include <std_msgs/Float64.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
Classes | |
class | servoPanTilt |
Controls panning and tilting of CARL's cameras. More... | |
Defines | |
#define | ASUS_TILT_MAX 2.59 |
#define | ASUS_TILT_MIN -1.79 |
Controls panning and tilting of CARL's cameras. |
#define ASUS_TILT_MAX 2.59 |
Definition at line 23 of file servo_pan_tilt.h.
#define ASUS_TILT_MIN -1.79 |
Controls panning and tilting of CARL's cameras.
.h servo_pan_tilt creates a ROS node that allows pan and tilt control of the servos that CARL's cameras are mounted on.
Definition at line 22 of file servo_pan_tilt.h.