ros2_interfaces_rolling/moveit_msgs/msg/
attached_collision_object.rs1use serde::{Deserialize, Serialize};
2
3#[derive(Debug, Clone, PartialEq, Serialize, Deserialize)]
4pub struct AttachedCollisionObject {
5 pub link_name: ::std::string::String,
6 pub object: crate::moveit_msgs::msg::CollisionObject,
7 pub touch_links: Vec<::std::string::String>,
8 pub detach_posture: crate::trajectory_msgs::msg::JointTrajectory,
9 pub weight: f64,
10}
11
12impl Default for AttachedCollisionObject {
13 fn default() -> Self {
14 AttachedCollisionObject {
15 link_name: ::std::string::String::new(),
16 object: crate::moveit_msgs::msg::CollisionObject::default(),
17 touch_links: Vec::new(),
18 detach_posture: crate::trajectory_msgs::msg::JointTrajectory::default(),
19 weight: 0.0,
20 }
21 }
22}
23
24impl ros2_client::Message for AttachedCollisionObject {}