#include <iostream>
#include <visp3/core/vpCameraParameters.h>
#include <visp3/detection/vpDetectorAprilTag.h>
#include <visp3/gui/vpDisplayOpenCV.h>
#include <visp3/gui/vpPlot.h>
#include <visp3/io/vpImageIo.h>
#include <visp3/visual_features/vpFeatureThetaU.h>
#include <visp3/visual_features/vpFeatureTranslation.h>
#include <visp3/vs/vpServo.h>
#include <visp3/vs/vpServoDisplay.h>
#include <visp_ros/vpROSGrabber.h>
#include <visp_ros/vpROSRobotFrankaCoppeliasim.h>
#include <geometry_msgs/WrenchStamped.h>
Go to the source code of this file.
|
vpMatrix | compute_interaction_matrix_3D (const vpHomogeneousMatrix &cdMc) |
|
void | display_point_trajectory (const vpImage< unsigned char > &I, const std::vector< vpImagePoint > &vip, std::vector< vpImagePoint > *traj_vip) |
|
int | main (int argc, char **argv) |
|
vpMatrix | Ta (const vpHomogeneousMatrix &edMe) |
|
vpColVector | We (6, 0) |
|
void | Wrench_callback (const geometry_msgs::WrenchStamped &sensor_wrench) |
|
◆ compute_interaction_matrix_3D()
vpMatrix compute_interaction_matrix_3D |
( |
const vpHomogeneousMatrix & |
cdMc | ) |
|
◆ display_point_trajectory()
void display_point_trajectory |
( |
const vpImage< unsigned char > & |
I, |
|
|
const std::vector< vpImagePoint > & |
vip, |
|
|
std::vector< vpImagePoint > * |
traj_vip |
|
) |
| |
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ Ta()
vpMatrix Ta |
( |
const vpHomogeneousMatrix & |
edMe | ) |
|
◆ We()
◆ Wrench_callback()
void Wrench_callback |
( |
const geometry_msgs::WrenchStamped & |
sensor_wrench | ) |
|
◆ shared_data
visp_ros
Author(s): Francois Pasteau, Fabien Spindler, Gatien Gaumerais, Alexander Oliva
autogenerated on Wed Mar 2 2022 01:13:33