#include "ros/ros.h"
#include <gtest/gtest.h>
#include <moveit_msgs/MoveItErrorCodes.h>
#include "pilz_extensions/joint_limits_extension.h"
#include "pilz_extensions/joint_limits_interface_extension.h"
Go to the source code of this file.
Classes | |
class | JointLimitTest |
Functions | |
int | main (int argc, char **argv) |
TEST_F (JointLimitTest, SimpleRead) | |
Simple read. More... | |
TEST_F (JointLimitTest, OldRead) | |
Old still works. More... | |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 59 of file unittest_joint_limit.cpp.
TEST_F | ( | JointLimitTest | , |
SimpleRead | |||
) |
Simple read.
Definition at line 33 of file unittest_joint_limit.cpp.
TEST_F | ( | JointLimitTest | , |
OldRead | |||
) |
Old still works.
Definition at line 49 of file unittest_joint_limit.cpp.